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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
Messages
Services
Plugins
Recent questions tagged autoware_freespace_planner 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
- Kosuke Takeuchi
- Takamasa Horibe
- Takayuki Murooka
Authors
- Akihito OHSATO
- Tomohito ANDO
The autoware_freespace_planner
freespace_planner_node
freespace_planner_node
is a global path planner node that plans trajectory
in the space having static/dynamic obstacles. This node is currently based on
Hybrid A* search algorithm in freespace_planning_algorithms
package.
Other algorithms such as rrt* will be also added and selectable in the future.
Note Due to the constraint of trajectory following, the output trajectory will be split to include only the single direction path. In other words, the output trajectory doesn’t include both forward and backward trajectories at once.
Input topics
Name | Type | Description |
---|---|---|
~input/route |
autoware_planning_msgs::Route | route and goal pose |
~input/occupancy_grid |
nav_msgs::OccupancyGrid | costmap, for drivable areas |
~input/odometry |
nav_msgs::Odometry | vehicle velocity, for checking whether vehicle is stopped |
~input/scenario |
tier4_planning_msgs::Scenario | scenarios to be activated, for node activation |
Output topics
Name | Type | Description |
---|---|---|
~output/trajectory |
autoware_planning_msgs::Trajectory | trajectory to be followed |
is_completed |
bool (implemented as rosparam) | whether all split trajectory are published |
Output TFs
None
How to launch
- Write your remapping info in
freespace_planner.launch
or add args when executingroslaunch
roslaunch freespace_planner freespace_planner.launch
Parameters
{{json_to_markdown(“planning/autoware_freespace_planner/schema/freespace_planner.schema.json”)}}
Node parameters
Parameter | Type | Description |
---|---|---|
planning_algorithms |
string | algorithms used in the node |
vehicle_shape_margin_m |
float | collision margin in planning algorithm |
update_rate |
double | timer’s update rate |
waypoints_velocity |
double | velocity in output trajectory (currently, only constant velocity is supported) |
th_arrived_distance_m |
double | threshold distance to check if vehicle has arrived at the trajectory’s endpoint |
th_stopped_time_sec |
double | threshold time to check if vehicle is stopped |
th_stopped_velocity_mps |
double | threshold velocity to check if vehicle is stopped |
th_course_out_distance_m |
double | threshold distance to check if vehicle is out of course |
th_obstacle_time_sec |
double | threshold time to check if obstacle is on the trajectory |
vehicle_shape_margin_m |
double | vehicle margin |
replan_when_obstacle_found |
bool | whether replanning when obstacle has found on the trajectory |
replan_when_course_out |
bool | whether replanning when vehicle is out of course |
Planner common parameters
Parameter | Type | Description |
---|---|---|
time_limit |
double | time limit of planning |
maximum_turning_ratio |
double | max ratio of actual turning range to use |
turning_steps |
double | number of turning steps within turning range |
theta_size |
double | the number of angle’s discretization |
lateral_goal_range |
double | goal range of lateral position |
longitudinal_goal_range |
double | goal range of longitudinal position |
angle_goal_range |
double | goal range of angle |
curve_weight |
double | additional cost factor for curve actions |
reverse_weight |
double | additional cost factor for reverse actions |
direction_change_weight |
double | additional cost factor for switching direction |
obstacle_threshold |
double | threshold for regarding a certain grid as obstacle |
A* search parameters
Parameter | Type | Description |
---|---|---|
search_method |
string | method of searching, start to goal or vice versa |
only_behind_solutions |
bool | whether restricting the solutions to be behind the goal |
use_back |
bool | whether using backward trajectory |
adapt_expansion_distance |
bool | if true, adapt expansion distance based on environment |
expansion_distance |
double | length of expansion for node transitions |
near_goal_distance |
double | near goal distance threshold |
distance_heuristic_weight |
double | heuristic weight for estimating node’s cost |
smoothness_weight |
double | cost factor for change in curvature |
obstacle_distance_weight |
double | cost factor for distance to obstacle |
goal_lat_distance_weight |
double | cost factor for lateral distance from goal |
RRT* search parameters
Parameter | Type | Description |
---|---|---|
max planning time |
double | maximum planning time [msec] (used only when enable_update is set true ) |
enable_update |
bool | whether update after feasible solution found until max_planning time elapse |
use_informed_sampling |
bool | Use informed RRT* (of Gammell et al.) |
neighbor_radius |
double | neighbor radius of RRT* algorithm |
File truncated at 100 lines see the full file
Changelog for package autoware_freespace_planner
0.47.0 (2025-08-11)
0.46.0 (2025-06-20)
0.45.0 (2025-05-22)
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
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)
-
feat: adaption to ROS nodes guidelines about directory structure (#10268)
-
fix(planning): add missing exec_depend (#10134)
- fix(planning): add missing exec_depend
- fix find-pkg-share
* fix find-pkg-share ---------
-
Contributors: Hayato Mizushima, NorahXiong, Takagi, Isamu, 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)
-
feat!: replace scenario msg from tier4_planning_msgs to autoware_internal_planning_msgs (#10180)
-
fix: add missing includes to autoware_universe_utils (#10091)
-
feat(planning_test_manager): abstract message-specific functions (#9882)
- abstract message-specific functions
- include necessary header
- adapt velocity_smoother to new test manager
- adapt behavior_velocity_planner to new test manager
- adapt path_optimizer to new test manager
- fix output subscription
- adapt behavior_path_planner to new test manager
- adapt scenario_selector to new test manager
- adapt freespace_planner to new test manager
- adapt planning_validator to new test manager
- adapt obstacle_stop_planner to new test manager
- adapt obstacle_cruise_planner to new test manager
- disable test for freespace_planner
- adapt behavior_velocity_crosswalk_module to new test manager
- adapt behavior_path_lane_change_module to new test manager
- adapt behavior_path_avoidance_by_lane_change_module to new test manager
- adapt behavior_path_dynamic_obstacle_avoidance_module to new test manager
- adapt behavior_path_external_request_lane_change_module to new test manager
- adapt behavior_path_side_shift_module to new test manager
- adapt behavior_path_static_obstacle_avoidance_module to new test manager
- adapt path_smoother to new test manager
- adapt behavior_velocity_blind_spot_module to new test manager
- adapt behavior_velocity_detection_area_module to new test manager
- adapt behavior_velocity_intersection_module to new test manager
- adapt behavior_velocity_no_stopping_area_module to new test manager
- adapt behavior_velocity_run_out_module to new test manager
- adapt behavior_velocity_stop_line_module to new test manager
- adapt behavior_velocity_traffic_light_module to new test manager
- adapt behavior_velocity_virtual_traffic_light_module to new test manager
- adapt behavior_velocity_walkway_module to new test manager
- adapt motion_velocity_planner_node_universe to new test manager
- include necessary headers
* Odometries -> Odometry ---------Co-authored-by: Takayuki Murooka <<takayuki5168@gmail.com>>
-
Contributors: Fumiya Watanabe, Mitsuhiro Sakamoto, Ryohsuke
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
tier4_planning_launch |
Launch files
- launch/freespace_planner.launch.xml
-
- input_route [default: input_route]
- input_occupancy_grid [default: input_occupancy_grid]
- input_scenario [default: input_scenario]
- input_odometry [default: /localization/kinematic_state]
- output_trajectory [default: output_trajectory]
- is_completed [default: is_completed]
- param_file [default: $(find-pkg-share autoware_freespace_planner)/config/freespace_planner.param.yaml]
- vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]