aboutsummaryrefslogtreecommitdiff
path: root/Tools/ros/docker/px4-ros-full/scripts/setup-workspace.sh
blob: 2de5f8bec9dd78fe05873e74dc6fcecca977100f (plain) (blame)
1
2
3
4
5
6
7
8
9
10
11
12
13
14
15
16
17
18
19
20
21
22
23
24
25
26
27
28
29
30
31
32
33
34
35
36
37
38
39
40
41
42
43
44
45
#!/bin/sh
#
# 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

# 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