Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro jazzy showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro kilted showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro rolling showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro ardent showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro bouncy showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro crystal showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro eloquent showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro dashing showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro galactic showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro foxy showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro iron showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro lunar showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro jade showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro indigo showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro hydro showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro kinetic showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro melodic showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange

No version for distro noetic showing humble. Known supported distros are highlighted in the buttons above.
Package symbol

autoware_mission_planner package from autoware_core repo

autoware_adapi_specs autoware_core autoware_component_interface_specs autoware_geography_utils autoware_global_parameter_loader autoware_interpolation autoware_kalman_filter autoware_lanelet2_utils autoware_motion_utils autoware_node autoware_object_recognition_utils autoware_osqp_interface autoware_point_types autoware_qp_interface autoware_signal_processing autoware_trajectory autoware_vehicle_info_utils autoware_core_control autoware_simple_pure_pursuit autoware_core_localization autoware_ekf_localizer autoware_gyro_odometer autoware_localization_util autoware_ndt_scan_matcher autoware_pose_initializer autoware_stop_filter autoware_twist2accel autoware_core_map autoware_lanelet2_map_visualizer autoware_map_height_fitter autoware_map_loader autoware_map_projection_loader autoware_core_perception autoware_euclidean_cluster_object_detector autoware_ground_filter autoware_perception_objects_converter autoware_core_planning autoware_mission_planner autoware_objects_of_interest_marker_interface autoware_path_generator autoware_planning_factor_interface autoware_planning_topic_converter autoware_route_handler autoware_velocity_smoother autoware_behavior_velocity_planner autoware_behavior_velocity_planner_common autoware_behavior_velocity_stop_line_module autoware_motion_velocity_obstacle_stop_module autoware_motion_velocity_planner autoware_motion_velocity_planner_common autoware_core_sensing autoware_crop_box_filter autoware_downsample_filters autoware_gnss_poser autoware_vehicle_velocity_converter autoware_planning_test_manager autoware_pyplot autoware_test_node autoware_test_utils autoware_testing autoware_core_vehicle

ROS Distro
humble

Package Summary

Tags No category tags.
Version 1.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/autowarefoundation/autoware_core.git
VCS Type git
VCS Version main
Last Updated 2025-06-12
Dev Status DEVELOPED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The autoware_mission_planner package

Additional Links

No additional links.

Maintainers

  • Takagi, Isamu
  • Kosuke Takeuchi
  • Ryohsuke Mitsudome
  • Takamasa Horibe
  • Takayuki Murooka
  • Mamoru Sobue

Authors

  • Ryohsuke Mitsudome

Mission Planner

Purpose

Mission Planner calculates a route that navigates from the current ego pose to the goal pose following the given check points. The route is made of a sequence of lanes on a static map. Dynamic objects (e.g. pedestrians and other vehicles) and dynamic map information (e.g. road construction which blocks some lanes) are not considered during route planning. Therefore, the output topic is only published when the goal pose or check points are given and will be latched until the new goal pose or check points are given.

The core implementation does not depend on a map format. Any planning algorithms can be added as plugin modules. In current Autoware Universe, only the plugin for Lanelet2 map format is supported.

Interfaces

Parameters

Name Type Description
map_frame string The frame name for map
arrival_check_angle_deg double Angle threshold for goal check
arrival_check_distance double Distance threshold for goal check
arrival_check_duration double Duration threshold for goal check
goal_angle_threshold double Max goal pose angle for goal approve
enable_correct_goal_pose bool Enabling correction of goal pose according to the closest lanelet orientation
reroute_time_threshold double If the time to the rerouting point at the current velocity is greater than this threshold, rerouting is possible
minimum_reroute_length double Minimum Length for publishing a new route
consider_no_drivable_lanes bool This flag is for considering no_drivable_lanes in planning or not.
allow_reroute_in_autonomous_mode bool This is a flag to allow reroute in autonomous driving mode. If false, reroute fails. If true, only safe reroute is allowed

Services

Name Type Description
/planning/mission_planning/mission_planner/clear_route autoware_internal_planning_msgs/srv/ClearRoute route clear request
/planning/mission_planning/mission_planner/set_waypoint_route autoware_internal_planning_msgs/srv/SetWaypointRoute route request with lanelet waypoints.
/planning/mission_planning/mission_planner/set_lanelet_route autoware_internal_planning_msgs/srv/SetLaneletRoute route request with pose waypoints.

Subscriptions

Name Type Description
input/vector_map autoware_map_msgs/msg/LaneletMapBin vector map of Lanelet2
input/operation_mode_state autoware_adapi_v1_msgs/OperationModeState operation mode state
input/odometry nav_msgs/msg/Odometry vehicle odometry

Publications

Name Type Description
/planning/mission_planning/state autoware_internal_planning_msgs/msg/RouteState route state
/planning/mission_planning/route autoware_planning_msgs/LaneletRoute route
~/debug/route_marker visualization_msgs/msg/MarkerArray route marker for debug
~/debug/goal_footprint visualization_msgs/msg/MarkerArray goal footprint for debug

Route section

route_sections

Route section, whose type is autoware_planning_msgs/LaneletSegment, is a “slice” of a road that bundles lane changeable lanes. Note that the most atomic unit of route is autoware_planning_msgs/LaneletPrimitive, which has the unique id of a lane in a vector map and its type. Therefore, route message does not contain geometric information about the lane since we did not want to have planning module’s message to have dependency on map data structure.

The ROS message of route section contains following three elements for each route section.

  • preferred_primitive: Preferred lane to follow towards the goal.
  • primitives: All neighbor lanes in the same direction including the preferred lane.

Goal Validation

The mission planner has control mechanism to validate the given goal pose and create a route. If goal pose angle between goal pose lanelet and goal pose’ yaw is greater than goal_angle_threshold parameter, the goal is rejected. Another control mechanism is the creation of a footprint of the goal pose according to the dimensions of the vehicle and checking whether this footprint is within the lanelets. If goal footprint exceeds lanelets, then the goal is rejected.

At the image below, there are sample goal pose validation cases.

goal_footprints

Implementation

Mission Planner

Two callbacks (goal and check points) are a trigger for route planning. Routing graph, which plans route in Lanelet2, must be created before those callbacks, and this routing graph is created in vector map callback.

plan route is explained in detail in the following section.

```plantuml @startuml title goal callback start

:clear previously memorized check points;

:memorize ego and goal pose as check points;

if (routing graph is ready?) then (yes) else (no) stop endif

:plan route;

File truncated at 100 lines see the full file

CHANGELOG

Changelog for package autoware_mission_planner

1.1.0 (2025-05-01)

1.0.0 (2025-03-31)

  • chore: update version in package.xml

  • feat: port simplified version of autoware_mission_planner from Autoware Universe (#329)

    • feat: port autoware_mission_planner from Autoware Universe
    • chore: reset package version and remove CHANGELOG
    • chore: remove the _universe suffix from autoware_mission_planner
    • feat: repalce tier4_planning_msgs with autoware_internal_planning_msgs
    • feat: remove route_selector module
    • feat: remove reroute_availability and modified_goal subscription
    • remove unnecessary image
    • style(pre-commit): autofix
    • fix: remove unnecessary include file
    • fix: resolve useInitializationList error from cppcheck
    • Apply suggestions from code review

    * style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>

  • Contributors: Ryohsuke Mitsudome

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

  • launch/goal_pose_visualizer.launch.xml
      • route_topic_name [default: /planning/mission_planning/route]
      • echo_back_goal_pose_topic_name [default: /planning/mission_planning/echo_back_goal_pose]
  • launch/mission_planner.launch.xml
      • modified_goal_topic_name [default: /planning/scenario_planning/modified_goal]
      • map_topic_name [default: /map/vector_map]
      • visualization_topic_name [default: /planning/mission_planning/route_marker]
      • mission_planner_param_path [default: $(find-pkg-share autoware_mission_planner)/config/mission_planner.param.yaml]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged autoware_mission_planner at Robotics Stack Exchange