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
@@ -84,4 +85,11 @@ ros2 service call /scenario_runner/execute_scenario carla_ros_scenario_runner_ty
84
85
|-------|------|-------------|
85
86
|`/scenario_runner/status`|[`carla_ros_scenario_runner_types.CarlaScenarioRunnerStatus`](https://github.com/carla-simulator/ros-bridge/blob/ros2/carla_ros_scenario_runner_types/msg/CarlaScenarioRunnerStatus.msg)| The current status of the scenario runner execution (used by the [rviz_carla_plugin](rviz_plugin.md)) |
86
87
88
+
89
+
The controller `ros_vehicle_control` provides the following topics:
90
+
| Topic | Type | Description |
91
+
|-------|------|-------------|
92
+
|`/carla/<ROLE NAME>/waypoints`|[`nav_msgs.Path`](https://docs.ros.org/en/api/nav_msgs/html/msg/Path.html)| the path defined within the scenario. Note: The topic name can be changed by modifying the parameter `path_topic_name`|
93
+
|`/carla/<ROLE NAME>/target_speed`|[`std_msgs.Float64`](https://docs.ros.org/en/api/std_msgs/html/msg/Float64.html)| the target speed as defined within the scenario |
0 commit comments