Skip to content

Commit 993e048

Browse files
committed
feat: update package.xml
Signed-off-by: Ryohsuke Mitsudome <ryohsuke.mitsudome@tier4.jp>
1 parent b22b47a commit 993e048

File tree

15 files changed

+14
-14
lines changed

15 files changed

+14
-14
lines changed

planning/autoware_external_velocity_limit_selector/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -18,10 +18,10 @@
1818
<buildtool_depend>autoware_cmake</buildtool_depend>
1919

2020
<depend>autoware_internal_debug_msgs</depend>
21+
<depend>autoware_internal_planning_msgs</depend>
2122
<depend>generate_parameter_library</depend>
2223
<depend>rclcpp</depend>
2324
<depend>rclcpp_components</depend>
24-
<depend>tier4_planning_msgs</depend>
2525

2626
<exec_depend>ros2cli</exec_depend>
2727
<exec_depend>topic_tools</exec_depend>

planning/autoware_external_velocity_limit_selector/test/test_external_velocity_limit_selector_node_launch.py

+2-2
Original file line numberDiff line numberDiff line change
@@ -30,8 +30,8 @@
3030
from rcl_interfaces.srv import SetParameters
3131
import rclpy
3232
import rclpy.qos
33-
from tier4_planning_msgs.msg import VelocityLimit
34-
from tier4_planning_msgs.msg import VelocityLimitClearCommand
33+
from autoware_internal_planning_msgs.msg import VelocityLimit
34+
from autoware_internal_planning_msgs.msg import VelocityLimitClearCommand
3535

3636
logger = get_logger(__name__)
3737

planning/autoware_remaining_distance_time_calculator/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -12,6 +12,7 @@
1212
<buildtool_depend>autoware_cmake</buildtool_depend>
1313

1414
<depend>autoware_internal_msgs</depend>
15+
<depend>autoware_internal_planning_msgs</depend>
1516
<depend>autoware_lanelet2_extension</depend>
1617
<depend>autoware_motion_utils</depend>
1718
<depend>autoware_planning_msgs</depend>
@@ -24,7 +25,6 @@
2425
<depend>rclcpp</depend>
2526
<depend>rclcpp_components</depend>
2627
<depend>std_msgs</depend>
27-
<depend>tier4_planning_msgs</depend>
2828

2929
<test_depend>ament_cmake_ros</test_depend>
3030
<test_depend>ament_lint_auto</test_depend>

planning/autoware_velocity_smoother/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -22,6 +22,7 @@
2222
<buildtool_depend>eigen3_cmake_module</buildtool_depend>
2323

2424
<depend>autoware_internal_debug_msgs</depend>
25+
<depend>autoware_internal_planning_msgs</depend>
2526
<depend>autoware_interpolation</depend>
2627
<depend>autoware_motion_utils</depend>
2728
<depend>autoware_osqp_interface</depend>
@@ -35,7 +36,6 @@
3536
<depend>rclcpp</depend>
3637
<depend>tf2</depend>
3738
<depend>tf2_ros</depend>
38-
<depend>tier4_planning_msgs</depend>
3939

4040
<test_depend>ament_cmake_ros</test_depend>
4141
<test_depend>ament_lint_auto</test_depend>

planning/behavior_path_planner/autoware_behavior_path_planner/package.xml

+1
Original file line numberDiff line numberDiff line change
@@ -41,6 +41,7 @@
4141
<depend>autoware_freespace_planning_algorithms</depend>
4242
<depend>autoware_frenet_planner</depend>
4343
<depend>autoware_internal_debug_msgs</depend>
44+
<depend>autoware_internal_planning_msgs</depend>
4445
<depend>autoware_interpolation</depend>
4546
<depend>autoware_lane_departure_checker</depend>
4647
<depend>autoware_lanelet2_extension</depend>

planning/behavior_velocity_planner/autoware_behavior_velocity_planner/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -34,6 +34,7 @@
3434

3535
<depend>autoware_behavior_velocity_planner_common</depend>
3636
<depend>autoware_internal_debug_msgs</depend>
37+
<depend>autoware_internal_planning_msgs</depend>
3738
<depend>autoware_lanelet2_extension</depend>
3839
<depend>autoware_map_msgs</depend>
3940
<depend>autoware_motion_utils</depend>
@@ -55,7 +56,6 @@
5556
<depend>tf2_eigen</depend>
5657
<depend>tf2_geometry_msgs</depend>
5758
<depend>tf2_ros</depend>
58-
<depend>tier4_planning_msgs</depend>
5959
<depend>visualization_msgs</depend>
6060

6161
<test_depend>ament_cmake_ros</test_depend>

planning/behavior_velocity_planner/autoware_behavior_velocity_planner_common/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -21,6 +21,7 @@
2121

2222
<depend>autoware_adapi_v1_msgs</depend>
2323
<depend>autoware_internal_debug_msgs</depend>
24+
<depend>autoware_internal_planning_msgs</depend>
2425
<depend>autoware_interpolation</depend>
2526
<depend>autoware_lanelet2_extension</depend>
2627
<depend>autoware_map_msgs</depend>
@@ -45,7 +46,6 @@
4546
<depend>tf2_eigen</depend>
4647
<depend>tf2_geometry_msgs</depend>
4748
<depend>tf2_ros</depend>
48-
<depend>tier4_planning_msgs</depend>
4949
<depend>visualization_msgs</depend>
5050

5151
<test_depend>ament_cmake_ros</test_depend>

planning/motion_velocity_planner/autoware_motion_velocity_obstacle_cruise_module/package.xml

-1
Original file line numberDiff line numberDiff line change
@@ -29,7 +29,6 @@
2929
<depend>rclcpp</depend>
3030
<depend>tf2</depend>
3131
<depend>tier4_metric_msgs</depend>
32-
<depend>tier4_planning_msgs</depend>
3332
<depend>visualization_msgs</depend>
3433

3534
<test_depend>ament_cmake_ros</test_depend>

planning/motion_velocity_planner/autoware_motion_velocity_obstacle_slow_down_module/package.xml

-1
Original file line numberDiff line numberDiff line change
@@ -28,7 +28,6 @@
2828
<depend>rclcpp</depend>
2929
<depend>tf2</depend>
3030
<depend>tier4_metric_msgs</depend>
31-
<depend>tier4_planning_msgs</depend>
3231
<depend>visualization_msgs</depend>
3332

3433
<test_depend>ament_cmake_ros</test_depend>

planning/motion_velocity_planner/autoware_motion_velocity_planner_node_universe/package.xml

+1
Original file line numberDiff line numberDiff line change
@@ -19,6 +19,7 @@
1919
<build_depend>rosidl_default_generators</build_depend>
2020

2121
<depend>autoware_internal_debug_msgs</depend>
22+
<depend>autoware_internal_planning_msgs</depend>
2223
<depend>autoware_map_msgs</depend>
2324
<depend>autoware_motion_utils</depend>
2425
<depend>autoware_motion_velocity_planner_common_universe</depend>

system/autoware_mrm_comfortable_stop_operator/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -13,12 +13,12 @@
1313
<buildtool_depend>autoware_cmake</buildtool_depend>
1414

1515
<depend>autoware_adapi_v1_msgs</depend>
16+
<depend>autoware_internal_planning_msgs</depend>
1617
<depend>autoware_utils</depend>
1718
<depend>rclcpp</depend>
1819
<depend>rclcpp_components</depend>
1920
<depend>std_msgs</depend>
2021
<depend>std_srvs</depend>
21-
<depend>tier4_planning_msgs</depend>
2222
<depend>tier4_system_msgs</depend>
2323

2424
<test_depend>ament_lint_auto</test_depend>

visualization/autoware_overlay_rviz_plugin/autoware_overlay_rviz_plugin/CMakeLists.txt

+1-1
Original file line numberDiff line numberDiff line change
@@ -69,7 +69,7 @@ ament_target_dependencies(${PROJECT_NAME} PUBLIC
6969
rviz_common
7070
rviz_rendering
7171
autoware_vehicle_msgs
72-
tier4_planning_msgs
72+
autoware_internal_planning_msgs
7373
autoware_perception_msgs
7474
)
7575

visualization/autoware_overlay_rviz_plugin/autoware_overlay_rviz_plugin/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -12,13 +12,13 @@
1212
<license>BSD-3-Clause</license>
1313

1414
<depend>ament_index_cpp</depend>
15+
<depend>autoware_internal_planning_msgs</depend>
1516
<depend>autoware_perception_msgs</depend>
1617
<depend>autoware_vehicle_msgs</depend>
1718
<depend>boost</depend>
1819
<depend>rviz_common</depend>
1920
<depend>rviz_ogre_vendor</depend>
2021
<depend>rviz_rendering</depend>
21-
<depend>tier4_planning_msgs</depend>
2222

2323
<test_depend>ament_lint_auto</test_depend>
2424
<test_depend>autoware_lint_common</test_depend>

visualization/tier4_planning_rviz_plugin/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -11,6 +11,7 @@
1111
<buildtool_depend>ament_cmake</buildtool_depend>
1212
<buildtool_depend>autoware_cmake</buildtool_depend>
1313

14+
<depend>autoware_internal_planning_msgs</depend>
1415
<depend>autoware_motion_utils</depend>
1516
<depend>autoware_planning_msgs</depend>
1617
<depend>autoware_utils</depend>
@@ -25,7 +26,6 @@
2526
<depend>rviz_rendering</depend>
2627
<depend>tf2_geometry_msgs</depend>
2728
<depend>tf2_ros</depend>
28-
<depend>tier4_planning_msgs</depend>
2929

3030
<test_depend>ament_lint_auto</test_depend>
3131
<test_depend>autoware_lint_common</test_depend>

visualization/tier4_state_rviz_plugin/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -14,6 +14,7 @@
1414

1515
<depend>ament_index_cpp</depend>
1616
<depend>autoware_adapi_v1_msgs</depend>
17+
<depend>autoware_internal_planning_msgs</depend>
1718
<depend>autoware_motion_utils</depend>
1819
<depend>autoware_vehicle_msgs</depend>
1920
<depend>libqt5-core</depend>
@@ -24,7 +25,6 @@
2425
<depend>rviz_common</depend>
2526
<depend>tier4_control_msgs</depend>
2627
<depend>tier4_external_api_msgs</depend>
27-
<depend>tier4_planning_msgs</depend>
2828

2929
<test_depend>ament_lint_auto</test_depend>
3030
<test_depend>autoware_lint_common</test_depend>

0 commit comments

Comments
 (0)