Questions tagged [mavlink]

MAVLink or Micro Air Vehicle Link is a protocol for communicating with small unmanned vehicle.

MAVLink or Micro Air Vehicle Link is a protocol for communicating with small unmanned vehicle. It is designed as a header-only message marshaling library. MAVLink was first released early 2009 by Lorenz Meier under LGPL license.

79 questions
1
vote
0 answers

how do I request enum values from a drone via mavlink?

I am programming a drone with java script and using node-mavlink https://github.com/padcom/node-mavlink. I am trying to figure out how to detect if the drone is taking off, in the middle of flying or landing. When I read the mavlink documentation it…
codes
  • 21
  • 4
1
vote
1 answer

How to implement mavlink nodejs module on Angular Web App

I have a project in which i need to create an app that is similar to mission planner but in web based form. I am using angular as a frontend development framework. Is there a way to use mavlink module in client side (browser) ? if there is, how can…
1
vote
1 answer

Why does Dart FFI generate an opaque class from this C struct?

I want to use the MAVLink C library to parse MAVLink packets in dart, but the Dart FFI generated mavlink_message_t is an opaque class, while other structs like mavlink_system_t are generated normally with all their attributes. What is the reason for…
alielbashir
  • 315
  • 2
  • 9
1
vote
2 answers

Mavlink command what does the [180] means?

I am trying to send a mavlink command for instance GPS_RTCM_DATA ( #233 ) flags uint8_t len uint8_t data uint8_t[180] RTCM message (may be fragmented) https://mavlink.io/en/messages/common.html#GPS_RTCM_DATA I understand…
Joseph Lim
  • 11
  • 1
  • 4
1
vote
1 answer

ImportError: No module named future Despite having it installed

The catkin build fails due to Errors << mavlink:make /home/eia-lab1/catkin_ws/logs/mavlink/build.make.005.log Traceback (most recent call last): File "/home/eia-lab1/catkin_ws/src/mavlink/pymavlink/tools/mavgen.py", line 16, in
1
vote
2 answers

How to convert a Gazebo world to a point cloud?

I am using the PX4 toolchain to build an autonomous UAV. I am using it through the Gazebo simulator, using ROS and MAVROS. For now, I need to work on path finding algorithms, not sensors, so I would like a "ground truth" map of a Gazebo simulation.…
R. Hidra
  • 21
  • 6
1
vote
2 answers

receiving and sending mavlink messages using pymavlink library

I have created a proxy between QGC(Ground Control Station) and vehicle in Python. Here is the code: gcs_conn = mavutil.mavlink_connection('tcpin:localhost:15795') gcs_conn.wait_heartbeat() print("Heartbeat from system (system %u component %u)"…
Taimaz
  • 19
  • 1
  • 3
1
vote
0 answers

DroneKit Joystick Override

I'm trying to figure out if it's possible to use DroneKit to override joystick control when it's enabled in Mission Planner. In my scenario if I enable joystick in Mission Planner and forcibly close Mission Planner, the joystick still maintains…
Josh
  • 11
  • 2
1
vote
1 answer

Bidirectional data transfer- serial to Eth (Socat) (RPi)

I appear stuck and am calling for help! I have a RPi3 B+ model connected via GPIO pins 14/15 (/dev/ttyS0) to Pixhawk using the Mavlink Comm protocol working! Code: Select all $ sudo -s $ mavproxy.py --master=/dev/ttyS0 --baudrate 57600 can add also…
1
vote
1 answer

ROS mavros build error

Hardware: Raspberry Pi 3 OS: Raspbian Stretch ROS: Kinetic When attempting to add mavros to a pre-made image, I rosdep throws an error. Following instructions from source installation instructions, I end up at line: rosdep install --from-paths src…
Josh
  • 2,232
  • 3
  • 15
  • 33
1
vote
1 answer

vehicle.location.local_frame return none

I use px4 AC3.5.4 with raspberry. My target is autonomous positioning drone in his local frame without global (gps). I arming drone in GUIDED_NOGPS mode and takeoff. I make request for my position in local frame with next command:…
1
vote
1 answer

Geofence with pymavlink or dronekit-python

I'm trying to set fence for the copter using dronekit-python.I found command MAV_CMD_NAV_FENCE_CIRCLE_INCLUSION in this document. But it doesn't work when I use the vehicle.message_factory.command_long_send (which is the function command_long_send…
whxru
  • 11
  • 3
1
vote
1 answer

mavROS, SITL ArduPlane: commands in GUIDED mode are rejected

A simple python script publishes commands to the mavros node which is connected to an arduplane SITL instance. Succesfully publishing to change mode from AUTO to GUIDED (so no connection or other issues). After changing, the plane is…
foxTox
  • 128
  • 1
  • 8
1
vote
0 answers

Dronekit apm2.6 rpi3 not receiving velocity commands

Currently have a raspberry pi connected through mavlink to an apm2.6 running arducopter 3.2.1. I am able to run a python script that can arm and take off the drone no problem, but when I try to send velocity commands to move the quad in a direction…
1
vote
1 answer

How can I install pymavlink to Raspberry?

I wrote this command to install: sudo pip install pymavlink and got this error: ImportError: No module named future ---------------------------------------- Cleaning up... Command /usr/bin/python -c "import setuptools,…
fthglsy
  • 11
  • 3