Skip to content

Commit 3c78a6f

Browse files
committedApr 23, 2021
Update docs
1 parent 1276bbf commit 3c78a6f

File tree

1 file changed

+8
-0
lines changed

1 file changed

+8
-0
lines changed
 

‎docs/carla_ros_scenario_runner.md

+8
Original file line numberDiff line numberDiff line change
@@ -36,6 +36,7 @@ An example scenario is found [here](https://github.com/carla-simulator/ros-bridg
3636
<Property name="module" value="carla_ros_scenario_runner.ros_vehicle_control" />
3737
<Property name="launch" value="carla_ad_agent.launch"/>
3838
<Property name="launch-package" value="carla_ad_agent"/>
39+
<Property name="path_topic_name" value="waypoints"/>
3940
</Properties>
4041
</Controller>
4142
```
@@ -84,4 +85,11 @@ ros2 service call /scenario_runner/execute_scenario carla_ros_scenario_runner_ty
8485
|-------|------|-------------|
8586
| `/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)) |
8687

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 |
94+
8795
<br>

0 commit comments

Comments
 (0)
Please sign in to comment.