Plane 4.5 release

Thank you @tridge for your quick response… I have updated the Mission Planner to latest version… Now no more r boot message… All seems normal , but still on ground… I am still currious, is it ok in my case, that I did “JUMP” upgrade from Fw 4.3.7 directly to 4.5.3, bypassing 4.3.8 to 4.5.2 ??

Any advice is highly appreciated.
Thank you
Tony.

yes, I think we still have all the update code in place for 4.3.x still

Plane-4.5.4 has been released as the official/stable version and can be installed using MP, QGC or the firmware can be directly downloaded from firmware.ardupilot.org.

The single change vs 4.5.3 is listed in the ReleaseNotes and copied below

  • Disable highres IMU sampling on ICM42670 fixing an issue on some versions of Pixhawk6X

If you’re using a Pixhawk6X we strongly recommend updating but for other users this release will have no impact.

By the way, some may notice that we released this version without going through the regular beta testing procedure. We decided that this change was small enough that developer level testing was sufficient.

Thanks!

1 Like

più voli fatti ieri con 2 aeri diversi, tutto ok;

non si può perfezionare la flare, visto che il cambio pitch è secco, brusco? Grazie.

In my code only
send_ned_velocity(1,0,0)
send_ned_velocity(0,0,1)
send_ned_velocity(1,0,-1)
and yaw are working correctly.
But -Vx and roll commands are not working correctly.
its showing circular movement at a point or say -Vx with yawing.

Code:
from dronekit import connect, VehicleMode
from pymavlink import mavutil

def send_local_ned_velocity(x, y, z):
msg = vehicle.message_factory.set_position_target_local_ned_encode(
0, 0, 0,
mavutil.mavlink.MAV_FRAME_BODY_OFFSET_NED,
0b0000111111000111,
0, 0, 0,
x, y, z,
0, 0, 0,
0, 0)
vehicle.send_mavlink(msg)
#vehicle.flush()

def condition_yaw(heading):
msg = vehicle.message_factory.command_long_encode(
0, 0, # target_system, target_component
mavutil.mavlink.MAV_CMD_CONDITION_YAW, #command
0, #confirmation
1, # param 1, yaw in degrees
0, # param 2, yaw speed deg/s
heading, # param 3, direction -1 ccw, 1 cw
1, # param 4, relative offset 1, absolute angle 0
0, 0, 0) # param 5 ~ 7 not used
vehicle.send_mavlink(msg)
vehicle.flush()

vehicle = connect(‘udp:127.0.0.1:14550’, wait_ready=True)

while True:
send_local_ned_velocity(-1, 0, 0)
#condition_yaw(-1)


Plane 4.5.5-beta1 has been released for beta testing. This is a minor update from 4.5.4.

The changes vs 4.5.4 are in the ReleaseNotes and also listed below

  1. Board specific enhancements and bug fixes
  • fixed IOMCU transmission errors when using bdshot
  • update relay parameter names on various boards
  • add ASP5033 airspeed in minimal builds
  • added RadiolinkPIX6
  • fix Aocoda-RC H743Dual motor issue
  • use ICM45686 as an ICM20649 alternative in CubeRedPrimary
  1. System level minor enhancements and bug fixes
  • correct use-after-free in script statistics
  • added arming check for eeprom full
  • fixed a block logging issue which caused log messages to be dropped
  • enable Socket SO_REUSEADDR on LwIP
  • removed IST8310 overrun message
  • added Siyi ZT6 support
  • added BTFL sidebar symbols to the OSD
  • added CRSF extended link stats to the OSD
  • use the ESC with the highest RPM in the OSD when only one can be displayed
  • support all Tramp power levels on high power VTXs
  • emit jump count in missions even if no limit
  • improve the bitmask indicating persistent parameters on bootloader flash
  • fix duplicate error condition in the MicroStrain7
  1. AHRS / EKF fixes
  • fix infinite climb bug when using EK3_OGN_HGT_MASK
  1. Plane specific changes
  • fix rangefinder correction when terrain following is off
  • correct description of MIN_GROUNDSPEED parameter
  • correct Q_TRIM_PITCH description
  • ensure the dshot type gets set at startup
  1. Other minor enhancements and bug fixes
  • specify pymonocypher version in more places
  • added DroneCAN dependencies to custom builds

Thank you to everyone who helps with testing!

Today I flew 4.5.5-beta-1 firmware without problems in gusty winds with 3 small aircraft <1000 g (a TriTilt, QUAD-X-VTOl and fixed wing) Take off, FBWA, Q-Modes and VTOL Autoland.
I was impressed by how precisely the automatic deceleration, descent and engagement of the lidar slowed down the descent despite the relatively strong wind for this size of aircraft:

Thanks to all the developers who have contributed

Rolf

4 Likes

thanks @Rolf , much appreciated!

I flew 4.5.5 beta 1 on my A-Tail RQ-7 Fixed wing yesterday. I was literally at the field setting up while the dev-call was wrapping up.

PixPilot V3 and Express LRS with HD-Zero. 3 nice flights started with an autotune because I’d re-done the linkages on the A-Tail surfaces to give more throw. As always the autotune takes an ugly tune and delivers a nice flying feel.

This is the autotune flight.
https://www.dropbox.com/scl/fi/2mziznuqa0owfjirtc3al/log_100_2024-7-8-20-17-40.bin?rlkey=qwydjewa58qbj4kvgumxlpt20&dl=0

These are two more very uneventful flights I did the same evening.

https://www.dropbox.com/scl/fi/xgfsu4zzver3dyl8iewm3/log_101_2024-7-8-20-43-30.bin?rlkey=kq0ku8dekruq5xs2616ic2zpm&dl=0

https://www.dropbox.com/scl/fi/hbs2kuito5amf3anduscp/log_102_2024-7-8-21-01-00.bin?rlkey=j1azno9yfc6hqwpn60ha4jsem&dl=0

This last flight is the log for the flight I did a livestream for with my HD-Zero goggles running ArduPilot OSD. I’d really like to be able to get VTX power somehow. Otherwise great.

2 Likes

thanks Tim! nice flying site

1 Like

I’m happy to see the extended link stats for CRSF in this release, as well as the problems I’ve had with Dshot also fixed. I have a couple of flights with it now with no issues to report!

4 Likes

Thanks for all the hard work putting into this.
Please allow me a question. I have SpeedybeeF405Mini wing FC and when I load 4.5 via MP or DFU I don’t have Terrain_Enable available. I did a custom build and same. Then I did custom build for 4.6dev and was available. But would prefer to use 4.5 stable. What do I need to do to have Terrain_enable available? Manufacture website offers 4.3.7 and has it. But when I want to run update it says board version is xxxx my board is yyyy and is not supported. FC purchased last month. Please point me into the right direction how to get a custom build for 4.5 done with terrain_enable . Thanks a lot

Hello guys,
me again with same issue, still. But have found the root cause of the issue I believe. For the SpeedybeeF405Mini the hwdef.h has no sdcard defined. FC has sdcard slot. Works with build for other FC like SpeedybeeF405WING. But as not in hwdef.h not for SpeedybeeF405Mini, hence no terrain_enable. Please let me know if there is a specific reason not to use the sdcard? Have the terrain data on it and really like to use it. Please your help

Probably my bad, there is a SpeedybeeF405Wing Mini and a SpeedybeeF405Mini stack FC … guess I was on the wrong train. Sorry if anyone had a moment spend on this. Have a great weekend

Plane-4.5.5 has just been released. This is a minor release, with the changes listed below.

Changes from 4.5.4

  1. Board specific enhancements and bug fixes
  • CubeRed’s second core disabled at boot to avoid spurious writes to RAM
  • CubeRed bootloader’s dual endpoint update method fixed
  • fixed IOMCU transmission errors when using bdshot
  • update relay parameter names on various boards
  • add ASP5033 airspeed in minimal builds
  • added RadiolinkPIX6
  • fix Aocoda-RC H743Dual motor issue
  • use ICM45686 as an ICM20649 alternative in CubeRedPrimary
  1. System level minor enhancements and bug fixes
  • correct use-after-free in script statistics
  • added arming check for eeprom full
  • fixed a block logging issue which caused log messages to be dropped
  • enable Socket SO_REUSEADDR on LwIP in networking
  • removed IST8310 overrun message
  • added Siyi ZT6 support
  • added BTFL sidebar symbols to the OSD
  • added CRSF extended link stats to the OSD
  • use the ESC with the highest RPM in the OSD when only one can be displayed
  • support all Tramp power levels on high power VTXs
  • emit jump count in missions even if no limit
  • improve the bitmask indicating persistent parameters on bootloader flash
  • fix duplicate error condition in the MicroStrain7
  1. AHRS / EKF fixes
  • fix infinite climb bug when using EK3_OGN_HGT_MASK
  1. Plane specific changes
  • fix rangefinder correction when terrain following is off
  • correct description of MIN_GROUNDSPEED parameter
  • correct Q_TRIM_PITCH description
  • ensure the dshot type gets set at startup
  1. Other minor enhancements and bug fixes
  • specify pymonocypher version in more places
  • added DroneCAN dependencies to custom builds

Thanks to everyone who helped with the release!

4 Likes

I upgraded from v4.4.0 to v4.5.5 and I find the following situation. With v4.4.0 I was receiving in OSD telemetry from the ESC (rpm, temperature) but with v.4.5.5 the ESC temperature telemetry was lost (rpm still works).

I note that the issue is in OSD because from the STATUS tab of Mission Planner the ESC1_TEMP values are read correctly.

In my case I use BLHeli32 telemetry and I don’t use BDShot.

Thanks in advance

  • IMUDATA serial protocol outputs raw IMU data on serial port (only available using custom build server)
    How can I use this?


Plane-4.5.6-beta1 has been released for testing. This is a minor release with a few new boards.
Full release notes below.

Changes from 4.5.5

  1. Board specific enhancements and bug fixes
  • 3DR Control Zero H7 Rev G support
  • CUAV-7-Nano support
  • FoxeerF405v2 servo outputs increased from 9 to 11
  • Holybro Pixhawk6C hi-power peripheral overcurrent reporting fixed
  • iFlight 2RAW H7 support
  • MFT-SEMA100 support
  • TMotorH743 support BMI270 baro
  • ZeroOneX6 support
  1. Minor enhancements and bug fixes
  • Cameras using MAVLink report vendor and model name correctly
  • DroneCAN fix to remove occasional NodeID registration error
  • GPS NMEA and GSoF driver ground course corrected (now always 0 ~ 360 deg)
  • ICP101XX barometer slowed to avoid I2C communication errors
  • IMU temp cal param (INSn_ACCSCAL_Z) stored correctly when bootloader is flashed
  • IMU gyro/accel duplicate id registration fixed to avoid possible pre-arm failure
  • Logging to flash timestamp fix
  • OSD displays ESC temp instead of motor temp
  • PID controller error calculation bug fix (was using target from prev iteration)
  • Relay on MAIN pins fixed

Happy flying!

Today in gusty wind 4.5.6-beta-1 firmware performed without problems (1 Fixed-wing, MatekH743 / 1 TritTilt - VTOL , Matek H743 : FBWA,MANU,RTL,QSTABILIZE,SCRIPTING)

Rolf

Had a failsafe today on my VTOL running 4.5.5 release, and the FS action wasn’t what I expected. This was my 7th flight on this version and everything is fine, But failsafe in stabilize mode went straight to CIRCLE mode, instead of QRTL (I have Q_RTL_MODE=1). Is this normal or a bug?