Skip to content

Commit 2c774fb

Browse files
style(pre-commit): autofix
1 parent 1733dfc commit 2c774fb

File tree

25 files changed

+89
-79
lines changed

25 files changed

+89
-79
lines changed

planning/autoware_external_velocity_limit_selector/README.md

+4-4
Original file line numberDiff line numberDiff line change
@@ -37,16 +37,16 @@ Example:
3737

3838
## Inputs
3939

40-
| Name | Type | Description |
41-
| --------------------------------------------------- | ---------------------------------------------- | --------------------------------------------- |
40+
| Name | Type | Description |
41+
| --------------------------------------------------- | --------------------------------------------------------------- | --------------------------------------------- |
4242
| `~input/velocity_limit_from_api` | autoware_internal_planning_msgs::msg::VelocityLimit | velocity limit from api |
4343
| `~input/velocity_limit_from_internal` | autoware_internal_planning_msgs::msg::VelocityLimit | velocity limit from autoware internal modules |
4444
| `~input/velocity_limit_clear_command_from_internal` | autoware_internal_planning_msgs::msg::VelocityLimitClearCommand | velocity limit clear command |
4545

4646
## Outputs
4747

48-
| Name | Type | Description |
49-
| ---------------------- | ---------------------------------- | ------------------------------------------------- |
48+
| Name | Type | Description |
49+
| ---------------------- | --------------------------------------------------- | ------------------------------------------------- |
5050
| `~output/max_velocity` | autoware_internal_planning_msgs::msg::VelocityLimit | current information of the hardest velocity limit |
5151

5252
## Parameters

planning/autoware_obstacle_cruise_planner/README.md

+3-3
Original file line numberDiff line numberDiff line change
@@ -23,9 +23,9 @@ The `autoware_obstacle_cruise_planner` package has following modules.
2323

2424
### Output topics
2525

26-
| Name | Type | Description |
27-
| ------------------------------- | ---------------------------------------------- | -------------------------------- |
28-
| `~/output/trajectory` | autoware_planning_msgs::Trajectory | output trajectory |
26+
| Name | Type | Description |
27+
| ------------------------------- | --------------------------------------------------------------- | -------------------------------- |
28+
| `~/output/trajectory` | autoware_planning_msgs::Trajectory | output trajectory |
2929
| `~/output/velocity_limit` | autoware_internal_planning_msgs::msg::VelocityLimit | velocity limit for cruising |
3030
| `~/output/clear_velocity_limit` | autoware_internal_planning_msgs::msg::VelocityLimitClearCommand | clear command for velocity limit |
3131

planning/autoware_obstacle_cruise_planner/include/autoware/obstacle_cruise_planner/type_alias.hpp

+4-4
Original file line numberDiff line numberDiff line change
@@ -21,6 +21,8 @@
2121

2222
#include "autoware_internal_debug_msgs/msg/float32_stamped.hpp"
2323
#include "autoware_internal_debug_msgs/msg/float64_stamped.hpp"
24+
#include "autoware_internal_planning_msgs/msg/velocity_limit.hpp"
25+
#include "autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp"
2426
#include "autoware_perception_msgs/msg/predicted_object.hpp"
2527
#include "autoware_perception_msgs/msg/predicted_objects.hpp"
2628
#include "autoware_planning_msgs/msg/trajectory.hpp"
@@ -31,8 +33,6 @@
3133
#include "nav_msgs/msg/odometry.hpp"
3234
#include "sensor_msgs/msg/point_cloud2.hpp"
3335
#include "tier4_planning_msgs/msg/stop_speed_exceeded.hpp"
34-
#include "autoware_internal_planning_msgs/msg/velocity_limit.hpp"
35-
#include "autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp"
3636
#include "visualization_msgs/msg/marker_array.hpp"
3737

3838
#include <pcl/point_cloud.h>
@@ -41,6 +41,8 @@
4141
using autoware::vehicle_info_utils::VehicleInfo;
4242
using autoware_internal_debug_msgs::msg::Float32Stamped;
4343
using autoware_internal_debug_msgs::msg::Float64Stamped;
44+
using autoware_internal_planning_msgs::msg::VelocityLimit;
45+
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
4446
using autoware_perception_msgs::msg::ObjectClassification;
4547
using autoware_perception_msgs::msg::PredictedObject;
4648
using autoware_perception_msgs::msg::PredictedObjects;
@@ -54,8 +56,6 @@ using geometry_msgs::msg::Twist;
5456
using nav_msgs::msg::Odometry;
5557
using sensor_msgs::msg::PointCloud2;
5658
using tier4_planning_msgs::msg::StopSpeedExceeded;
57-
using autoware_internal_planning_msgs::msg::VelocityLimit;
58-
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
5959
using visualization_msgs::msg::Marker;
6060
using visualization_msgs::msg::MarkerArray;
6161
namespace bg = boost::geometry;

planning/autoware_obstacle_stop_planner/src/node.hpp

+4-4
Original file line numberDiff line numberDiff line change
@@ -34,6 +34,8 @@
3434
#include <autoware_internal_debug_msgs/msg/float32_multi_array_stamped.hpp>
3535
#include <autoware_internal_debug_msgs/msg/float32_stamped.hpp>
3636
#include <autoware_internal_debug_msgs/msg/float64_stamped.hpp>
37+
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
38+
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
3739
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
3840
#include <autoware_planning_msgs/msg/trajectory.hpp>
3941
#include <diagnostic_msgs/msg/diagnostic_status.hpp>
@@ -42,8 +44,6 @@
4244
#include <geometry_msgs/msg/twist_stamped.hpp>
4345
#include <sensor_msgs/msg/point_cloud2.hpp>
4446
#include <tier4_planning_msgs/msg/expand_stop_range.hpp>
45-
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
46-
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
4747

4848
#include <boost/assert.hpp>
4949
#include <boost/assign/list_of.hpp>
@@ -83,15 +83,15 @@ using autoware_internal_debug_msgs::msg::BoolStamped;
8383
using autoware_internal_debug_msgs::msg::Float32MultiArrayStamped;
8484
using autoware_internal_debug_msgs::msg::Float32Stamped;
8585
using autoware_internal_debug_msgs::msg::Float64Stamped;
86+
using autoware_internal_planning_msgs::msg::VelocityLimit;
87+
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
8688
using autoware_perception_msgs::msg::PredictedObjects;
8789
using autoware_planning_msgs::msg::Trajectory;
8890
using autoware_planning_msgs::msg::TrajectoryPoint;
8991
using autoware_utils::Point2d;
9092
using autoware_utils::Polygon2d;
9193
using autoware_utils::StopWatch;
9294
using tier4_planning_msgs::msg::ExpandStopRange;
93-
using autoware_internal_planning_msgs::msg::VelocityLimit;
94-
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
9595

9696
using TrajectoryPoints = std::vector<TrajectoryPoint>;
9797
using PointCloud = pcl::PointCloud<pcl::PointXYZ>;

planning/autoware_surround_obstacle_checker/README.md

+7-7
Original file line numberDiff line numberDiff line change
@@ -86,15 +86,15 @@ As mentioned in stop condition section, it prevents chattering by changing thres
8686

8787
### Output
8888

89-
| Name | Type | Description |
90-
| --------------------------------------- | ----------------------------------------------------- | ------------------------------------------------------------------------------------- |
89+
| Name | Type | Description |
90+
| --------------------------------------- | ----------------------------------------------------------------- | ------------------------------------------------------------------------------------- |
9191
| `~/output/velocity_limit_clear_command` | `autoware_internal_planning_msgs::msg::VelocityLimitClearCommand` | Velocity limit clear command |
9292
| `~/output/max_velocity` | `autoware_internal_planning_msgs::msg::VelocityLimit` | Velocity limit command |
93-
| `~/output/no_start_reason` | `diagnostic_msgs::msg::DiagnosticStatus` | No start reason |
94-
| `~/debug/marker` | `visualization_msgs::msg::MarkerArray` | Marker for visualization |
95-
| `~/debug/footprint` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle base footprint for visualization |
96-
| `~/debug/footprint_offset` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle footprint with `surround_check_distance` offset for visualization |
97-
| `~/debug/footprint_recover_offset` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle footprint with `surround_check_recover_distance` offset for visualization |
93+
| `~/output/no_start_reason` | `diagnostic_msgs::msg::DiagnosticStatus` | No start reason |
94+
| `~/debug/marker` | `visualization_msgs::msg::MarkerArray` | Marker for visualization |
95+
| `~/debug/footprint` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle base footprint for visualization |
96+
| `~/debug/footprint_offset` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle footprint with `surround_check_distance` offset for visualization |
97+
| `~/debug/footprint_recover_offset` | `geometry_msgs::msg::PolygonStamped` | Ego vehicle footprint with `surround_check_recover_distance` offset for visualization |
9898

9999
## Parameters
100100

planning/autoware_surround_obstacle_checker/src/node.hpp

+4-4
Original file line numberDiff line numberDiff line change
@@ -25,13 +25,13 @@
2525
#include <rclcpp/rclcpp.hpp>
2626

2727
#include <autoware_internal_debug_msgs/msg/float64_stamped.hpp>
28+
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
29+
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
2830
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
2931
#include <diagnostic_msgs/msg/diagnostic_status.hpp>
3032
#include <diagnostic_msgs/msg/key_value.hpp>
3133
#include <nav_msgs/msg/odometry.hpp>
3234
#include <sensor_msgs/msg/point_cloud2.hpp>
33-
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
34-
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
3535
#include <visualization_msgs/msg/marker_array.hpp>
3636

3737
#include <tf2/utils.h>
@@ -50,10 +50,10 @@ namespace autoware::surround_obstacle_checker
5050

5151
using autoware::motion_utils::VehicleStopChecker;
5252
using autoware::vehicle_info_utils::VehicleInfo;
53-
using autoware_perception_msgs::msg::PredictedObjects;
54-
using autoware_perception_msgs::msg::Shape;
5553
using autoware_internal_planning_msgs::msg::VelocityLimit;
5654
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
55+
using autoware_perception_msgs::msg::PredictedObjects;
56+
using autoware_perception_msgs::msg::Shape;
5757

5858
using Obstacle = std::pair<double /* distance */, geometry_msgs::msg::Point>;
5959

planning/autoware_surround_obstacle_checker/surround_obstacle_checker-design.ja.md

+4-4
Original file line numberDiff line numberDiff line change
@@ -86,12 +86,12 @@ Stop condition の項で述べたように、状態によって障害物判定
8686

8787
### Output
8888

89-
| Name | Type | Description |
90-
| --------------------------------------- | ----------------------------------------------------- | ---------------------------- |
89+
| Name | Type | Description |
90+
| --------------------------------------- | ----------------------------------------------------------------- | ---------------------------- |
9191
| `~/output/velocity_limit_clear_command` | `autoware_internal_planning_msgs::msg::VelocityLimitClearCommand` | Velocity limit clear command |
9292
| `~/output/max_velocity` | `autoware_internal_planning_msgs::msg::VelocityLimit` | Velocity limit command |
93-
| `~/output/no_start_reason` | `diagnostic_msgs::msg::DiagnosticStatus` | No start reason |
94-
| `~/debug/marker` | `visualization_msgs::msg::MarkerArray` | Marker for visualization |
93+
| `~/output/no_start_reason` | `diagnostic_msgs::msg::DiagnosticStatus` | No start reason |
94+
| `~/debug/marker` | `visualization_msgs::msg::MarkerArray` | Marker for visualization |
9595

9696
## Parameters
9797

planning/autoware_velocity_smoother/include/autoware/velocity_smoother/node.hpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -42,11 +42,11 @@
4242
#include "autoware_adapi_v1_msgs/msg/operation_mode_state.hpp"
4343
#include "autoware_internal_debug_msgs/msg/float32_stamped.hpp"
4444
#include "autoware_internal_debug_msgs/msg/float64_stamped.hpp"
45+
#include "autoware_internal_planning_msgs/msg/velocity_limit.hpp" // temporary
4546
#include "autoware_planning_msgs/msg/trajectory.hpp"
4647
#include "autoware_planning_msgs/msg/trajectory_point.hpp"
4748
#include "geometry_msgs/msg/accel_with_covariance_stamped.hpp"
4849
#include "nav_msgs/msg/odometry.hpp"
49-
#include "autoware_internal_planning_msgs/msg/velocity_limit.hpp" // temporary
5050
#include "visualization_msgs/msg/marker_array.hpp"
5151

5252
#include <iostream>
@@ -64,12 +64,12 @@ using TrajectoryPoints = std::vector<TrajectoryPoint>;
6464
using autoware_adapi_v1_msgs::msg::OperationModeState;
6565
using autoware_internal_debug_msgs::msg::Float32Stamped;
6666
using autoware_internal_debug_msgs::msg::Float64Stamped;
67+
using autoware_internal_planning_msgs::msg::VelocityLimit; // temporary
6768
using autoware_utils::DiagnosticsInterface;
6869
using geometry_msgs::msg::AccelWithCovarianceStamped;
6970
using geometry_msgs::msg::Pose;
7071
using geometry_msgs::msg::PoseStamped;
7172
using nav_msgs::msg::Odometry;
72-
using autoware_internal_planning_msgs::msg::VelocityLimit; // temporary
7373
using visualization_msgs::msg::MarkerArray;
7474

7575
struct Motion

planning/behavior_path_planner/autoware_behavior_path_planner_common/include/autoware/behavior_path_planner_common/data_manager.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -65,8 +65,8 @@ using nav_msgs::msg::OccupancyGrid;
6565
using nav_msgs::msg::Odometry;
6666
using tier4_planning_msgs::msg::LateralOffset;
6767
using PlanResult = PathWithLaneId::SharedPtr;
68-
using lanelet::TrafficLight;
6968
using autoware_internal_planning_msgs::msg::VelocityLimit;
69+
using lanelet::TrafficLight;
7070
using unique_identifier_msgs::msg::UUID;
7171

7272
struct TrafficSignalStamped

planning/behavior_velocity_planner/autoware_behavior_velocity_planner/include/autoware/behavior_velocity_planner/node.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -44,8 +44,8 @@
4444

4545
namespace autoware::behavior_velocity_planner
4646
{
47-
using autoware_map_msgs::msg::LaneletMapBin;
4847
using autoware_internal_planning_msgs::msg::VelocityLimit;
48+
using autoware_map_msgs::msg::LaneletMapBin;
4949

5050
class BehaviorVelocityPlannerNode : public rclcpp::Node
5151
{

planning/behavior_velocity_planner/autoware_behavior_velocity_planner_common/include/autoware/behavior_velocity_planner_common/planner_data.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -20,6 +20,7 @@
2020
#include "autoware/velocity_smoother/smoother/smoother_base.hpp"
2121
#include "autoware_vehicle_info_utils/vehicle_info_utils.hpp"
2222

23+
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
2324
#include <autoware_map_msgs/msg/lanelet_map_bin.hpp>
2425
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
2526
#include <autoware_perception_msgs/msg/traffic_light_group_array.hpp>
@@ -29,7 +30,6 @@
2930
#include <nav_msgs/msg/occupancy_grid.hpp>
3031
#include <sensor_msgs/msg/point_cloud2.hpp>
3132
#include <std_msgs/msg/header.hpp>
32-
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
3333

3434
#include <pcl/point_cloud.h>
3535
#include <pcl/point_types.h>

planning/motion_velocity_planner/autoware_motion_velocity_planner_node_universe/src/node.hpp

+4-4
Original file line numberDiff line numberDiff line change
@@ -26,15 +26,15 @@
2626
#include <rclcpp/rclcpp.hpp>
2727

2828
#include <autoware_internal_debug_msgs/msg/float64_stamped.hpp>
29+
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
30+
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
2931
#include <autoware_map_msgs/msg/lanelet_map_bin.hpp>
3032
#include <autoware_perception_msgs/msg/predicted_objects.hpp>
3133
#include <autoware_perception_msgs/msg/traffic_signal_array.hpp>
3234
#include <autoware_planning_msgs/msg/trajectory.hpp>
3335
#include <nav_msgs/msg/occupancy_grid.hpp>
3436
#include <nav_msgs/msg/odometry.hpp>
3537
#include <sensor_msgs/msg/point_cloud2.hpp>
36-
#include <autoware_internal_planning_msgs/msg/velocity_limit.hpp>
37-
#include <autoware_internal_planning_msgs/msg/velocity_limit_clear_command.hpp>
3838
#include <visualization_msgs/msg/marker_array.hpp>
3939

4040
#include <tf2_ros/buffer.h>
@@ -48,12 +48,12 @@
4848

4949
namespace autoware::motion_velocity_planner
5050
{
51+
using autoware_internal_planning_msgs::msg::VelocityLimit;
52+
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
5153
using autoware_map_msgs::msg::LaneletMapBin;
5254
using autoware_motion_velocity_planner_node_universe::srv::LoadPlugin;
5355
using autoware_motion_velocity_planner_node_universe::srv::UnloadPlugin;
5456
using autoware_planning_msgs::msg::Trajectory;
55-
using autoware_internal_planning_msgs::msg::VelocityLimit;
56-
using autoware_internal_planning_msgs::msg::VelocityLimitClearCommand;
5757
using TrajectoryPoints = std::vector<autoware_planning_msgs::msg::TrajectoryPoint>;
5858

5959
class MotionVelocityPlannerNode : public rclcpp::Node

system/autoware_mrm_comfortable_stop_operator/README.md

+3-3
Original file line numberDiff line numberDiff line change
@@ -16,9 +16,9 @@ MRM comfortable stop operator is a node that generates comfortable stop commands
1616

1717
### Output
1818

19-
| Name | Type | Description |
20-
| -------------------------------------- | ----------------------------------------------------- | ---------------------------- |
21-
| `~/output/mrm/comfortable_stop/status` | `tier4_system_msgs::msg::MrmBehaviorStatus` | MRM execution status |
19+
| Name | Type | Description |
20+
| -------------------------------------- | ----------------------------------------------------------------- | ---------------------------- |
21+
| `~/output/mrm/comfortable_stop/status` | `tier4_system_msgs::msg::MrmBehaviorStatus` | MRM execution status |
2222
| `~/output/velocity_limit` | `autoware_internal_planning_msgs::msg::VelocityLimit` | Velocity limit command |
2323
| `~/output/velocity_limit/clear` | `autoware_internal_planning_msgs::msg::VelocityLimitClearCommand` | Velocity limit clear command |
2424

system/autoware_mrm_comfortable_stop_operator/include/autoware/mrm_comfortable_stop_operator/mrm_comfortable_stop_operator_core.hpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -61,7 +61,8 @@ class MrmComfortableStopOperator : public rclcpp::Node
6161

6262
// Publisher
6363
rclcpp::Publisher<tier4_system_msgs::msg::MrmBehaviorStatus>::SharedPtr pub_status_;
64-
rclcpp::Publisher<autoware_internal_planning_msgs::msg::VelocityLimit>::SharedPtr pub_velocity_limit_;
64+
rclcpp::Publisher<autoware_internal_planning_msgs::msg::VelocityLimit>::SharedPtr
65+
pub_velocity_limit_;
6566
rclcpp::Publisher<autoware_internal_planning_msgs::msg::VelocityLimitClearCommand>::SharedPtr
6667
pub_velocity_limit_clear_command_;
6768

system/autoware_mrm_comfortable_stop_operator/src/mrm_comfortable_stop_operator/mrm_comfortable_stop_operator_core.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -110,7 +110,8 @@ void MrmComfortableStopOperator::publishVelocityLimit() const
110110

111111
void MrmComfortableStopOperator::publishVelocityLimitClearCommand() const
112112
{
113-
auto velocity_limit_clear_command = autoware_internal_planning_msgs::msg::VelocityLimitClearCommand();
113+
auto velocity_limit_clear_command =
114+
autoware_internal_planning_msgs::msg::VelocityLimitClearCommand();
114115
velocity_limit_clear_command.stamp = this->now();
115116
velocity_limit_clear_command.command = true;
116117
velocity_limit_clear_command.sender = "mrm_comfortable_stop_operator";

visualization/autoware_overlay_rviz_plugin/autoware_overlay_rviz_plugin/README.md

+1-1
Original file line numberDiff line numberDiff line change
@@ -20,7 +20,7 @@ This plugin provides a visual and easy-to-understand display of vehicle speed, t
2020
| `/vehicle/status/hazard_status` | `autoware_vehicle_msgs::msg::HazardReport` | The topic is status of hazard |
2121
| `/vehicle/status/steering_status` | `autoware_vehicle_msgs::msg::SteeringReport` | The topic is status of steering |
2222
| `/vehicle/status/gear_status` | `autoware_vehicle_msgs::msg::GearReport` | The topic is status of gear |
23-
| `/planning/scenario_planning/current_max_velocity` | `autoware_internal_planning_msgs::msg::VelocityLimit` | The topic is velocity limit |
23+
| `/planning/scenario_planning/current_max_velocity` | `autoware_internal_planning_msgs::msg::VelocityLimit` | The topic is velocity limit |
2424
| `/perception/traffic_light_recognition/traffic_signals` | `autoware_perception_msgs::msg::TrafficLightGroupArray` | The topic is status of traffic light |
2525

2626
## Parameter

0 commit comments

Comments
 (0)