aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/vagrant/px4-ros/Vagrantfile
diff options
context:
space:
mode:
Diffstat (limited to 'Tools/ros/vagrant/px4-ros/Vagrantfile')
-rw-r--r--Tools/ros/vagrant/px4-ros/Vagrantfile10
1 files changed, 5 insertions, 5 deletions
diff --git a/Tools/ros/vagrant/px4-ros/Vagrantfile b/Tools/ros/vagrant/px4-ros/Vagrantfile
index 7009fd78a..a122fb4a3 100644
--- a/Tools/ros/vagrant/px4-ros/Vagrantfile
+++ b/Tools/ros/vagrant/px4-ros/Vagrantfile
@@ -12,12 +12,12 @@
# (will change, need proper docs)
#
# Build with multiple dependent docker containers:
-# Use the "--no-parallel" option so the containers will be built in order.
+# Use the "--no-parallel" option so the containers will be built/started in order.
# e.g.: "vagrant up --no-parallel"
#
# Running apps directly:
# "vagrant docker-run ros -- <cmd>"
-# Attention: will loose all data when stopped, vagrant runs this with "--rm"
+# Attention: will loose all data when stopped, vagrant runs docker always with "--rm"
#
# TODO
# - do not run the docker container with "--rm" (vagrant default). is that even possible?
@@ -35,9 +35,9 @@ Vagrant.configure(2) do |config|
config.vm.define "ros" do |app|
app.vm.provider "docker" do |d|
d.name = "ros"
- #d.image = "px4ros/ros-base"
- d.build_dir = "../../docker/px4-ros-base"
- d.build_args = ["-t=px4ros/ros-base:no-drcsim"]
+ d.image = "uaventure/px4-ros-full"
+ #d.build_dir = "../../docker/px4-ros-full"
+ #d.build_args = ["-t=uaventure/px4-ros-full"]
# Share docker host x11 socket
# Run privileged to support 3d acceleration