Giter VIP home page Giter VIP logo

two-wheel-robot-gazebo's Introduction

two-wheel-robot-gazebo

two wheel differential drive robot simulation in gazebo

Brief Explanation

  • two_wheel_robot_description specifies the entire robot structure as links and joints and can launch the model.
  • two_wheel_robot_gazebo launches the model in the gazebo environment and contains different simulation worlds.

Install gazebo-ros control

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

complining the package

In new terminal

mkdir -p ~/catkin_ws/src

cd catkin_ws/src

git clone https://github.com/Marslanali/two-wheel-robot-gazebo.git

catkin_make

Run the Models

Load the Gazebo simulator using the following command:

roslaunch two_wheel_robot_gazebo two_wheel_robot.launch

moving in a circle:

In a new terminal use the following command to make the robot drive incessantly along a circle of user-defined diameter. (Here diameter = 4 m. So, radius = 2m. Thus linear and angular velocities are set accordingly)

rostopic pub /cmd_vel geometry_msgs/Twist "linear:
  x: 0.2
  y: 0.0
  z: 0.0
angular:
  x: 0.0
  y: 0.0
  z: 0.1"

Running keyboard teleop:

The ~/catkin_ws/src/turtlebot3_teleop/nodes folder contains the turtlebot3_teleop_key node, which is the teleop node.

Start the teleop node:

roslaunch turtlebot3_teleop turtlebot3_teleop_key.launch

Spwan single URDF robot without launch file

spwarn urdf of two wheel robot

roslaunch two_wheel_robot_gazebo two_wheel_robot_urdf_spwan.launch


rosrun gazebo_ros spawn_model -file `rospack find two_wheel_robot_description`/urdf/two_wheel_robot.urdf -urdf -x 1 -y 1 -z 1 -model two_wheel_robot

rosservice call gazebo/delete_model '{model_name: two_wheel_robot}'

Launching turtlebot play ground gazebo

roslaunch two_wheel_robot_gazebo rosbot_world.launch

Contribution

License

See the LICENSE file for license rights and limitations (MIT).

two-wheel-robot-gazebo's People

Contributors

marslanali avatar

Stargazers

 avatar  avatar

Watchers

 avatar

Forkers

hrb518 esesna

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.