2019-03-15 01:37:23 -03:00
|
|
|
#! /bin/bash
|
|
|
|
|
|
|
|
DIR=$( cd "$( dirname "${BASH_SOURCE[0]}" )" && pwd )
|
|
|
|
PX4_SRC_DIR=${DIR}/..
|
|
|
|
|
|
|
|
source /opt/ros/${ROS_DISTRO:-kinetic}/setup.bash
|
|
|
|
mkdir -p ${PX4_SRC_DIR}/catkin_ws/src
|
|
|
|
cd ${PX4_SRC_DIR}/catkin_ws/
|
2019-10-07 12:13:17 -03:00
|
|
|
git clone -b 0.3.1 --single-branch --depth 1 https://github.com/PX4/avoidance.git src/avoidance
|
2019-03-15 01:37:23 -03:00
|
|
|
|
|
|
|
catkin init
|
2019-08-02 08:10:19 -03:00
|
|
|
catkin build local_planner safe_landing_planner --cmake-args -DCMAKE_BUILD_TYPE=Release
|
2019-03-15 01:37:23 -03:00
|
|
|
|
|
|
|
source ${PX4_SRC_DIR}/catkin_ws/devel/setup.bash
|
|
|
|
source /usr/share/gazebo/setup.sh
|
|
|
|
|
|
|
|
export CATKIN_SETUP_UTIL_ARGS=--extend
|
2019-08-02 08:09:48 -03:00
|
|
|
export GAZEBO_MODEL_PATH=$GAZEBO_MODEL_PATH:${PX4_SRC_DIR}/catkin_ws/src/avoidance/avoidance/sim/models
|
2019-03-15 01:37:23 -03:00
|
|
|
|
|
|
|
source $DIR/rostest_px4_run.sh "$@"
|