ros-simulation / gazebo_ros_demos

Example robots and code for interfacing Gazebo with ROS
352 stars 226 forks source link

Gazebo ROS Demos

Example robots and code for interfacing Gazebo with ROS

Tutorials

ROS URDF

Quick Start

Rviz:

roslaunch rrbot_description rrbot_rviz.launch

Gazebo:

roslaunch rrbot_gazebo rrbot_world.launch

ROS Control:

roslaunch rrbot_control rrbot_control.launch

Example of Moving Joints:

rostopic pub /rrbot/joint2_position_controller/command std_msgs/Float64 "data: -0.9"

Develop and Contribute

We welcome any contributions to this repo and encourage you to fork the project then send pull requests back to this parent repo. Thanks for your help!