Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_motion_velocity_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.4.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_core.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-10-23 |
Dev Status | DEVELOPED |
Released | RELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Maxime Clement
- Alqudah Mohammad
- Yutaka Kondo
Authors
- Maxime Clement
Motion Velocity Planner
Overview
motion_velocity_planner
is a planner to adjust the trajectory velocity based on the obstacles around the vehicle.
It loads modules as plugins. Please refer to the links listed below for detail on each module.
Each module calculates stop and slow down points to be inserted in the ego trajectory.
These points are assumed to correspond to the base_link
frame of the ego vehicle as it follows the trajectory.
This means that to stop before a wall, a stop point is inserted in the trajectory at a distance ahead of the wall equal to the vehicle front offset (wheelbase + front overhang, see the vehicle dimensions.
Input topics
Name | Type | Description |
---|---|---|
~/input/trajectory |
autoware_planning_msgs::msg::Trajectory | input trajectory |
~/input/vector_map |
autoware_map_msgs::msg::LaneletMapBin | vector map |
~/input/vehicle_odometry |
nav_msgs::msg::Odometry | vehicle position and velocity |
~/input/accel |
geometry_msgs::msg::AccelWithCovarianceStamped | vehicle acceleration |
~/input/dynamic_objects |
autoware_perception_msgs::msg::PredictedObjects | dynamic objects |
~/input/no_ground_pointcloud |
sensor_msgs::msg::PointCloud2 | obstacle pointcloud |
~/input/traffic_signals |
autoware_perception_msgs::msg::TrafficLightGroupArray | traffic light states |
~/input/occupancy_grid |
nav_msgs::msg::OccupancyGrid | occupancy grid |
Output topics
Name | Type | Description |
---|---|---|
~/output/trajectory |
autoware_planning_msgs::msg::Trajectory | Ego trajectory with updated velocity profile |
~/output/planning_factors/<MODULE_NAME> |
autoware_internal_planning_msgs::msg::PlanningFactorsArray | factors causing change in the ego velocity profile |
Services
Name | Type | Description |
---|---|---|
~/service/load_plugin |
autoware_motion_velocity_planner::srv::LoadPlugin | To request loading a plugin |
~/service/unload_plugin |
autoware_motion_velocity_planner::srv::UnloadPlugin | To request unloaded a plugin |
Node parameters
Parameter | Type | Description |
---|---|---|
launch_modules |
vector<string> | module names to launch |
In addition, the following parameters should be provided to the node:
- nearest search parameters;
- vehicle info parameters;
- common planning parameters;
- smoother parameters
- Parameters of each plugin that will be loaded.
Changelog for package autoware_motion_velocity_planner
1.1.0 (2025-05-01)
1.4.0 (2025-08-11)
-
Merge remote-tracking branch 'origin/main' into humble
-
feat(motion_velocity_planner, motion_velocity_planner_common): update pointcloud preprocess design (#591)
* updare pcl preprocess ---------
-
chore(motion_velocity_planner, behavior_velocity_planner): unifiy module load srv (#585) port srv
-
refactor(motion_velocity_planner): restrict copy of planner_data (#587)
* restrict plannar data copy ---------
-
chore: bump version to 1.3.0 (#554)
-
Contributors: Ryohsuke Mitsudome, Yuki TAKAGI
1.3.0 (2025-06-23)
-
fix: to be consistent version in all package.xml(s)
-
feat(motion_velocity_planner_node): update pcl coordinate transformation (#519)
- update pcl coordinate transformation
* add canTransform check ---------
-
feat(autoware_motion_velocity_planner)!: only wait for the required subscriptions (#505) Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
fix: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
-
fix(autoware_motion_velocity_planner): fix deprecated autoware_utils header (#444)
-
feat(autoware_motion_velocity_planner): point-cloud clustering optimization (#409)
- Core changes for point-cloud maksing and clustering
- fix
- style(pre-commit): autofix
* Update planning/motion_velocity_planner/autoware_motion_velocity_planner_common/include/autoware/motion_velocity_planner_common/planner_data.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
* fix
Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
-
Contributors: Arjun Jagdish Ram, Masaki Baba, Ryohsuke Mitsudome, Tim Clephas, Yuki TAKAGI, Yutaka Kondo, github-actions
1.0.0 (2025-03-31)
-
chore: update version in package.xml
-
feat: autoware_motion_velocity_planner and autoware_motion_velocity_planner_common to core (#242)
- feat: modify autoware_universe_utils to autoware_utils
- feat: remove useless dependecy
- style(pre-commit): autofix
- feat: modify autoware_universe_utils to autoware_utils
- feat: autoware_motion_velocity_planner_node to core
- style(pre-commit): autofix
- feat: autoware_motion_velocity_planner_node to core
- feat: modify autoware_universe_utils to autoware_utils
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
libboost-dev |
Dependant Packages
Name | Deps |
---|---|
autoware_core_planning |
Launch files
- launch/motion_velocity_planner.launch.xml
-
- common_param_path
- vehicle_param_file
- nearest_search_param_path
- motion_velocity_planner_launch_modules
- motion_velocity_config_path
- motion_velocity_planner_param_path
- motion_velocity_planner_param_file [default: $(find-pkg-share autoware_motion_velocity_planner)/config/motion_velocity_planner.param.yaml]