All Projects → mirkix → Ardupilotblue

mirkix / Ardupilotblue

Licence: gpl-3.0
Howto use BeagleBone Blue with ArduPilot

Labels

Projects that are alternatives of or similar to Ardupilotblue

CodeDroneDIY
The most simple, but working, quadricopter flight controller from scratch, using Arduino Uno/Nano.
Stars: ✭ 68 (-42.37%)
Mutual labels:  uav, drone
Mavgcl
In-Flight Analysis for PX4
Stars: ✭ 96 (-18.64%)
Mutual labels:  drone, uav
olympe
Python controller library for Parrot Drones
Stars: ✭ 62 (-47.46%)
Mutual labels:  uav, drone
Gaas
Generalized Aviation: Open source autonomous aviation software platform, designed for fully autonomous drones and flying cars.
Stars: ✭ 1,377 (+1066.95%)
Mutual labels:  drone, uav
Onboard Sdk
DJI Onboard SDK Official Repository
Stars: ✭ 669 (+466.95%)
Mutual labels:  drone, uav
uav core
The main integrator of MRS UAV packages in ROS, part of the "mrs_uav_system".
Stars: ✭ 28 (-76.27%)
Mutual labels:  uav, drone
Mrs uav system
The entry point to the MRS UAV system.
Stars: ✭ 64 (-45.76%)
Mutual labels:  drone, uav
UAV-Stereo-Vision
A program for controlling a micro-UAV for obstacle detection and collision avoidance using disparity mapping
Stars: ✭ 30 (-74.58%)
Mutual labels:  uav, drone
Px4 Autopilot
PX4 Autopilot Software
Stars: ✭ 5,090 (+4213.56%)
Mutual labels:  drone, uav
Quadrotor
Quadrotor control, path planning and trajectory optimization
Stars: ✭ 331 (+180.51%)
Mutual labels:  drone, uav
groundsdk-android
Parrot Ground SDK for Android
Stars: ✭ 17 (-85.59%)
Mutual labels:  uav, drone
Mavigator
Virtual cockpit for UAVs
Stars: ✭ 8 (-93.22%)
Mutual labels:  drone, uav
zubax gnss
Zubax GNSS module
Stars: ✭ 45 (-61.86%)
Mutual labels:  uav, drone
dji-tello
Java API for the DJI Tello Drone.
Stars: ✭ 13 (-88.98%)
Mutual labels:  uav, drone
QGISFMV
QGIS Full Motion Video (FMV)
Stars: ✭ 104 (-11.86%)
Mutual labels:  uav, drone
grvc-ual
An abstraction layer for unmanned aerial vehicles
Stars: ✭ 35 (-70.34%)
Mutual labels:  uav, drone
FlyingCarUdacity
🛩️⚙️ 3D Planning, PID Control, Extended Kalman Filter for the Udacity Flying Car Nanodegree // FCND-Term1
Stars: ✭ 16 (-86.44%)
Mutual labels:  uav, drone
gobot
Golang framework for robotics, drones, and the Internet of Things (IoT)
Stars: ✭ 7,869 (+6568.64%)
Mutual labels:  uav, drone
M4Depth
Official implementation of the network presented in the paper "M4Depth: A motion-based approach for monocular depth estimation on video sequences"
Stars: ✭ 62 (-47.46%)
Mutual labels:  uav, drone
Ardupilot
ArduPlane, ArduCopter, ArduRover, ArduSub source
Stars: ✭ 6,637 (+5524.58%)
Mutual labels:  drone, uav

BeagleBone Blue

Howto use BeagleBone Blue with ArduPilot

alt text

alt text

Hardware

alt text

Receiver

Since 17.01.2018 you can use the DSM2 connector or connector E4 pin 4 on your BealgeBone Blue.

Before 17.01.2018 the RC receiver signal has to be connected to connector E4 pin 4. This pin is a multi protocol pin (S.BUS, PPM-Sum, Spektrum Satellit DSM), the protocol will be automatically detected. Make sure the signal does not exceed 3.3 volts, otherwise your BeagleBone Blue can be damaged.

alt text

Tested receiver

Name Protocol DSM2 connector E4 connector (pin 4) Voltage divider needed
FrSky X8R SBUS not tested working no, 3.3V output
FrSky X6R SBUS not tested working no, 3.3V output
OrangeRx Satellite Receiver DSM working not tested no, 3.3V output

PWM / Servo

If you connect servos to the BeagleBone Blue then keep in mind that power is not applied by default because it is not necessary for ESCs. To enable power add: /bin/echo 1 > /sys/class/gpio/gpio80/value to /etc/rc.local.

alt text

GPS

I recommend to use a u-blox M8N GPS. Connect the GPS to the GPS connector. Make sure the signal does not exceed 3.3 volts, otherwise your BeagleBone Blue can be damaged.

Software

You can follow this guide, but @imfatant has written a realy great ArduPilot Blue beginners guide https://github.com/imfatant/test.

Prepare BeagleBone Blue

  1. Update software: sudo apt update && sudo apt upgrade -y
  2. Install software: sudo apt install -y bb-cape-overlays cpufrequtils
  3. Set clock to 1GHz: sudo sed -i 's/GOVERNOR="ondemand"/GOVERNOR="performance"/g' /etc/init.d/cpufrequtils
  4. Update scripts: cd /opt/scripts && sudo git pull
  5. Maximize the microSD card's existing partition: sudo /opt/scripts/tools/grow_partition.sh
  6. Install RT Kernel 4.9: sudo /opt/scripts/tools/update_kernel.sh --ti-rt-channel --lts-4_9
  7. Specify device tree binary to be used at startup: sudo sed -i 's/#dtb=/dtb=am335x-boneblue.dtb/g' /boot/uEnv.txt
  8. Reboot system: sudo reboot

Prebuild ArduPilot

  1. Download ready compiled ArduPilot file from http://bbbmini.org/download/blue/
  2. Copy file via SCP or microSD on your BeagleBone Blue

Run ArduPilot

ArduCopter: sudo /home/debian/arducopter (plus parameter)

ArduPlane: sudo /home/debian/arduplane (plus parameter)

ArduRover: sudo /home/debian/ardurover (plus parameter)

Parameter mapping:

start parameter ArduPilot serial port
-A SERIAL0
-B SERIAL3
-C SERIAL1
-D SERIAL2
-E SERIAL4
-F SERIAL5

Check http://ardupilot.org/copter/docs/parameters.html#serial0-baud-serial0-baud-rate to set the right value for SERIALx_BAUD and SERIALx_PROTOCOL

To connect a MAVLink groundstation with IP 192.168.178.26 add -C udp:192.168.178.26:14550

To use MAVLink via radio connected to UART4 add -C /dev/ttyO4.

If there is a GPS connected to UART5 add -B /dev/ttyO5.

Example: MAVLink groundstation with IP 192.168.178.26 on port 14550 and GPS connected to /dev/ttyO5 UART5.

sudo /home/debian/arducopter-quad -C udp:192.168.178.26:14550 -B /dev/ttyO5

Example: MAVLink groundstation via radio connected to UART4 and GPS connected to /dev/ttyO5 UART5.

sudo /home/debian/arducopter-quad -B /dev/ttyO5 -C /dev/ttyO4

License

Creative Commons License
BeagleBone Blue ArduPilot by Mirko Denecke is licensed under a Creative Commons Attribution-ShareAlike 4.0 International License.

UNLESS OTHERWISE MUTUALLY AGREED TO BY THE PARTIES IN WRITING, LICENSOR OFFERS THE WORK AS-IS AND MAKES NO REPRESENTATIONS OR WARRANTIES OF ANY KIND CONCERNING THE WORK, EXPRESS, IMPLIED, STATUTORY OR OTHERWISE, INCLUDING, WITHOUT LIMITATION, WARRANTIES OF TITLE, MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE, NONINFRINGEMENT, OR THE ABSENCE OF LATENT OR OTHER DEFECTS, ACCURACY, OR THE PRESENCE OF ABSENCE OF ERRORS, WHETHER OR NOT DISCOVERABLE. SOME JURISDICTIONS DO NOT ALLOW THE EXCLUSION OF IMPLIED WARRANTIES, SO SUCH EXCLUSION MAY NOT APPLY TO YOU. EXCEPT TO THE EXTENT REQUIRED BY APPLICABLE LAW, IN NO EVENT WILL LICENSOR BE LIABLE TO YOU ON ANY LEGAL THEORY FOR ANY SPECIAL, INCIDENTAL, CONSEQUENTIAL, PUNITIVE OR EXEMPLARY DAMAGES ARISING OUT OF THIS LICENSE OR THE USE OF THE WORK, EVEN IF LICENSOR HAS BEEN ADVISED OF THE POSSIBILITY OF SUCH DAMAGES.

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].