aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/px4_workspace_create.sh
diff options
context:
space:
mode:
Diffstat (limited to 'Tools/ros/px4_workspace_create.sh')
-rwxr-xr-xTools/ros/px4_workspace_create.sh1
1 files changed, 1 insertions, 0 deletions
diff --git a/Tools/ros/px4_workspace_create.sh b/Tools/ros/px4_workspace_create.sh
index 4055f7320..cf80bcf8d 100755
--- a/Tools/ros/px4_workspace_create.sh
+++ b/Tools/ros/px4_workspace_create.sh
@@ -1,5 +1,6 @@
#!/bin/sh
# this script creates a catkin_ws in the current folder
+# License: according to LICENSE.md in the root directory of the PX4 Firmware repository
mkdir -p catkin_ws/src
cd catkin_ws/src