Questions tagged [dronekit]

DroneKit is for general architectural or setup questions for 3D Robotics drone APIs.

DroneKit is a set of APIs created by 3D Robotics. This tag is specifically for general architectural and setup questions.

108 questions
0
votes
1 answer

Dronekit-Python Error with Raspberrypi4-Ubuntu20.04 "dronekit.APIException"

I'm trying to run the script by python2-3 (alias). This is for drone's flight so I'm using dronekit. But I got this error as below. Please help me to solve this error. Ubuntu20.04 Raspberrypi 4 Board Dronekit 2.9.2 Python2.7 & Python3.8 enter…
0
votes
1 answer

How can I control and receive video stream from SITL drone using px4,gazebo and C++ without using ROS?

I want to program a drone to fly with a C++ project using image processing analysis in real-time (using OpenCV). I want to do it with PX4, Gazebo simulator. The final goal is to run the project on a real drone using Jetson-Nano and Pixhawk drone. I…
Roy Amoyal
  • 717
  • 4
  • 14
0
votes
1 answer

DRONEKIT - WARNING:dronekit:Link timeout, no heartbeat in last 5 seconds

I started to using the Dronekit, Dronekit-STIL and Mavlink to simulate my python scripts. Afters some days using it without problem I started to receive the error: WARNING:dronekit:Link timeout, no heartbeat in last 5 seconds. I had tried to…
Ce8
  • 1
  • 2
0
votes
1 answer

which app does anaconda used to run .py scripts

I was trying to run dronekit-SITL in windows so I downloaded the anaconda so that I can use py-2.7 separately, but when I try to run mavproxy.py script, it shows up a dialog box to choose an app to run the .py file, and when I click on any of the…
0
votes
1 answer

FuncAnimation doesn't respond when after dynamically sending data to plot to move a scatter point

So I'm using FuncAnimation from matplotlib so dynamically plot some data as it arrives from a serial port (in my project is the vehicle class from dronekit, which is displayed with the green dot), what I have basically is the animation called which…
0
votes
1 answer

JRC JJ1000 + dronekit >> ERROR:dronekit.mavlink:Exception in MAVLink input loop

I am trying to connect JRC JJ1000 drone using dronekit + python. when executing the connect command: dronekit.connect('com3', baud=115200, heartbeat_timeout=30) I am getting the following error: ERROR:dronekit.mavlink:Exception in MAVLink input…
Abdulkarim Kanaan
  • 1,703
  • 4
  • 20
  • 32
0
votes
0 answers

PX4 python dronekit, how to move a drone?

I am using a quadrotor drone with PX4 1.8.0 I would like to write a python script which, according to some input, makes the drone moving in a specific direction (e.g. move 5 meters right,left,up down and so on) or making the drone moving to a…
FraD
  • 1
  • 1
0
votes
1 answer

How to hide DroneKit-Python API messages

Quick question. There is any way to hide or suppress messages from DroneKit-Python API (marked in red line)? As a reference, below are the code I use. #!/usr/bin/env python2 # -*- coding: utf-8 -*- # setting up modules used in the program from…
ヲヲヲ
  • 61
  • 7
0
votes
1 answer

GUIDED to LOITER Mode

I'm trying to change the guided mode to loiter when vehicle reaches a point. but as soon as mode changes , the altitude is becoming zero - vehicle crashes in simulator. Do i have specify any altitude before changing to loiter mode ? #change the…
anilkunchalaece
  • 388
  • 2
  • 10
0
votes
1 answer

Calling vehicle = connect() on 2 python code cause connection to drop

I have 2 python codes that run in subprocess, both calling vehicle = connect('/dev/ttyS0', heartbeat_timeout = 30, baud = 57600) simultaneously for different tasks (for radio controller's channels logging, automation, etc). the codes work as…
ヲヲヲ
  • 61
  • 7
0
votes
1 answer

Python, DroneKit, Pixhawk and ArduPilot Mission Planner: how to send text messages via the built-in telemetry to a ground station

I am working on a student project involving a drone which runs on the Pixhawk platform but has a 'companion computer' in the form of a Raspberry Pi. The Pi runs its own Python software and uses DroneKit (and therefore MAVLink?) to communicate with…
jt78
  • 906
  • 2
  • 10
  • 22
0
votes
1 answer

What are the arguments needed for ConnectionParameter?

I've been following 3DR Dronekit-Android step-by-step project to create a mission planner app on Android Studio. I am stuck on creating a method for connecting via UDP. extraParams.putInt(ConnectionType.EXTRA_UDP_SERVER_PORT,…
0
votes
0 answers

Missing events for listeners dronekit

I'm using dronekit and using event listeners to keep a track of camera video recording Status. This is because I didn't find a way to identify the recording status. So I'm keeping track of the commands that I'm sending and changing the modes if they…
Krishna
  • 11
  • 4
0
votes
1 answer

Dronekit Python didn't go to specific location

I have problem about Dronekit on Python My project about receive GPS Location from Android application and Launch drone flying to that Position, Everything work fine but problem is Drone can takeoff but drone didn't go to that Location(Testing 10+…
0
votes
1 answer

How to get Waypoints information from Pixhawk and send it to Raspberry while the mission is uploaded through mission planner?

I am working on a project using a fixed wings UAV. I want to perform RC override when UAV reaches certain waypoints. I have defined the waypoints and uploaded the mission to Pixhawk using Misison Planner I have a 4G module connected to Raspberry Pi…