aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/px4_workspace_create.sh
diff options
context:
space:
mode:
authorThomas Gubler <thomasgubler@gmail.com>2015-01-07 13:48:20 +0100
committerThomas Gubler <thomasgubler@gmail.com>2015-01-07 13:48:20 +0100
commit417a82c699c2512ca3b8998c91c9d77f5d826edb (patch)
tree644ed3fd2279f66de8d3a4f1ffb4efcebe73602f /Tools/ros/px4_workspace_create.sh
parenta01a8f955336e2825d23d5494703ea91f15e3ee1 (diff)
downloadpx4-firmware-417a82c699c2512ca3b8998c91c9d77f5d826edb.tar.gz
px4-firmware-417a82c699c2512ca3b8998c91c9d77f5d826edb.tar.bz2
px4-firmware-417a82c699c2512ca3b8998c91c9d77f5d826edb.zip
add ros setup scripts
Diffstat (limited to 'Tools/ros/px4_workspace_create.sh')
-rwxr-xr-xTools/ros/px4_workspace_create.sh7
1 files changed, 7 insertions, 0 deletions
diff --git a/Tools/ros/px4_workspace_create.sh b/Tools/ros/px4_workspace_create.sh
new file mode 100755
index 000000000..d8d65c819
--- /dev/null
+++ b/Tools/ros/px4_workspace_create.sh
@@ -0,0 +1,7 @@
+#!/bin/sh
+# this script creates a catkin_ws in the current folder
+
+mkdir -p catkin_ws/src
+cd catkin_ws/src
+catkin_init_workspace
+cd ..