aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh
diff options
context:
space:
mode:
authorAndreas Antener <antener_a@gmx.ch>2015-01-22 21:53:11 +0100
committerAndreas Antener <antener_a@gmx.ch>2015-01-24 12:39:15 +0100
commit6ab1f2168059bb7689548635ab4e746c8f320295 (patch)
tree6c7bfc1e3bf8740bef588000ff573c14f774f925 /Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh
parent6db56b8df08e6dfe4670e1e10a3fb391470f32b4 (diff)
downloadpx4-firmware-6ab1f2168059bb7689548635ab4e746c8f320295.tar.gz
px4-firmware-6ab1f2168059bb7689548635ab4e746c8f320295.tar.bz2
px4-firmware-6ab1f2168059bb7689548635ab4e746c8f320295.zip
updated setup, added maintainer
Diffstat (limited to 'Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh')
-rw-r--r--Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh43
1 files changed, 43 insertions, 0 deletions
diff --git a/Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh b/Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh
new file mode 100644
index 000000000..231166e27
--- /dev/null
+++ b/Tools/ros/docker/px4-ros-base/scripts/setup-workspace.sh
@@ -0,0 +1,43 @@
+#!/bin/sh
+#
+# Create workspace at current location and fetch source repositories
+#
+
+WDIR=`pwd`
+WORKSPACE=$WDIR/catkin_ws
+
+# Setup workspace
+mkdir -p $WORKSPACE/src
+cd $WORKSPACE/src
+catkin_init_workspace
+cd $WORKSPACE
+catkin_make
+echo "source $WORKSPACE/devel/setup.bash" >> ~/.bashrc
+
+# PX4 Firmware
+cd $WORKSPACE/src
+git clone https://github.com/PX4/Firmware.git \
+ && cd Firmware \
+ && git checkout ros
+
+# euroc simulator
+cd $WORKSPACE/src
+git clone https://github.com/PX4/euroc_simulator.git \
+ && cd euroc_simulator \
+ && git checkout px4_nodes
+
+# mav comm
+cd $WORKSPACE/src
+git clone https://github.com/PX4/mav_comm.git
+
+# glog catkin
+cd $WORKSPACE/src
+git clone https://github.com/ethz-asl/glog_catkin.git
+
+# catkin simple
+cd $WORKSPACE/src
+git clone https://github.com/catkin/catkin_simple.git
+
+cd $WORKSPACE
+catkin_make
+