-
Notifications
You must be signed in to change notification settings - Fork 14
Gazebo and others
- 로봇 시뮬레이터 구성 요소
- Gazebo 물리엔진 구성요소
- Gazebo 특징
- 로봇 시뮬레이터 종류
- 접촉 모델(Contact model)
- [TBD][마찰 모델(Friction model)]
- Additional Readings
- Physics engine (Dynamics/Contact/Collision/etc,.)
- Virtual Sensors
- Interface
- GUIs & Visualization
- Server: Runs the physics loop and generates sensor data
- Executable: gzserver
- Libraries: Physics, Sensors, Rendering, Transport
- Client: Provides user interaction and visualization of a simulation.
- Executable: gzclient
- Libraries: Transport, Rendering, GUI
- Open Dynamics Engine
- Robotics, gaming
- http://bitbucket.org/odedevs/ode
- Bullet
- Gaming, animation, Sony, AMD, Google
- http://github.com/bulletphysics/bullet3
- Simbody
- Biomechanics, Stanford
- http://github.com/simbody/simbody
- DART
- Robotics, animation, Georgia Tech
- http://github.com/dartsim/dart

-
Dynamics Simulation
- Access multiple high-performance physics engines including ODE, Bullet, Simbody, and DART.
-
Advanced 3D Graphics
- Utilizing OGRE, Gazebo provides realistic rendering of environments including high-quality lighting, shadows, and textures.
-
Sensors and Noise
- Generate sensor data, optionally with noise, from laser range finders, 2D/3D cameras, Kinect style sensors, contact sensors, force-torque, and more.
-
Plugins
- Develop custom plugins for robot, sensor, and environmental control. Plugins provide direct access to Gazebo's API.
-
Robot Models
- Many robots are provided including PR2, Pioneer2 DX, iRobot Create, and TurtleBot. Or build your own using SDF.
-
TCP/IP Transport
- Run simulation on remote servers, and interface to Gazebo through socket-based message passing using Google Protobufs.
-
Cloud Simulation
- Use CloudSim to run Gazebo on Amazon AWS and GzWeb to interact with the simulation through a browser.
-
Command Line Tools
- Extensive command line tools facilitate simulation introspection and control.
-
ODE(Open Dynamics Engine) (2001~) <Sample_youtube>
-
Mujoco(Multi-Joint dynamics with Contact) (2012~) <Sample_youtube>
-
Gazebo [ODE with velocity-based LCP + Bullet Collision + ..] (2012~)
-
WeBot (1998~) <Sample_youtube>
-
iCub simulator <Sample_youtube>
-
RoboticsLab <Sample_youtube>
-
RecurDyn <Sample_youtube>
-
MSC. ADAMS <Sample_youtube>
-
etc.,
Software Software license Physics engine Platforms supported Gazebo Apache 2.0 ODE/Bullet/Simbody/DART Linux, macOS, Windows Webot Non-free based on ODE Linux, macOS, Windows V-Rep Proprietary/GNU GPL ODE/Bullet/Vortex/Newton Linux, macOS, Windows OpenRAVE GNU LGPL ODE/Bullet Linux, macOS, Windows OpenHRP Eclipse ODE/Internal Linux, Windows RoboticsLab Proprietary ODE/Bullet/etc Windows [TBD] (참고) License 상세참고
- GNU GPL(General Public License)
- BSD (Berkeley Software Distribution) License
- MIT License
- Apache License
- MPL (Mozilla Public License)
- etc.,
[Reference] (Springer book) Contact Force Models for Multibody Dynamics

- LCP(Linear Complementary Problem) Method + Lemke's Algorithms [Rigid][Continuous Contact based] <== ODE, Mujoco, etc.,
- Hertz Methtod [Elastic][Impact model & penalty based] <== MBD, FEM, etc.,
- etc.,
Hertz model is an idealized model of material defoamtion and contact forces for spherical surfaces that is often applied as an explicit penalty force.
LCP attemps to resolve all contact forces simultaneously when collisions are detected.
[TBD]
-
[GAZEBO / Willow garage] Extending Open Dynamics Engine for Robotics Simulation
https://pdfs.semanticscholar.org/c00f/2a73816bbd36b304e9ba6a7bcd23cd70d7cf.pdf -
[ROSCON2014] Comparison of Rigid Body Dynamic Simulators for Robotic Simulation in Gazebo
https://www.osrfoundation.org/wordpress2/wp-content/uploads/2015/04/roscon2014_scpeters.pdf -
[arXiv 2014] Tools for dynamics simulation of robots: a survey based on user feedback
https://arxiv.org/pdf/1402.7050.pdf -
Wikipedia) Contact_mechanics
https://en.wikipedia.org/wiki/Contact_mechanics -
[ICRA2015] Simulation Tools for Model-Based Robotics: Comparison of Bullet, Havok, MuJoCo, ODE and PhysX
https://homes.cs.washington.edu/~todorov/papers/ErezICRA15.pdf -
Survey of a Multibody dynamics software
http://www.cs.rpi.edu/~trink/sim_packages.html -
Mujoco(Multi-Joint dynamics with Contact) Overview
http://www.mujoco.org/book/index.html -
[IROS2012]MuJoCo: A physics engine for model-based control
https://homes.cs.washington.edu/~todorov/papers/TodorovIROS12.pdf
-
Robot Simulators
-
Build a Robot
- Model structure and requirements
- How to contribute a model
- Make a model
- Make a Mobile Robot
- The relationship among Link, Joint and Axis
- Import Meshes
- Attach Meshes
- Add a Sensor to a Robot
- Make a Simple Gripper
- Attach Gripper to Robot
- Nested model
- Model Editor
- Animated Box
- Make an animated model(actor)
- Inertial parameters of triangle meshes
- Visibility layers
-
Model Editor
-
Build a World
-
Tools and utilities
-
Write a plugin
-
Plugins
-
Sensors
-
User input
-
Transport Library
-
Rendering Library
-
Connect to ROS
-
Ros Control - Advanced
-
DRCSIM for ROS Kinetic (Ubuntu16.04)
-
DRCSIM
- DRC Simulator installation
- Launchfile options
- Spawn Atlas into a custom world
- Animate joints
- Atlas Keyboard Teleoperation over ROS
- Teleoperate atlas with a music mixer
- Visualization and logging
- Atlas MultiSense SL head
- How to use the Atlas Sim Interface
- Atlas fake walking
- Grasp with Sandia hands
- DRC vehicle tele-operation
- DRC vehicle tele operation with Atlas
- Sending joint commands with ROS
- Atlas control over ROS with python
- Modify environment
- Atlas switching control modes
- Atlas Controller Synchronization over ROS Topics
- Changing Viscous Damping Coefficients Over ROS Service
- Running BDI controller demo
- Using the RobotiQ 3 Finger Adaptive Robot Gripper
- BDI Atlas Robot Interface 3.0.0 Stand In Example
-
HAPTIX
- HAPTIX software install and update
- HAPTIX C API
- HAPTIX Matlab and Octave API
- HAPTIX Simulation World API
- HAPTIX Teleoperation
- HAPTIX environment setup
- HAPTIX Optitrack Control
- HAPTIX Tactor Glove
- HAPTIX Simulation World API with Custom World Example
- HAPTIX logging
- HAPTIX DEKA Luke hand installation
- HAPTIX Simulation Scoring Plugin Example
-
MoveIt!
-
Rviz & rqt & ROSBAG
- Control Theory
- TroubleShooting
- Solidworks model to URDF
- ROS-Gazebo with MATLab
- MATLab installation in Linux
- [Gazebo simulation with MATLab]