You can not select more than 25 topics
Topics must start with a letter or number, can include dashes ('-') and can be up to 35 characters long.
|
|
|
#!/bin/sh
|
|
|
|
# run this script from the root of your catkin_ws
|
|
|
|
source devel/setup.bash
|
|
|
|
cd src
|
|
|
|
|
|
|
|
# PX4 Firmware
|
|
|
|
git clone https://github.com/PX4/Firmware.git
|
|
|
|
cd Firmware
|
|
|
|
git checkout ros
|
|
|
|
cd ..
|
|
|
|
|
|
|
|
# euroc simulator
|
|
|
|
git clone https://github.com/PX4/euroc_simulator.git
|
|
|
|
cd euroc_simulator
|
|
|
|
git checkout px4_nodes
|
|
|
|
cd ..
|
|
|
|
|
|
|
|
# mav comm
|
|
|
|
git clone https://github.com/PX4/mav_comm.git
|
|
|
|
|
|
|
|
# glog catkin
|
|
|
|
git clone https://github.com/ethz-asl/glog_catkin.git
|
|
|
|
|
|
|
|
# catkin simple
|
|
|
|
git clone https://github.com/catkin/catkin_simple.git
|
|
|
|
|
|
|
|
cd ..
|
|
|
|
|
|
|
|
catkin_make
|