Skip to content

Commit

Permalink
style(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] committed May 18, 2023
1 parent ace021d commit b9fcff8
Show file tree
Hide file tree
Showing 3 changed files with 3 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -36,8 +36,8 @@
#include <rclcpp/rclcpp.hpp>
#include <tier4_autoware_utils/ros/self_pose_listener.hpp>

#include <autoware_control_msgs/msg/lateral.hpp>
#include <autoware_auto_planning_msgs/msg/trajectory.hpp>
#include <autoware_control_msgs/msg/lateral.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <geometry_msgs/msg/twist_stamped.hpp>
#include <nav_msgs/msg/odometry.hpp>
Expand Down
2 changes: 1 addition & 1 deletion control/vehicle_cmd_gate/script/delays_checker.py
Original file line number Diff line number Diff line change
Expand Up @@ -14,8 +14,8 @@
# See the License for the specific language governing permissions and
# limitations under the License.

from autoware_control_msgs.msg import Control
from autoware_auto_vehicle_msgs.msg import Engage
from autoware_control_msgs.msg import Control
from geometry_msgs.msg import AccelWithCovarianceStamped
from nav_msgs.msg import Odometry
import rclpy
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -16,12 +16,12 @@

import time

from autoware_control_msgs.msg import Control
from autoware_auto_planning_msgs.msg import Path
from autoware_auto_planning_msgs.msg import PathWithLaneId
from autoware_auto_planning_msgs.msg import Trajectory
from autoware_auto_vehicle_msgs.msg import Engage
from autoware_auto_vehicle_msgs.msg import VelocityReport
from autoware_control_msgs.msg import Control
from geometry_msgs.msg import Pose
from nav_msgs.msg import Odometry
import numpy as np
Expand Down

0 comments on commit b9fcff8

Please sign in to comment.