Quantcast
Channel: ArduPilot Discourse - Latest topics
Viewing all 47022 articles
Browse latest View live

New Fixed Wing AUTOLAND mode

$
0
0

Using an autoland mission sequence with RTL_AUTOLAND is highly recommmended to prevent failsafes simply returning and loitering at home until battery or fuel runs out and the plane glides randomly down to earth on the loiter path. But that means you have to know and program a mission with the correct landing approach direction.

ArduPiot has just merged into “master”, or also know as “dev or 4.7dev”, code a new flight mode: AUTOLAND. If an automatic takeoff has occurred, either by a mission NAV_TAKEOFF, or Mode TAKEOFF, mode AUTOLAND will automatically land a fixed wing mode plane or a QuadPlane if capable of fixed wing landings) like a normal mission based autolanding.

It will setup a parameterized base leg and final approach waypoint and altitude, opposite the home location from the takeoff direction, and proceed to it and switch to an automatic landing at home. It can also be selected as a FS_LONG_ACTION for failsafes.

This is useful when programming a mission with a DO_LAND_START landing sequence is not convenient since it requires a GCS on a laptop or phone, such as traveling with impromptu stops to fly FPV or photograph. Simply use Mode TAKEOFF or a simple mission that was loaded before travel with a single NAV_TAKEOFF waypoint. It is also useful for fields which have varying wind directions, which would prevent using a single home-loaded autolanding mission or require using the MissionSelector LUA script to select from several missions with different approaches.

To use simply make an automatic takeoff and at any point later, switch into AUTOLAND. A final approach waypoint will be created behind the HOME landing target at :ref:AUTOLAND_WP_DIST<AUTOLAND_WP_DIST> (400m by default) at :ref:AUTOLAND_WP_ALT<AUTOLAND_WP_ALT> (55m by default)using the takeoff direction plus :ref:AUTOLAND_DIR_OFF<AUTOLAND_DIR_OFF> (“0” default) and land using all the parametrics of a normal autolanding. A base leg to the final approach waypoint is also created at the same altitude and 1/3 :ref:AUTOLAND_WP_DIST<AUTOLAND_WP_DIST> from the final approach waypoint as shown below:

LAND parameter defaults are usually acceptable for most planes in the 1-2m wingspan, <2kg class) and should yield a safe, if not optimally tuned, autolanding. LAND parameters can be optimized with test flights.

see file: https://ardupilot.org/plane/docs/mode_autoland.html

5 posts - 2 participants

Read full topic


Quad motor setup sanity check

$
0
0

Hi all,

I’m building an experimental quad motor fixed wing vehicle that I’d appreciate a quick sanity check on before I commit to the final design.

As this is an experimental design, I have intentionally over spec’d for redundancy & resilience, and so I’m intending to split the inboard and outboard engines into pairs on their own circuits.

Each motor pair will run on their own 4in1 Holybro Tekko32 F4 65A with a dedicated 4s 60C 5000mAh lipo. Initially, each motor will only pull ~24A(ish) but might rise to ~42A each on my next testing phase. So a total of ~50A to ~90A on each circuit ultimately, though this is still well within each ESC’s rating.

An H743-Wing FC (running Plane) will be powered by it’s own 2200mAh lipo, and each ESC wired directly to its own battery pack not the FC, with only signals running back to the FC (all gnds tied obviously).

The receiver is a DBR4 Gemini Xrossband running on both frequencies, again for resilience.

So my main concern is am I likely to run into any gotchas running a pair of 4in1 ESCs with only 2 motors on each? Is anything likely to complain about this setup?

Cheers,

~N

5 posts - 4 participants

Read full topic

Pixhawk V6X FMU LED Blinking blue

$
0
0

Hello. I need some help. I am using Pixhawk V6X flight controller and Neo 3 M9N GPS in my quadcopter. When I armed at starting my drone make stable flight up to 40 m. But after that it get disarmed from 15m height. But it not cause any external damage to the hardware. After that when I reconnect power supply my GPS and flight controller not working and when I connect it with Mission Planner it shows message Config error and then reboot. As I am flying my drone in College campus which is a government Institute and comes under Yellow zone hence may be my GPS get locked. Also there is another interesting thing is that when I am connecting Pixhawk with power supply its FMU LED is Blinking at very fast rate for around 4 seconds in blue color and then goes off. I cant understand what it is indicating. FMU LED is single rectangular LED present near SD card slot (not 3 LEDs)Please give me solution how can I start my GPS and flight controller again.

1 post - 1 participant

Read full topic

Trouble connecting my ELRS receiver to the FC

$
0
0

Hi everyone, I am setting up a new talon, it’s running a f405 WING from speedybee. I have connected a happymodel ELRS receiver to UART 6, and changed its protocol to RCIN, and configured the correct baud rate, which is 921, but Mission Planner still won’t recognize the RC input. On the radio calibration page, the green bars never move. My transmitter is connected to the elrs reciever, as shown by the solid light on the receiver, but the flight controller still won’t recognize any input. Any idea on what other parameters I could change? No other uart is running the RCIN protocol, and it should be active.

Everything is up to date, I am running Plane 4.5.7, and the newest version of Mission Planner.

7 posts - 4 participants

Read full topic

The MavProxy Map and Console Don't Open

$
0
0

When I run the “python3 ~/ardupilot_v1_1_backup/ardupilot_v1_1/Tools/autotest/sim_vehicle.py -v ArduPlane --console --map -w” command, the MavProxy console and map don’t show up. I tried reinstalling the matplotlib, did not work. Also I cannot connect to mission planner. I feel like this has something to do with it too.

2 posts - 2 participants

Read full topic

Log files from 10 dec 24

$
0
0

PM02D & Pixhawk 6X - Unhealthy battery in mission planner

$
0
0

I have a Pixhawk 6x and am powering it via HolyBro’s PM02D. I followed their documentation and set the following parameters:

  • BATT_MONITOR = 21

  • BATT_I2C_BUS = 1

  • `BATT_I2C_ADDR’ = 65

But I am still seeing 0v and 0A for Bat1. I’m also seeing PreArm: Battery 1 unhealthy.

I did check the battery and all cells are balanced, appropriate voltage at 4.2V, etc. Also as a sanity check- yes I have plugged into the power1 slot. Anyone know what could be going wrong?

myparams.param (18.1 KB)

2 posts - 1 participant

Read full topic

Matek Q8M no GPS fix on flight controller

$
0
0

Hi everyone,
I am quite new to ardupilot (not to RC though) and I am having a harsh time trying to get a GPS fix with my flight controller.
The hardware I am using is listed below :

To sum up the situation :
When I connect the GPS module to U-center I can modify the different parameters in the configuration view (baud rate, update rate) and I can get a GPS fix in about 1 minute if I put the GPS antenna outside.
Then, when I connect the GPS module to the flight controller, I got “No GPS” error. I found that changing the Baudrate to 57600 solved this issue.
However, now even if the GPS module is recognized by the flight controller, I get no fix (even after 5-10 min). Worse than that, I can see that the sat_count is zero in the menu.
I tried to change different parameters in the configuration menu :

  • I tried : “disable auto config”
  • GPS type : “uBlox”
  • GPS Update rate : “10Hz”

I would greatly appreciate any help or advice on the matter because I must admit that I am quite lost at the moment.
Thank you in advance,
John

2 posts - 2 participants

Read full topic


Pixhawk - Raspberry Pi

$
0
0

Hi group! Please excuse my newbie, I just bought a Pixhawk with the Raspberry Pi included and the question is that I need to know if there is no other device that can control my airplane except my PC. Thanks in advance

3 posts - 2 participants

Read full topic

Unable to Connect Mission Planner to ArduPlane

$
0
0

I’m using Mission Planner and MAVProxy for communication with ArduPilot. Despite successfully running MAVProxy and having it listen on 127.0.0.1:14560, Mission Planner is unable to connect. It just says “Mavlink Connecting…” I’ve waited for a couple of minutes but nothing happens. I’ve tried changing ports but the issue persists. Any advice on how to resolve this connection issue?

1 post - 1 participant

Read full topic

How to enable mavlink message from Autopilot from qgc?

$
0
0

Hi,
I see this command: * Send REQUEST_DATA_STREAM messages to set the rate for groups of messages

Which is used to retrieve all messages, but it got deprecated,

How do we retrieve all messages instead of just one msg ID?

MAV_CMD_SET_MESSAGE_INTERVAL (511) allows for just 1 msg id

2 posts - 2 participants

Read full topic

Issue with Arm: "Battery 1 Low Voltage Failsafe" Error

$
0
0

Hello,

I’m experiencing an issue with my drone that prevents it from arming. Here’s what happens:

  1. When the battery is not connected and I try to arm using the arm switch, the error message appears:
  • “Arm: Logging failed”
  • “Arm: Battery 1 low voltage failsafe”
  1. When the battery is connected, the quadcopter remains unarmed and gives the following messages:
  • “Battery failsafe”
  • “Arm: Logging failed”

My Setup and Observations:

  • Battery: I’m using a brand-new 4S, 3300mAh LiPo battery.
  • Failsafe Settings and Initial Tune Parameters: Shown in the attached images.
  • Battery Voltage: The battery voltage seems fine.
  • Connections: All connections between the battery and the power module are secure.

What I Tried:

  • I found some troubleshooting tips online and applied them, but the issue persists.
  • Turning off arming checks allowed me to arm the quadcopter, but I’d prefer to resolve the root cause rather than bypassing the checks.

I’d appreciate any suggestions or guidance on how to resolve this issue.

Thank you in advance!

Best regards,
Michail.



5 posts - 2 participants

Read full topic

How to control a Rover with some "virtual" RC output?

$
0
0

Hi,

I have a rover that I am reverse engineering to just do simple motion control. Since it doesn’t use any known protocols, I can’t just wire up the ArduPilot board (I’m using RPI + Navio) to the rover.

But I do have ability to modify the remote control, so I have rewired its joystick style potentiometers, and now the remote-control board receives input from an ESP32 that I own.

In ArduRover I would like to get the RC outputs locally on the Linux machine, so I can then transform those into commands that I need to send to the ESP32.

I think I have a workaround, to just connect SBUS from NAVIO directly to the GPIO of the RPI, but I would prefer not doing that.

Any ideas on how to proceed?

Thanks!

1 post - 1 participant

Read full topic

Plane will not maintain centerline during the takeoff roll

$
0
0

I am pretty new to all this, so please don’t hesitate even the stupidest mistakes. What are the steps to troubleshoot?

oh, and before you point me at the other topics on the forum, I did search, and I found this Plane will not stay on runway during autonomous takeoff but it is for PX4 and and they didn’t really resolve the issue there either.

2 posts - 2 participants

Read full topic

Significant Current Draw Increase After Damping Vibrations

$
0
0

I recently encountered vibration issues which I believe has to do with 120Hz vibrations on the Z-axis and harmonic resonance with my Pixhawk 6X. After trying multiple solutions without success, I decided to use this 3D-printed anti-vibration mount: Thingiverse Link.

This anti vibration mount reduced my vibrations down to extremely low levels that I’m very happy with, However I also noticed my current draw has doubled, No weight was added, I’ve attached both logs below, I crashed at the end of the second log due to performing heavy maneuvers without tuning ( me being dumb ).

Drone Information:
Hexcopter
Pixhawk 6X
6S 6000mAH HRB Batteries 25C ( x2 Parallel )
GARTT 5008 400KV Motors with 1755 Propellers
Holybro F9P Rover DroneCAN (Primary GPS)
M10 (Secondary GPS)

https://www.mediafire.com/file/3j9j51h6v1eyq7b/log_32_2025-1-1-13-29-18.bin/file
https://www.mediafire.com/file/sadxhyv3oe04ke6/log_33_2025-1-1-16-48-18.bin/file

1 post - 1 participant

Read full topic


Tilt rotor p gain

Obstacle avoiding sensor TFMINI V1.8.1 issue with avoiding object in loiter and other modes

$
0
0

hi friend am using in my multicopter using tfmini v1.8.1 sensor for my copter front, back, right and left 4 sensor, when am flying in loiter mode i kept avoid setting to stop if the object detect with in 2 meter but copter not yet stop. then i kept to slid option this function also not working. can you help me out this issue.

Common settings:
AVOID_ENABLE = 1 [0 = UseFence; 1 = UseProximitySensor; 2 = UseBeaconFence;]
AVOID_MARGIN = 4 [Can be 1 to 10m; Vehicle will attempt to stay at least this distance (in meters)
from objects while in GPS modes]
PRX1_TYPE = 4 [RangeFinder]
Settings for first TFmini-S:
RNGFND1_ADDR = 16 [Address of 1 TFmini-S in decimal (0x10 = 16)]
RNGFND1_GNDCLEAR = 25 [Unit: cm, depending upon mounting height of the module and should
be larger LiDAR than non-detection zone]
RNGFND1_MAX_CM = 400 [It could be changed according to real demands but should be smaller
than effective measure range of LiDAR, unit is cm]
RNGFND1_MIN_CM = 30 [It could be changed according to real demands and should be larger than
LiDAR non-detection zone, unit is cm]
RNGFND1_ORIENT = 0 [1 TFmini-S real orientation]
RNGFND1_TYPE = 25 [TFmini-S IIC same as TFmini-Plus IIC]
Settings for second TFmini-S:
RNGFND2_ADDR = 17 [Address of #2 TFmini-S in decimal; (0x11 = 17)]
RNGFND2_GNDCLEAR = 25
RNGFND2_MAX_CM = 400
RNGFND2_MIN_CM = 30
RNGFND2_ORIENT = 1 [#2 TFmini-S real orientation]
RNGFND2_TYPE = 25 [TFmini-S IIC same as TFmini-Plus IIC]

liker this am using my 4 sensors

1 post - 1 participant

Read full topic

ArduSoar - 2025

$
0
0

ArduSoar in 2025

The purpose of this blog is to document my process to reproduce a vehicle to run ArduSoar but with a modern twist - adding a Companion Computer with ROS 2. It’s been a while since I’ve tuned a vehicle from scratch, so here goes…

Goals

Preliminary goals:

  • Install ArduPilot cleanly on a Parkzone Radian with a companion computer WITHOUT a ton of extra drag
  • Swappable battery
  • Demonstrate the hardware build, configuration, tuning, and improve the documentation/tools as I go
  • Request help from others as I need (I’m far from a tuning expert) so I can learn
  • Have this blog be detailed enough that anyone who’s built an ArduPlane before be able to reproduce it

Longer term goals:

  • Improve the soaring algorithms in ArduPilot (altitude limits relative to terrain, leverage thermal drift better, improve the state estimator)
  • Leverage offboard compute on the companion computer to improve soaring capabilities
  • Improve the ROS 2 interface to better support the state information and controls channels that soaring needs
  • Add better MAVProxy visualization of what the soaring controller is doing (see the thermal estimates in the UI)

Parts List (to be updated)

Note: prices in USD

1 post - 1 participant

Read full topic

Using a server to transmit telemetry

$
0
0

On the drone via Mavrouter (I also used MavProxy) I configured the transmission of telemetry to the server, everything works correctly. I don’t understand how I can connect to the server from my computer to receive telemetry. I tried using UDP with transmission to 0.0.0.0, to 127.0.0.1 and to the server IP, but it didn’t work in all cases. I can’t figure out what the problem is, in the server settings or MavProxy. All ports are open on the server, the ports for receiving and transmitting telemetry are different. This is what MavProxy startup looks like on the server: mavproxy.py --master=udp:0.0.0.0:14550 --out=udp:0.0.0.0:14551

1 post - 1 participant

Read full topic

Message Mag field ici4

$
0
0

hello, I have a problem with mag field, I explain I have an ici4 and I wanted to use it in FC mode in a boat, I installed the rover firmware 4.5.0 and everything was fine but at one point I had no more lights, so I installed the rover firmware 4.5.7 and the lights started working but since doing the calibration I always have a Mag field message does anyone know what I have to do to fix this.

2 posts - 1 participant

Read full topic

Viewing all 47022 articles
Browse latest View live


Latest Images