- Notifications
You must be signed in to change notification settings - Fork9
How to use a realtime simulation of continuous tracks for Gazebo 7 & 9
License
NotificationsYou must be signed in to change notification settings
yoshito-n-students/gazebo_continuous_track_example
Folders and files
Name | Name | Last commit message | Last commit date | |
---|---|---|---|---|
Repository files navigation
Example of a realtime continuous track simulation for the Gazebo simulator & ROS. The blue and green ones are based on the proposed method with or without grousers. The red one is based on a conventional method by multiple wheels.
Y. Okada, S. Kojima, K. Ohno and S. Tadokoro, "Real-time Simulation of Non-Deformable Continuous Tracks with Explicit Consideration of Friction and Grouser Geometry," 2020 IEEE International Conference on Robotics and Automation (ICRA), 2020
- Gazebo7 + ROS Kinetic + Ubuntu 16.04
- Gazebo9 + ROS Melodic + Ubuntu 18.04
- Update Gazebo from the OSRF apt repository (ref)
sudo sh -c 'echo "deb http://packages.osrfoundation.org/gazebo/ubuntu-stable `lsb_release -cs` main" > /etc/apt/sources.list.d/gazebo-stable.list'wget http://packages.osrfoundation.org/gazebo.key -O - | sudo apt-key add -sudo apt-get updatesudo apt-get upgrage
- Clone relative packages
cd <your-ros-ws>/srcgit clone git@github.com:yoshito-n-students/gazebo_continuous_track.gitgit clone git@github.com:yoshito-n-students/gazebo_continuous_track_example.git
- Build
catkin_make
- Spawn tracked vehicles in Gazebo
cd <your-ros-ws>source devel/setup.bashroslaunch gazebo_continuous_example example_track_all_world.launch
- (On another terminal) Send a velocity command to the vehicles
rostopic pub /cmd_vel std_msgs/Float64 "data: 0.5"
About
How to use a realtime simulation of continuous tracks for Gazebo 7 & 9
Resources
License
Uh oh!
There was an error while loading.Please reload this page.
Stars
Watchers
Forks
Packages0
No packages published
Uh oh!
There was an error while loading.Please reload this page.