aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/px4_ros_installation_ubuntu.sh
diff options
context:
space:
mode:
authorAndreas Antener <antener_a@gmx.ch>2015-01-16 18:21:06 +0100
committerThomas Gubler <thomasgubler@gmail.com>2015-01-17 16:52:02 +0100
commit43f3e3ac789d7af15b41ba5f857cc8596b70999d (patch)
tree2844428f66e044235c20a4fea9db93f0b5030598 /Tools/ros/px4_ros_installation_ubuntu.sh
parent93173190fd1f20b9c9a939d423d8cfe6cf13f562 (diff)
downloadpx4-firmware-43f3e3ac789d7af15b41ba5f857cc8596b70999d.tar.gz
px4-firmware-43f3e3ac789d7af15b41ba5f857cc8596b70999d.tar.bz2
px4-firmware-43f3e3ac789d7af15b41ba5f857cc8596b70999d.zip
adding drcsim binary installation
Diffstat (limited to 'Tools/ros/px4_ros_installation_ubuntu.sh')
-rwxr-xr-xTools/ros/px4_ros_installation_ubuntu.sh4
1 files changed, 4 insertions, 0 deletions
diff --git a/Tools/ros/px4_ros_installation_ubuntu.sh b/Tools/ros/px4_ros_installation_ubuntu.sh
index 13532049f..80f684590 100755
--- a/Tools/ros/px4_ros_installation_ubuntu.sh
+++ b/Tools/ros/px4_ros_installation_ubuntu.sh
@@ -2,14 +2,17 @@
# main ROS Setup
# following http://wiki.ros.org/indigo/Installation/Ubuntu
+# also adding dependencies for gazebo http://gazebosim.org/tutorials?tut=drcsim_install
# run this file with . ./px4_ros_setup_ubuntu.sh
## add ROS repository
sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu trusty main" > /etc/apt/sources.list.d/ros-latest.list'
+sudo sh -c 'echo "deb http://packages.osrfoundation.org/drc/ubuntu trusty main" > /etc/apt/sources.list.d/drc-latest.list'
## add key
wget https://raw.githubusercontent.com/ros/rosdistro/master/ros.key -O - | \
sudo apt-key add -
+wget http://packages.osrfoundation.org/drc.key -O - | sudo apt-key add -
## Install main ROS pacakges
sudo apt-get update
@@ -26,4 +29,5 @@ sudo apt-get install python-rosinstall
# additional dependencies necessary
sudo apt-get install ros-indigo-octomap-msgs
+sudo apt-get install drcsim