Skip to content
Snippets Groups Projects
Commit 7a316341 authored by Fernando Herrero's avatar Fernando Herrero
Browse files

Update ros_interface.md, tutorials/real_robot.md, tutorials/simulation.md,...

Update ros_interface.md, tutorials/real_robot.md, tutorials/simulation.md, README.md, developers.md files
parent a740b557
No related branches found
No related tags found
No related merge requests found
......@@ -32,4 +32,4 @@ whenever you need to use the robot.
# Developers
For advanced users and developers, [here<to_do>]() there is a more in depth information about the robot and all its dependencies.
See [developers](developers.md) for advanced users and developers.
# Developers
# ROS Interface
## Topics
### Published
* /helena/odom ([nav_msgs/Odometry](http://docs.ros.org/api/nav_msgs/html/msg/Odometry.html)): platform odometry
### Subscribed
* /helena/cmd_vel ([geometry_msgs/Twist](http://docs.ros.org/api/geometry_msgs/html/msg/Twist.html)): velocity commands as linear speed (linear.x) and angular speed (angular.z)
## Services
### Servers
*
### Clients
*
## Actions
### Servers
*
### Clients
*
......@@ -6,4 +6,4 @@ The robot's on-board computer already has all the necessary ROS nodes to operate
At this point, you should have acces to all the topic, services and actions provided by the robot.
A complete list of all ROS interfaces is shown here: [to_do]().
\ No newline at end of file
A complete list of all ROS interfaces is shown here: [ROS_interface](../ros_interface.md).
\ No newline at end of file
......@@ -61,4 +61,4 @@ roslaunch iri_helena_gazebo sim_sample.launch rviz:=true world_name:=willow
This command should launch the robot with all its sensors in an example world, shown in the Gazebo gui, and Rviz showing sensor data.
A complete list of all ROS interfaces is shown here: [to_do]().
\ No newline at end of file
A complete list of all ROS interfaces is shown here: [ROS_interface](../ros_interface.md).
\ No newline at end of file
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment