You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
Copy file name to clipboardexpand all lines: localization/pose_initializer/README.md
+3-3
Original file line number
Diff line number
Diff line change
@@ -51,9 +51,9 @@ If the score of initial pose estimation result is lower than score threshold, ER
51
51
52
52
## Connection with Default AD API
53
53
54
-
This `pose_initializer` is used via default AD API. For detailed description of the API description, please refer to [the description of `default_ad_api`](https://github.com/autowarefoundation/autoware.universe/blob/main/system/default_ad_api/document/localization.md).
54
+
This `pose_initializer` is used via default AD API. For detailed description of the API description, please refer to [the description of `autoware_default_adapi`](https://github.com/autowarefoundation/autoware.universe/blob/main/system/autoware_default_adapi/document/localization.md).
The position.z and the covariance will be overwritten by [ad_api_adaptors](https://github.com/autowarefoundation/autoware.universe/tree/main/system/default_ad_api_helpers/ad_api_adaptors), so there is no need to input them.
139
+
The position.z and the covariance will be overwritten by [ad_api_adaptors](https://github.com/autowarefoundation/autoware.universe/tree/main/system/autoware_default_adapi_helpers/ad_api_adaptors), so there is no need to input them.
|~/input/odometry | ○ |`nav_msgs::msg::Odometry`| for ego velocity. |
95
-
|~/input/accel | ○ |`geometry_msgs::msg::AccelWithCovarianceStamped`| for ego acceleration. |
96
-
|~/input/objects | ○ |`autoware_perception_msgs::msg::PredictedObjects`| dynamic objects from perception module. |
97
-
|~/input/occupancy_grid_map | ○ |`nav_msgs::msg::OccupancyGrid`| occupancy grid map from perception module. This is used for only Goal Planner module. |
98
-
|~/input/traffic_signals | ○ |`autoware_perception_msgs::msg::TrafficLightGroupArray`| traffic signals information from the perception module |
|~/input/route | ○ |`autoware_planning_msgs::msg::LaneletRoute`| current route from start to goal. |
101
-
|~/input/scenario | ○ |`tier4_planning_msgs::msg::Scenario`| Launches behavior path planner if current scenario == `Scenario:LaneDriving`. |
102
-
|~/input/lateral_offset | △ |`tier4_planning_msgs::msg::LateralOffset`| lateral offset to trigger side shift |
103
-
|~/system/operation_mode/state | ○ |`autoware_adapi_v1_msgs::msg::OperationModeState`| Allows planning module to know if vehicle is in autonomous mode or can be controlled<sup>[ref](https://github.com/autowarefoundation/autoware.universe/blob/main/system/default_ad_api/document/operation-mode.md)</sup> |
|~/input/odometry | ○ |`nav_msgs::msg::Odometry`| for ego velocity. |
95
+
|~/input/accel | ○ |`geometry_msgs::msg::AccelWithCovarianceStamped`| for ego acceleration. |
96
+
|~/input/objects | ○ |`autoware_perception_msgs::msg::PredictedObjects`| dynamic objects from perception module. |
97
+
|~/input/occupancy_grid_map | ○ |`nav_msgs::msg::OccupancyGrid`| occupancy grid map from perception module. This is used for only Goal Planner module. |
98
+
|~/input/traffic_signals | ○ |`autoware_perception_msgs::msg::TrafficLightGroupArray`| traffic signals information from the perception module |
|~/input/route | ○ |`autoware_planning_msgs::msg::LaneletRoute`| current route from start to goal. |
101
+
|~/input/scenario | ○ |`tier4_planning_msgs::msg::Scenario`| Launches behavior path planner if current scenario == `Scenario:LaneDriving`. |
102
+
|~/input/lateral_offset | △ |`tier4_planning_msgs::msg::LateralOffset`| lateral offset to trigger side shift |
103
+
|~/system/operation_mode/state | ○ |`autoware_adapi_v1_msgs::msg::OperationModeState`| Allows planning module to know if vehicle is in autonomous mode or can be controlled<sup>[ref](https://github.com/autowarefoundation/autoware.universe/blob/main/system/autoware_default_adapi/document/operation-mode.md)</sup> |
104
104
105
105
- ○ Mandatory: Planning Module would not work if anyone of this is not present.
106
106
- △ Optional: Some module would not work, but Planning Module can still be operated.
0 commit comments