aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/px4_workspace_setup.sh
diff options
context:
space:
mode:
Diffstat (limited to 'Tools/ros/px4_workspace_setup.sh')
-rwxr-xr-xTools/ros/px4_workspace_setup.sh7
1 files changed, 6 insertions, 1 deletions
diff --git a/Tools/ros/px4_workspace_setup.sh b/Tools/ros/px4_workspace_setup.sh
index 0a7e1742c..7c8af6e8f 100755
--- a/Tools/ros/px4_workspace_setup.sh
+++ b/Tools/ros/px4_workspace_setup.sh
@@ -18,12 +18,17 @@ cd ..
# mav comm
git clone https://github.com/PX4/mav_comm.git
-# glog catkin
+# glog catkin
git clone https://github.com/ethz-asl/glog_catkin.git
# catkin simple
git clone https://github.com/catkin/catkin_simple.git
+# drcsim (for scenery and models)
+hg clone https://bitbucket.org/osrf/osrf-common
+hg clone https://bitbucket.org/osrf/sandia-hand
+hg clone https://bitbucket.org/osrf/drcsim
+
cd ..
catkin_make