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.sh28
1 files changed, 0 insertions, 28 deletions
diff --git a/Tools/ros/px4_workspace_setup.sh b/Tools/ros/px4_workspace_setup.sh
deleted file mode 100755
index 5599ab999..000000000
--- a/Tools/ros/px4_workspace_setup.sh
+++ /dev/null
@@ -1,28 +0,0 @@
-#!/bin/bash
-# License: according to LICENSE.md in the root directory of the PX4 Firmware repository
-
-# run this script from the root of your catkin_ws
-source devel/setup.bash
-cd src
-
-# PX4 Firmware
-git clone https://github.com/PX4/Firmware.git
-
-# euroc simulator
-git clone https://github.com/PX4/euroc_simulator.git
-
-# mav comm
-git clone https://github.com/PX4/mav_comm.git
-
-# gflags catkin
-git clone https://github.com/ethz-asl/gflags_catkin.git
-
-# glog catkin
-git clone https://github.com/ethz-asl/glog_catkin.git
-
-# catkin simple
-git clone https://github.com/catkin/catkin_simple.git
-
-cd ..
-
-catkin_make