-
Notifications
You must be signed in to change notification settings - Fork 14
from source
eterpega edited this page Mar 17, 2018
·
1 revision
Here we'll explain how to build drcsim from source. You will need a working installation of gazebo, explained in the previous section.
sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu xenial main" > /etc/apt/sources.list.d/ros-latest.list'
wget http://packages.ros.org/ros.key -O - | sudo apt-key add -
sudo apt-get update
# Install osrf-common's dependencies
sudo apt-get install -y cmake \
debhelper \
ros-kinetic-ros \
ros-kinetic-ros-comm
# Install sandia-hand's dependencies
sudo apt-get install -y ros-kinetic-xacro \
ros-kinetic-ros \
ros-kinetic-image-common \
ros-kinetic-ros-comm \
ros-kinetic-common-msgs \
libboost-dev \
avr-libc \
gcc-avr \
libqt4-dev
# Install gazebo-ros-pkgs
sudo apt-get install -y libtinyxml-dev \
ros-kinetic-vision-opencv \
ros-kinetic-angles \
ros-kinetic-cv-bridge \
ros-kinetic-dynamic-reconfigure \
ros-kinetic-geometry-msgs \
ros-kinetic-image-transport \
ros-kinetic-message-generation \
ros-kinetic-nav-msgs \
ros-kinetic-nodelet \
ros-kinetic-pcl-conversions \
ros-kinetic-pcl-ros \
ros-kinetic-polled-camera \
ros-kinetic-rosconsole \
ros-kinetic-rosgraph-msgs \
ros-kinetic-sensor-msgs \
ros-kinetic-trajectory-msgs \
ros-kinetic-urdf \
ros-kinetic-dynamic-reconfigure \
ros-kinetic-rosgraph-msgs \
ros-kinetic-tf \
ros-kinetic-cmake-modules
indigo에는 있고 kinetic에는 없다?
ros-kinetic-driver-base
.
# Install drcsim's dependencies
sudo apt-get install -y cmake debhelper \
ros-kinetic-std-msgs ros-kinetic-common-msgs \
ros-kinetic-image-common ros-kinetic-geometry \
ros-kinetic-ros-control \
ros-kinetic-robot-state-publisher \
ros-kinetic-image-pipeline \
ros-kinetic-image-transport-plugins \
ros-kinetic-compressed-depth-image-transport \
ros-kinetic-compressed-image-transport \
ros-kinetic-theora-image-transport \
ros-kinetic-laser-assembler
indigo에는 있고 kinetic에는 없다?
ros-kinetic-geometry-experimental
.
3. Create the catkin workspace Default branches of ros gazebo plugins, osrf-common, sandia-hand and drcsim will be included into the workspace.
# Setup the workspace
mkdir -p /tmp/ws/src
cd /tmp/ws/src
# Download needed software
git clone https://github.com/ros-simulation/gazebo_ros_pkgs.git
hg clone https://bitbucket.org/osrf/osrf-common
hg clone https://bitbucket.org/osrf/sandia-hand
hg clone https://bitbucket.org/osrf/drcsim
# Change to the *kinetic* branch in gazebo_ros_pkgs
cd gazebo_ros_pkgs
git checkout kinetic-devel
cd ..
# Source ros distro's setup.bash
source /opt/ros/kinetic/setup.bash
# Build and install into workspace
cd /tmp/ws
catkin_make install
# Source the setup from workspace
source /tmp/ws/install/setup.bash
# Source drcsim setup file
source /tmp/ws/install/share/drcsim/setup.sh
# Test installation
roslaunch drcsim_gazebo atlas.launch
-
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]