aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/px4_ros_installation_ubuntu.sh
diff options
context:
space:
mode:
Diffstat (limited to 'Tools/ros/px4_ros_installation_ubuntu.sh')
-rwxr-xr-xTools/ros/px4_ros_installation_ubuntu.sh11
1 files changed, 0 insertions, 11 deletions
diff --git a/Tools/ros/px4_ros_installation_ubuntu.sh b/Tools/ros/px4_ros_installation_ubuntu.sh
index 72b4f9468..01801c81a 100755
--- a/Tools/ros/px4_ros_installation_ubuntu.sh
+++ b/Tools/ros/px4_ros_installation_ubuntu.sh
@@ -27,14 +27,3 @@ sudo apt-get -y install python-rosinstall
# additional dependencies
sudo apt-get -y install ros-indigo-octomap-msgs
-
-## drcsim setup (for models)
-### add osrf repository
-sudo sh -c 'echo "deb http://packages.osrfoundation.org/drc/ubuntu trusty main" > /etc/apt/sources.list.d/drc-latest.list'
-
-### add key
-wget http://packages.osrfoundation.org/drc.key -O - | sudo apt-key add -
-
-### install drcsim
-sudo apt-get update
-sudo apt-get -y install drcsim