Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged autoware_simple_planning_simulator at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.47.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-08-16 |
Dev Status | UNKNOWN |
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
- Takamasa Horibe
- Tomoya Kimura
- Maxime Clement
- Mamoru Sobue
- Zulfaqar Azmi
- Temkei Kem
- Junya Sasaki
- Kotaro Yoshimoto
Authors
autoware_simple_planning_simulator
Purpose / Use cases
This node simulates the vehicle motion for a vehicle command in 2D using a simple vehicle model.
Design
The purpose of this simulator is for the integration test of planning and control modules. This does not simulate sensing or perception, but is implemented in pure c++ only and works without GPU.
Assumptions / Known limits
- It simulates only in 2D motion.
- It does not perform physical operations such as collision and sensing, but only calculates the integral results of vehicle dynamics.
Inputs / Outputs / API
input
- input/initialpose [
geometry_msgs/msg/PoseWithCovarianceStamped
] : for initial pose - input/ackermann_control_command [
autoware_control_msgs/msg/Control
] : target command to drive a vehicle - input/manual_ackermann_control_command [
autoware_control_msgs/msg/Control
] : manual target command to drive a vehicle (used when control_mode_request = Manual) - input/gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command. - input/manual_gear_command [
autoware_vehicle_msgs/msg/GearCommand
] : target gear command (used when control_mode_request = Manual) - input/turn_indicators_command [
autoware_vehicle_msgs/msg/TurnIndicatorsCommand
] : target turn indicator command - input/hazard_lights_command [
autoware_vehicle_msgs/msg/HazardLightsCommand
] : target hazard lights command - input/control_mode_request [
tier4_vehicle_msgs::srv::ControlModeRequest
] : mode change for Auto/Manual driving
output
- /tf [
tf2_msgs/msg/TFMessage
] : simulated vehicle pose (base_link) - /output/odometry [
nav_msgs/msg/Odometry
] : simulated vehicle pose and twist - /output/steering [
autoware_vehicle_msgs/msg/SteeringReport
] : simulated steering angle - /output/control_mode_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : current control mode (Auto/Manual) - /output/gear_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated gear - /output/turn_indicators_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated turn indicator status - /output/hazard_lights_report [
autoware_vehicle_msgs/msg/ControlModeReport
] : simulated hazard lights status
Inner-workings / Algorithms
Common Parameters
Name | Type | Description | Default value |
---|---|---|---|
simulated_frame_id | string | set to the child_frame_id in output tf | “base_link” |
origin_frame_id | string | set to the frame_id in output tf | “odom” |
initialize_source | string | If “ORIGIN”, the initial pose is set at (0,0,0). If “INITIAL_POSE_TOPIC”, node will wait until the input/initialpose topic is published. |
“INITIAL_POSE_TOPIC” |
add_measurement_noise | bool | If true, the Gaussian noise is added to the simulated results. | true |
pos_noise_stddev | double | Standard deviation for position noise | 0.01 |
rpy_noise_stddev | double | Standard deviation for Euler angle noise | 0.0001 |
vel_noise_stddev | double | Standard deviation for longitudinal velocity noise | 0.0 |
angvel_noise_stddev | double | Standard deviation for angular velocity noise | 0.0 |
steer_noise_stddev | double | Standard deviation for steering angle noise | 0.0001 |
Vehicle Model Parameters
vehicle_model_type options
IDEAL_STEER_VEL
IDEAL_STEER_ACC
IDEAL_STEER_ACC_GEARED
DELAY_STEER_VEL
DELAY_STEER_ACC
DELAY_STEER_ACC_GEARED
DELAY_STEER_ACC_GEARED_WO_FALL_GUARD
-
DELAY_STEER_MAP_ACC_GEARED
: applies 1D dynamics and time delay to the steering and acceleration commands. The simulated acceleration is determined by a value converted through the provided acceleration map. This model is valuable for an accurate simulation with acceleration deviations in a real vehicle. -
LEARNED_STEER_VEL
: launches learned python models. More about this here.
The following models receive ACTUATION_CMD
generated from raw_vehicle_cmd_converter
. Therefore, when these models are selected, the raw_vehicle_cmd_converter
is also launched.
-
ACTUATION_CMD
: This model only converts accel/brake commands and use steer command as it is. -
ACTUATION_CMD_STEER_MAP
: The steer command is converted to the steer rate command using the steer map. -
ACTUATION_CMD_VGR
: The steer command is converted to the steer rate command using the variable gear ratio. -
ACTUATION_CMD_MECHANICAL
: This model has mechanical dynamics and controller for that.
The IDEAL
model moves ideally as commanded, while the DELAY
model moves based on a 1st-order with time delay model. The STEER
means the model receives the steer command. The VEL
means the model receives the target velocity command, while the ACC
model receives the target acceleration command. The GEARED
suffix means that the motion will consider the gear command: the vehicle moves only one direction following the gear.
The table below shows which models correspond to what parameters. The model names are written in abbreviated form (e.g. IDEAL_STEER_VEL = I_ST_V).
Name | Type | Description | I_ST_V | I_ST_A | I_ST_A_G | D_ST_V | D_ST_A | D_ST_A_G | D_ST_A_G_WO_FG | D_ST_M_ACC_G | L_S_V | A_C | Default value | unit |
---|---|---|---|---|---|---|---|---|---|---|---|---|---|---|
acc_time_delay | double | dead time for the acceleration input | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_delay | double | dead time for the steering input | x | x | x | o | o | o | o | o | x | o | 0.24 | [s] |
vel_time_delay | double | dead time for the velocity input | x | x | x | o | x | x | x | x | x | x | 0.25 | [s] |
acc_time_constant | double | time constant of the 1st-order acceleration dynamics | x | x | x | x | o | o | o | o | x | x | 0.1 | [s] |
steer_time_constant | double | time constant of the 1st-order steering dynamics | x | x | x | o | o | o | o | o | x | o | 0.27 | [s] |
steer_dead_band | double | dead band for steering angle | x | x | x | o | o | o | o | x | x | o | 0.0 | [rad] |
vel_time_constant | double | time constant of the 1st-order velocity dynamics | x | x | x | o | x | x | x | x | x | x | 0.5 | [s] |
vel_lim | double | limit of velocity | x | x | x | o | o | o | o | o | x | x | 50.0 | [m/s] |
vel_rate_lim | double | limit of acceleration | x | x | x | o | o | o | o | o | x | x | 7.0 | [m/ss] |
steer_lim | double | limit of steering angle | x | x | x | o | o | o | o | o | x | o | 1.0 | [rad] |
steer_rate_lim | double | limit of steering angle change rate | x | x | x | o | o | o | o | o | x | o | 5.0 | [rad/s] |
steer_bias | double | bias for steering angle | x | x | x | o | o | o | o | o | x | o | 0.0 | [rad] |
debug_acc_scaling_factor | double | scaling factor for accel command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
debug_steer_scaling_factor | double | scaling factor for steer command | x | x | x | x | o | o | o | x | x | x | 1.0 | [-] |
acceleration_map_path | string | path to csv file for acceleration map which converts velocity and ideal acceleration to actual acceleration | x | x | x | x | x | x | x | o | x | x | - | [-] |
model_module_paths | string | path to a python module where the model is implemented | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_param_paths | string | path to the file where model parameters are stored (can be empty string if no parameter file is required) | x | x | x | x | x | x | x | x | o | x | - | [-] |
model_class_names | string | name of the class that implements the model | x | x | x | x | x | x | x | x | o | x | - | [-] |
File truncated at 100 lines see the full file
Changelog for package autoware_simple_planning_simulator
0.47.0 (2025-08-11)
-
feat: change planning output topic name to /planning/trajectory (#11135)
- change planning output topic name to /planning/trajectory
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
-
Contributors: Yukihiro Saito
0.46.0 (2025-06-20)
- Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
- fix(autoware_simple_planning_simulator ): fix deprecated autoware_utils header (#10520)
- Contributors: Kazusa Hashimoto, TaikiYamada4
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
-
Merge remote-tracking branch 'origin/main' into humble
-
fix(simple_planning_simulator): fix a small turn_signal bug (#10386)
- fix turn bug
* pre-commit ---------
-
Contributors: Kem (TiankuiXian), Ryohsuke Mitsudome
0.43.0 (2025-03-21)
- Merge remote-tracking branch 'origin/main' into chore/bump-version-0.43
- chore: rename from [autoware.universe]{.title-ref} to [autoware_universe]{.title-ref} (#10306)
- Contributors: Hayato Mizushima, Yutaka Kondo
0.42.0 (2025-03-03)
- Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
- feat(autoware_utils): replace autoware_universe_utils with autoware_utils (#10191)
- Contributors: Fumiya Watanabe, 心刚
0.41.2 (2025-02-19)
- chore: bump version to 0.41.1 (#10088)
- Contributors: Ryohsuke Mitsudome
0.41.1 (2025-02-10)
0.41.0 (2025-01-29)
-
Merge remote-tracking branch 'origin/main' into tmp/bot/bump_version_base
-
feat: apply [autoware_]{.title-ref} prefix for [learning_based_vehicle_model]{.title-ref} (#9991)
-
feat: apply [autoware_]{.title-ref} prefix for [simple_planning_simulator]{.title-ref} (#9995)
* feat(simple_planning_simulator): apply [autoware_]{.title-ref} prefix (see below): Note:
* In this commit, I did not organize a folder structure. The folder structure will be organized in the next some commits.
- The changes will follow the Autoware's guideline as below:
- https://autowarefoundation.github.io/autoware-documentation/main/contributing/coding-guidelines/ros-nodes/directory-structure/#package-folder
- rename(simple_planning_simulator): move headers under `include/autoware`:
- Fixes due to this changes for .hpp/.cpp files will be applied in the next commit
- fix(simple_planning_simulator): fix include header paths
- To follow the previous commit
- rename: [simple_planning_simulator]{.title-ref} => [autoware_simple_planning_simulator]{.title-ref}
- bug(autoware_simple_planning_simulator): fix missing changes
- style(pre-commit): autofix
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_simulator_launch |