Installation instructions are based on this document. Special thanks to @AnaBatinovic.
pip install -U pymavlink
pip install -U mavproxy
sudo apt install libgeographic-dev
sudo apt install ros-melodic-mavlink
sudo apt install ros-melodic-mavros ros-melodic-mavros-msgs
sudo apt install ros-melodic-octomap-ros ros-melodic-joy
sudo apt install python-wstool python-catkin-tools protobuf-compiler libgoogle-glog-dev
sudo apt install git gitk git-gui
sudo apt install geographiclib-doc geographiclib-tools libgeographic17 node-geographiclib
cd /opt/ros/melodic/lib/mavros/
sudo ./install_geographiclib_datasets.sh
Note: If building Mavros from source locate the install_geographiclib_datasets.sh script inside your local Mavros source folder.
cd ~/
git clone https://github.com/ArduPilot/ardupilot.git
cd ardupilot
git submodule update --init --recursive
cd Tools/environment_install
./install-prereqs-ubuntu.sh -y
echo 'export PATH=$PATH:$HOME/ardupilot/Tools/autotest' >> ~/.bashrc
echo 'export PATH=/usr/lib/ccache:$PATH' >> ~/.bashrc
pip install mavproxy
source ~/.bashrc
For additional information see: Setting up the Build Environment(Linux/Ubuntu).
Navigate to your catkin workspace or create it as follows.
mkdir -p ~/catkin_ws/src
cd ~/catkin_ws
catkin init
catkin config --extend /opt/ros/melodic
catkin config --cmake-args -DCMAKE_BUILD_TYPE=Release
cd ~/catkin_ws
catkin build
echo "source ~/catkin_ws/devel/setup.bash" >> ~/.bashrc
source ~/.bashrc
Download and install the following catkin packages.
cd ~/catkin_ws/src
git clone https://github.com/larics/rotors_simulator
cd rotors_simulator
git checkout larics_melodic_master
cd ~/catkin_ws/src
git clone https://github.com/larics/mav_comm
cd mav_comm
git checkout larics_master
cd ~/catkin_ws/src
git clone https://github.com/larics/ardupilot_gazebo
cd ardupilot_gazebo
git checkout larics_master
echo "source ~/catkin_ws/src/ardupilot_gazebo/scripts/shell_scripts.sh" >> ~/.bashrc
echo "source /usr/share/gazebo/setup.sh" >> ~/.bashrc
echo "export GAZEBO_MODEL_PATH=~/catkin_ws/ardupilot_gazebo/models:$GAZEBO_MODEL_PATH" >> ~/.bashrc
echo "export GAZEBO_PLUGIN_PATH=~/catkin_ws/build/ardupilot_gazebo:${GAZEBO_PLUGIN_PATH}" >> ~/.bashrc
source ~/.bashrc
Donwload optional packages:
- storm_gazebo_ros_magnet - electromagnet plugin for Gazebo
- velodyne_simulator - velodyne plugin for Gazebo
Finally build your catkin workspace.
cd ~/catkin_ws
catkin build
source ~/.bashrc