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 Jan 18, 2025
1 parent f82f8e3 commit 2044311
Show file tree
Hide file tree
Showing 5 changed files with 13 additions and 13 deletions.
2 changes: 1 addition & 1 deletion build_depends.repos
Original file line number Diff line number Diff line change
Expand Up @@ -10,4 +10,4 @@ repositories:
autoware_internal_msgs:
type: git
url: https://github.com/autowarefoundation/autoware_internal_msgs
version: main
version: main
Original file line number Diff line number Diff line change
Expand Up @@ -19,6 +19,9 @@
#include <rclcpp/rclcpp.hpp>

#include <autoware_adapi_v1_msgs/msg/operation_mode_state.hpp>
#include <autoware_internal_planning_msgs/msg/path_point_with_lane_id.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>
#include <autoware_internal_planning_msgs/msg/scenario.hpp>
#include <autoware_map_msgs/msg/lanelet_map_bin.hpp>
#include <autoware_planning_msgs/msg/lanelet_primitive.hpp>
#include <autoware_planning_msgs/msg/lanelet_route.hpp>
Expand All @@ -30,9 +33,6 @@
#include <nav_msgs/msg/odometry.hpp>
#include <rosgraph_msgs/msg/clock.hpp>
#include <tf2_msgs/msg/tf_message.hpp>
#include <autoware_internal_planning_msgs/msg/path_point_with_lane_id.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>
#include <autoware_internal_planning_msgs/msg/scenario.hpp>

#include <lanelet2_io/Io.h>

Expand All @@ -48,22 +48,22 @@
namespace autoware::test_utils
{
using autoware_adapi_v1_msgs::msg::OperationModeState;
using autoware_internal_planning_msgs::msg::PathPointWithLaneId;
using autoware_internal_planning_msgs::msg::PathWithLaneId;
using autoware_map_msgs::msg::LaneletMapBin;
using autoware_planning_msgs::msg::LaneletPrimitive;
using autoware_planning_msgs::msg::LaneletRoute;
using autoware_planning_msgs::msg::LaneletSegment;
using autoware_planning_msgs::msg::Path;
using autoware_planning_msgs::msg::Trajectory;
using autoware_internal_planning_msgs::msg::PathPointWithLaneId;
using autoware_internal_planning_msgs::msg::PathWithLaneId;
using RouteSections = std::vector<autoware_planning_msgs::msg::LaneletSegment>;
using autoware_internal_planning_msgs::msg::Scenario;
using geometry_msgs::msg::Point;
using geometry_msgs::msg::Pose;
using geometry_msgs::msg::PoseStamped;
using nav_msgs::msg::OccupancyGrid;
using nav_msgs::msg::Odometry;
using tf2_msgs::msg::TFMessage;
using autoware_internal_planning_msgs::msg::Scenario;

/**
* @brief Creates a Pose message with the specified position and orientation.
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -19,6 +19,7 @@
#include <builtin_interfaces/msg/time.hpp>

#include <autoware_adapi_v1_msgs/msg/operation_mode_state.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
#include <autoware_perception_msgs/msg/tracked_objects.hpp>
#include <autoware_perception_msgs/msg/traffic_light_group_array.hpp>
Expand All @@ -29,7 +30,6 @@
#include <geometry_msgs/msg/pose_with_covariance.hpp>
#include <geometry_msgs/msg/twist_with_covariance.hpp>
#include <nav_msgs/msg/odometry.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>

#include <yaml-cpp/yaml.h>

Expand All @@ -56,6 +56,8 @@ using autoware_perception_msgs::msg::TrafficLightElement;
using autoware_perception_msgs::msg::TrafficLightGroup;
using autoware_perception_msgs::msg::TrafficLightGroupArray;

using autoware_internal_planning_msgs::msg::PathPointWithLaneId;
using autoware_internal_planning_msgs::msg::PathWithLaneId;
using autoware_planning_msgs::msg::LaneletPrimitive;
using autoware_planning_msgs::msg::LaneletRoute;
using autoware_planning_msgs::msg::LaneletSegment;
Expand All @@ -72,8 +74,6 @@ using geometry_msgs::msg::Twist;
using geometry_msgs::msg::TwistWithCovariance;
using nav_msgs::msg::Odometry;
using std_msgs::msg::Header;
using autoware_internal_planning_msgs::msg::PathPointWithLaneId;
using autoware_internal_planning_msgs::msg::PathWithLaneId;
using unique_identifier_msgs::msg::UUID;

/**
Expand Down
2 changes: 1 addition & 1 deletion common/autoware_test_utils/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -21,6 +21,7 @@
<depend>autoware_component_interface_specs</depend>
<depend>autoware_component_interface_utils</depend>
<depend>autoware_control_msgs</depend>
<depend>autoware_internal_planning_msgs</depend>
<depend>autoware_lanelet2_extension</depend>
<depend>autoware_map_msgs</depend>
<depend>autoware_perception_msgs</depend>
Expand All @@ -34,7 +35,6 @@
<depend>std_srvs</depend>
<depend>tf2_msgs</depend>
<depend>tf2_ros</depend>
<depend>autoware_internal_planning_msgs</depend>
<depend>unique_identifier_msgs</depend>
<depend>yaml_cpp_vendor</depend>

Expand Down
4 changes: 2 additions & 2 deletions common/autoware_test_utils/src/topic_snapshot_saver.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -18,14 +18,14 @@
#include <rclcpp/rclcpp.hpp>

#include <autoware_adapi_v1_msgs/msg/operation_mode_state.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
#include <autoware_perception_msgs/msg/tracked_objects.hpp>
#include <autoware_perception_msgs/msg/traffic_light_group_array.hpp>
#include <autoware_planning_msgs/msg/lanelet_route.hpp>
#include <geometry_msgs/msg/accel_with_covariance_stamped.hpp>
#include <nav_msgs/msg/odometry.hpp>
#include <std_srvs/srv/empty.hpp>
#include <autoware_internal_planning_msgs/msg/path_with_lane_id.hpp>

#include <yaml-cpp/yaml.h>

Expand All @@ -48,7 +48,7 @@ using MessageType = std::variant<
autoware_planning_msgs::msg::LaneletRoute, // 4
autoware_perception_msgs::msg::TrafficLightGroupArray, // 5
autoware_perception_msgs::msg::TrackedObjects, // 6
autoware_internal_planning_msgs::msg::PathWithLaneId // 7
autoware_internal_planning_msgs::msg::PathWithLaneId // 7
>;

std::optional<size_t> get_topic_index(const std::string & name)
Expand Down

0 comments on commit 2044311

Please sign in to comment.