aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/docker/px4-ros-full
diff options
context:
space:
mode:
Diffstat (limited to 'Tools/ros/docker/px4-ros-full')
-rw-r--r--Tools/ros/docker/px4-ros-full/Dockerfile1
-rw-r--r--Tools/ros/docker/px4-ros-full/README.md2
-rw-r--r--Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh2
3 files changed, 5 insertions, 0 deletions
diff --git a/Tools/ros/docker/px4-ros-full/Dockerfile b/Tools/ros/docker/px4-ros-full/Dockerfile
index 9c0fbc688..1242b56b5 100644
--- a/Tools/ros/docker/px4-ros-full/Dockerfile
+++ b/Tools/ros/docker/px4-ros-full/Dockerfile
@@ -1,6 +1,7 @@
#
# PX4 full ROS container
#
+# License: according to LICENSE.md in the root directory of the PX4 Firmware repository
FROM ubuntu:14.04.1
MAINTAINER Andreas Antener <andreas@uaventure.com>
diff --git a/Tools/ros/docker/px4-ros-full/README.md b/Tools/ros/docker/px4-ros-full/README.md
index 7d75754d9..af5170c70 100644
--- a/Tools/ros/docker/px4-ros-full/README.md
+++ b/Tools/ros/docker/px4-ros-full/README.md
@@ -2,6 +2,8 @@
Full desktop ROS container.
+License: according to LICENSE.md in the root directory of the PX4 Firmware repository
+
**TODO:**
- use https://github.com/phusion/baseimage-docker as base
diff --git a/Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh b/Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh
index 231166e27..2de5f8bec 100644
--- a/Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh
+++ b/Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh
@@ -3,6 +3,8 @@
# Create workspace at current location and fetch source repositories
#
+# License: according to LICENSE.md in the root directory of the PX4 Firmware repository
+
WDIR=`pwd`
WORKSPACE=$WDIR/catkin_ws