Skip to content

Example robots and code for interfacing Gazebo with ROS

Notifications You must be signed in to change notification settings

EricWang1hitsz/gazebo_ros_demos

 
 

Repository files navigation

Gazebo ROS Demos

  • Author: Dave Coleman [email protected]
  • License: GNU General Public License, version 3 (GPL-3.0)

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!

Eric_Wang: Problem Description:

Prerequisities:

sudo apt-get install ros-kinetic-gazebo-ros-control
sudo apt-get install ros-kinetic-ros-control
sudo apt-get install ros-kinetic-ros-controllers

About

Example robots and code for interfacing Gazebo with ROS

Resources

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published

Languages

  • CMake 75.3%
  • C++ 24.7%