PX4-Autopilot

PX4 Autopilot Software

BSD-3-CLAUSE License

Stars
7.6K
Committers
727

Bot releases are visible (Hide)

PX4-Autopilot - v1.7.3 Beta Release

Published by LorenzMeier almost 7 years ago

This release is based on the new CI system and configuration and addresses a number of usability issues on vehicle setup:

  • Cascaded EKF2 error messages so they do not trigger when calibration is missing on the sensors
  • Disabled some text / speech outputs when disarmed
  • Ensured manual override is always enabled in fixed wing
PX4-Autopilot - v1.7.2 Stable Release

Published by LorenzMeier almost 7 years ago

Fixes boot issues with some boards that deviate from the reference design.

PX4-Autopilot - v1.7.0 Stable Release

Published by dagar almost 7 years ago

Release Notes

  • First-generation experimental support for ROS2-like setups with FastRTPS
  • Support for many new sensors (LIDAR, airspeed, IMU, etc)
  • Significant robustness improvements and new features in default estimation system (EKF2)
  • Significant improvements to VTOL flight control
  • Increased smoothness of multicopter flight control
  • Better performance of fixed wing flight control
  • Many build system improvements (including 50% faster nuttx builds)
  • New continuous integration system system (http://ci.px4.io) with significantly more build and testing capacity
  • Many improvements and fixes in various subsystems, as listed below.
  • Reduced CPU load and RAM usage

Change Log

v1.7.0 (2017-12-12)

Full Changelog

Implemented enhancements:

  • Consider SF1xx Driver for 1.7 Release #8177
  • Standard way to disable internal magnetometer? #8059
  • NuttX enable CONFIG_MEMSET_OPTSPEED #7815
  • add MAVLink FLIGHT_INFORMATION support #7706
  • FW Minimum Airspeed scaling for banked stall avoidance #7572
  • Be smart about using MAVLink 2.0 #7246
  • Bit-banding for atomic flag access on STM32 #7183
  • HC_SR04 driver needs cleanup #7168
  • Snapdragon Flight ESC support #6962
  • Create pure racer config #6780
  • Gazebo HIL #6631
  • listener does not work for subtopics #6607
  • Reduce effect of estimator vertical velocity errors #8445 (priseborough)
  • ekf2: relax preflight yaw check when possible #8424 (priseborough)
  • cmake NuttX wrapper work around windows cygwin path issues #8397 (dagar)
  • QuadChute monitor tecs height rate #8395 (sanderux)
  • vtol_att_control increase stack by 30 Bytes (1200 -> 1230) #8390 (dagar)
  • px4io delete old v1 battery current and voltage #8353 (dagar)
  • fw_pos_control_l1 increase stack by 100 Bytes #8348 (dagar)
  • Update the Description of the estimator_status Message #8346 (acfloria)
  • nuttx-configs remove cu and mount example #8344 (dagar)
  • cmake nuttx build and link libnet if networking is enabled #8314 (dagar)
  • Scale FW cruise throttle based on baro pressure #8304 (sanderux)
  • Add a driver for the ADIS16448 IMU #8301 (ASM3)
  • add boolean parameters to enable/disable each sensor #8283 (dagar)
  • SDP3x Airspeed Correction #8242 (acfloria)
  • Adaptive quadchute #8144 (sanderux)
  • logger: Add logging profile to support comparison of multiple sensors #8134 (priseborough)
  • RTPS and micro-CDR build system improvements #8084 (dagar)
  • Positon Controller: multiple small refinements #8072 (MaEtUgR)
  • Generate mixers from description of multicopter geometry #8063 (jlecoeur)
  • Check mag sensor for consistency before flight #8039 (priseborough)
  • Acro: SuperExpo Stick Input #8036 (MaEtUgR)
  • sitl: add possibility to not run gazebo when running make #7965 (JonasVautherin)
  • VTOL back transition: check only forward velocity #7948 (sanderux)
  • Factor in reverse pusher delay on mission acceptance radius #7915 (sanderux)
  • FW position failsafe defaults #7894 (dagar)
  • delete control_state and cleanup vehicle_attitude #7882 (dagar)
  • NuttX upgrade split UAVCAN bootloaders into separate repository #7878 (dagar)
  • Reverse pusher delay #7877 (sanderux)
  • Remove thrust_sp from pusher assist calculation #7865 (sanderux)
  • [RFC] Make NuttX drivers cross platform (VDev -> CDev) and MS4525 linux driver #7864 (dagar)
  • Allow position failsafe sensitivity to be adjusted for different platform types #7842 (priseborough)
  • Disable pusher assist for quadchute failsafe and while landing #7782 (sanderux)
  • Support thrust reversal for vtol back transition #7666 (sanderux)
  • commander RTL failsafe should be sticky #7576 (dagar)
  • FW raise min airspeed based on commanded bank #7575 (dagar)
  • FW landing abort use reposition #7574 (dagar)
  • EKF: Enable compensation for static pressure positional error #7264 (priseborough)

Fixed bugs:

  • v1.7-rc3 'hangs' for split second after arm/disarm #8413
  • MC: LowBat RTL Performed at 5m Alt instead of 50m! #8408
  • ECL__Lib EKF stopping navigation -> Meaning? #8401
  • MR: uncontrollable altitude gain when engaging auto or rtl #8400
  • F450 with Pixhawk 1 - f63c821 crash #8398
  • F450 with Pixhawk 3 Pro v1.7.0-rc3 crash #8392
  • RTL issues with multiCopter #8389
  • FW crash v1.7.0-rc2 #8380
  • PX4 1.6.5 Stbl: Loiter switching BUG. #8376
  • Potential critical NuttX alignment issue #8367
  • Fixed Wing reject auto mission #8361
  • [SubmodulesClean] error 1 #8333
  • Solo PREFLIGHT FAIL: MAG SENSORS INCONSISTENT #8305
  • F450 frame with Pixhawk mini crash - v1.7.0-rc1 #8299
  • Error compiling v1.7.0-rc1 for eagle_default target #8297
  • krait update param failed #8280
  • Protocol splitter is not sending any messages on UART #8262
  • RTL issues with multiCopter #8257
  • EKF2 Altitude estimation problem on Release 1.6.5 Stable #8256
  • Bug: Firmware does not build if submodule #8255
  • sensors voter not using SENS_BARO_QNH #8252
  • MISSION_ITEM_REACHED not sent in SITL #8245
  • rsync error when building the px4/firmware #8239
  • Battery remaining inversed when compensating for load #8198
  • Travis is not returning current master commit #8197
  • VTOL crash on V4Pro #8186
  • HIL: can't arm with latest versions #8176
  • Possible Lidar "double-correction" bug #8163
  • Param generation broken #8122
  • BUG on EKF2 when the PX4Flow goes invalid #8102
  • PX4_simple_app not in Builtin App List? #8087
  • Nuttx missing tag nuttx-7.21 in repo #8070
  • make: *** [px4fmu-v2_default] Error 2 #8034
  • sitl gazebo error DODECA_TOP_COX #7978
  • PX4IO calling new off ISR from DMA #7971
  • Pixhawk i2c bus lost (after missing ACK/NAK ?) #7968
  • previous main state isn't changing #7947
  • Logging fails on current master #7911
  • Gazebo8 protoc version conflict on Mac #7872
  • Mixer of Bormatec Maja not working in Manual Override #7861
  • Remove Support for Artistic Style Version 2.05.1 (Ubuntu 16.04) #7818
  • Land detector issues #7768
  • vmount causes system freeze #7755
  • Mag timeout current master #7746
  • Mission takeoff almost no thrust and does not take off #7737
  • Pixhawk 2.1 internal/external bus detection #7696
  • make: *** [px4fmu-v2_default] Error 2 #7612
  • FW Land mode = crash #7609
  • Battery Monitor not working on PixHawk Mini #7603
  • BUG: Code dependent on the compiler #7597
  • PX4 1.6.3: Strange problem with Airspeed-less transition. #7545
  • [PixHawk3] Accel1 startup bias huge changes #7541
  • Pixhawk Pro (V4Pro) Quad near flyaway #7495
  • Out-of-tree module build is broken #7409
  • Stuck during mission, if altitude higher than max height #7309
  • FCU:[lpe] gps fault 0.00120141 0.904114 0.156308 0.10 #7089
  • Setpoint raw issues Mavros ROS #7068
  • tailsitter after transiton to FW,can not control, has been flying straight line #7063
  • no_sim=1 make posix_sitl_default gazebo not work #7059
  • No RC input px4fmu-v4pro_default #7054
  • Oscillations on actuators with full thrust and roll ~ 45 degree #7051
  • LPSP.VZ jump during POSCTL #7048
  • FTP read file timeouts #6984
  • Failsafe mode on while in OFFBOARD mode #6982
  • Compiler is not emitting vsqrt.f32 on ARM Cortex M4F targets #6838
  • FLAPS: Does not work in 1.6.0 RC1 #6827
  • Preflight EKF error checking is linked to GPS #6797
  • Slow optical flow drift in SITL #6772
  • Pixhawk Pro lockup after mag cal #6712
  • RC lost with no GPS #6617
  • SITL stops with negative time #6602
  • commander: Fix pre-flight delta velocity bias check level #8446 (priseborough)
  • NuttX update to latest 7.22+ with pipes poll fix #8431 (dagar)
  • Fix uncontrolled height gain in hold/loiter mode #8418 (priseborough)
  • mc_pos_control: set triplets to NAN if not in auto mode #8412 (Stifael)
  • Update ekf2 to version with fixes for 1.7.0 release #8406 (priseborough)
  • IO override fix #8384 (LorenzMeier)
  • Potential critical NuttX alignment issue in bss prophylactic fix. #8382 (davids5)
  • Fix vulnerability in pre flight checks and failsafe #8374 (priseborough)
  • Increase fixed-wing l1 navigation radius limit #8365 (AndreasAntener)
  • RTL fix RTL_LAND_DELAY behaviour #8351 (dagar)
  • Removed [cal] references from calibration_log_critical() routines. #8347 (dagar)
  • Merge FMUv3 into FMUv2 #8343 (dagar)
  • fix MISSION_ITEM REACHED message broadcast #8332 (lamping7)
  • simplify param scoping (fix out of tree builds) and fix qurt fc_addon linking #8325 (dagar)
  • cmake nuttx keep builtins generated by nuttx apps #8323 (dagar)
  • sensors remove barometer enabled check for now #8291 (dagar)
  • mc_pos_control: smooth takeoff does not require slewrate #8282 (MaEtUgR)
  • ecl: Update ekf2 to version that addresses known vulnerabilities #8276 (priseborough)
  • integrationtests: fix numpy version problem (broken Jenkins) #8274 (korigod)
  • RTL check alt_max before using #8272 (dagar)
  • Fixed version firmware type #8250 (garfieldG)
  • Fix bugs introduced by PR 8199 #8207 (priseborough)
  • sensor priority after failure and EKF2 bias reset #8199 (dagar)
  • circleci force make distclean before build #8111 (dagar)
  • Navigator fix vehicle_command_ack (and landing abort improvements) #8076 (dagar)
  • Pr altitude max fix #8048 (Stifael)
  • fix and enable all mavlink ftp tests #8012 (dagar)
  • FW att ctrl - Fix vehicle_attitude_setpoint timestamp logging when in stabilized #7803 (bresch)
  • land detector revert FW hysteresis constants and cleanup initialization #7796 (dagar)
  • Fix for manual/automatic micro RTPS bridge generation #7724 (vicentemonge)
  • MPU9250 Reset reorganization (fixes I2C functionality) #7653 (dennisss)

Closed issues:

  • px4fmu-v3_default binary naming #8436
  • Anyone use PC with wifi router to control snapdragon drone with wifi receiver? Without use of a RC? #8429
  • px4io causing inner loop latency #8414
  • Issue with "make posix jmavsim" #8388
  • OFFBOARD mode not accessible with RC or ROS #8387
  • Multi-vehicle(Swarm UAV) Simulation Error #8368
  • merge FMUv2 and FMUv3 board support #8342
  • Feature request #8306
  • LPE with External Vision Position crash into ceiling while in Altitude Control #8295
  • How yaw control in fixed-wing mode works #8248
  • Sky Does not display in jMAVSim #8229
  • "No Local Position" error on takeoff with plane (SITL Gazebo) (log attached) #8227
  • Logging custom topics in SITL with gazebo #8224
  • position lock #8204
  • Possible to simulate motor failure with Pixhawk in Gazebo?? #8174
  • things to check before v1.7.0 #8171
  • make px4fmu-v2_default fail #8169
  • Posctrl Z position hold with LIDAR and PX4Flow #8151
  • contents of extras.txt not executed upon boot-up of pixhawk mini #8147
  • Documentation of the SDP3X model #8140
  • Rpi: Position flight mode seems not functioning well #8130
  • **Feature Request** Bring back gimbal stabilisation feature for servo gimbals #8120
  • Quadrotor having vertical Z up velocity in Altitude hold mode #8109
  • With respect to the Unit tests and testing the coverage or functionality -- Can i get some basic info regarding as to how to approach and accomplish testing of the entire software firmware built ? #8086
  • SITL with gazebo and px4 #8068
  • MC: PWM goes into Saturation in PosCTL #8056
  • PX4 version on Pixhawk #8025
  • FMUV5 need to align with SPEKTRUM_POWER API #8024
  • Documentation of offboard mode #8021
  • LPE GPS initialization fault when FUSE VISION_POSITION checkbox is enaled #8018
  • Servo doesn't move #8016
  • Helicopter Mixer BUG! #8013
  • The local_position/pose topic's refresh rate is too low #8004
  • [Bug] mc_pos_control, LAND not to it's current position #7990
  • Full Parameter Load fails #7961
  • Single Direction Drift With Optical Flow On LPE #7959
  • pixhawk i2c deadlock in v1.6.5 #7951
  • MC: Estimator divergence? #7941
  • no setting of status->failsafe #7934
  • Pixhawk X2.1 : No Voltage, nor Amp reading in the QGC. #7931
  • HMC5883 report x, y doesn't match direction of x_raw, y_raw nor x, y direction of chip #7929
  • Possibility of dataman database corruption #7927
  • MC: Add Lightware SF/LW 20 Support #7899
  • Even though it is normal, dataman worker thread can not be created #7898
  • modules to consider retiring #7895
  • make posix gazebo_typhoon_h480 bug, ekf2: exceeded maximum number of file descriptors #7892
  • Pixhawk default PWM when safety switch is "off" (blinking once) #7887
  • multi uav simulation using mavros #7886
  • pixhawk-pi connection #7880
  • GPS Failure parameters not used #7879
  • Failed to flash board through terminal and QT #7869
  • Actuator control doens't work with in mavros #7854
  • Nuttx Upgrade for 1.8 Release #7852
  • Assisted and Mission Mode with sudden roll and pitch actuation blowing past limits #7846
  • PX4 1.6.5 Does not hold heading on Position mode. #7843
  • I want to try the EKF2_replay function without gps data. What should I do? #7832
  • Quite different outputs between actuator 0,1 and 2,3 #7823
  • Rename VDev to CDev #7817
  • Flight Performance issue with Intel Aero on master #7811
  • Look at the problem and find the problem. Please. #7807
  • vmount still causes board freeze-ups #7801
  • pixhawk 2.1 firmware px4fmu-v3_default has motor_test command problem #7800
  • Px4flow initial value wrong and does not change in flight #7797
  • Why did you choose C++ nor C/lua #7793
  • FastRTPS: Example from http://dev.px4.io stalls after around one second #7780
  • No PPM when connected to RC IN #7761
  • motor_test not part of the nsh commands ? #7760
  • FMUv1 Deprecation Notice and removal from source tree. #7758
  • Add pyulog to ubuntu_sim_nuttx.sh #7730
  • ignore me #7726
  • suddenly drone was fall ... #7719
  • qgroundcontrol log file. Look at the graph and let me know the problem. #7712
  • SF1XX driver: sf1xx doesn't appear in /dev #7695
  • Add SDP3x sensor compensation #7684
  • MISSION_ITEM_REACHED is not sent #7679
  • Some questions about “mc_att_control” hope to get help #7675
  • QML Performance: MissionItemEditor creation expensive #7674
  • Maxbotix sonar sensor not working #7664
  • Compilation Error #7661
  • Is End-To-End Ethernet (Ad Hoc) Control of Pixhawk controller over Wifi possible? #7652
  • Change of MAV_SYS_ID sends status_text message #7642
  • The problem in pixhawk stay altitude. #7635
  • Pixhawk does not connect to QGC [when using XBee link] #7633
  • Multiple-Vehicles Gazebo Simulation Local Position Estimation (LPE) error #7631
  • Laser Altimeter and terrain follow. #7630
  • I want to know code means in ecl_l1_pos_controller.cpp #7629
  • Flash PX4 onto Crazyflie 2 problem #7624
  • Potential bug: Unreliable setting of home altitude leading to crash #7623
  • ROS launch scripts refer to overdefined executables #7619
  • Snapdragon flight spektrum not receiving #7615
  • Pixracer external compass not detected #7607
  • Multi-Vehicle Simulation Error #7596
  • 1.6.4 Stable reported as 1.6.4dev #7592
  • Position Mode for VTOL in MC Tuning. #7591
  • Severe horizontal overshots #7566
  • Run CI with gcc 7 #7539
  • How to get global yaw with vision heading estimation enabled #7527
  • HIL broken in 1.6 for multi rotors #7516
  • [EKF2/Vision] huge local position drift after vision interrupt #7491
  • Create a new Custom MAVLink Messages , but can not receive it #7448
  • MC: YAW Mission WP Setting ignored / defaulting to 0° #7437
  • Listing many Logfiles causes Data Link Lost Message #7436
  • Issues found with Pixhawk 3 Pro #7431
  • Inspect SITL on Mac OS #7419
  • GPS_STATUS message support #7392
  • Creating new mixer geometry - documentation required #7382
  • Mission takeoff with rotary wing rejected due to (horizontal) acceptance radius #7379
  • FW Flashing Stable: wrong reporting. #7378
  • Unclear firmware version <=> hardware correspondance in documentation #7324
  • SITL low acceleration for distant waypoints #7317
  • Syslink parameter acks broken Crazyflie 2 #7282
  • Emild reach RTK GPS support #7275
  • Quad using flow lands, when enabling GPS and being in takeoff (auto) #7251
  • Access denied to connect to PX4flow in Comm Links. What is the output? #7222
  • Please have a look at my px4flow test logs #7207
  • LPE Auto.Takeoff w/o GPS works in Gazebo, but not in real life #7128
  • Confusions about topics in gazebo_mavlink_interface.cpp. #6909
  • Revisit Nuttx Build #6881
  • Land detected after VTOL back transition #6730
  • Ensure system is not leaking FDs #6606

Merged pull requests:

* This Change Log was automatically generated by github_changelog_generator

PX4-Autopilot - v1.7.0 Release Candidate 4

Published by mrpollo almost 7 years ago

This RC correctly builds FMUv3 targets and includes fixes to RTL behaviour and when GPS lock is acquired mid-flight.

PX4-Autopilot - v1.7.0 Release Candidate 3

Published by mrpollo almost 7 years ago

PX4-Autopilot - v1.7.0 Release Candidate 2

Published by mrpollo almost 7 years ago

PX4-Autopilot - v1.7.0 Release Candidate 1

Published by mrpollo almost 7 years ago

PX4-Autopilot - v1.7.0 Release Candidate 0

Published by mrpollo almost 7 years ago

PX4-Autopilot - v1.6.5 Stable Release

Published by LorenzMeier over 7 years ago

Ensures pausing a mission pauses on-spot and not only at the next waypoint.

PX4-Autopilot - v1.6.4 Stable Release

Published by LorenzMeier over 7 years ago

Maintenance release:

This release includes a number of fixes

  • Pixhawk Mini: Improve mag boot stability
  • Pixhawk 3 Pro: Improve mag boot stability
  • GCC7 compile fixes
  • Sensirion SDP3x driver
  • Measurement Specialties MS5525 driver
  • Add hard fault logs to .ulg flight log files
  • Fixed wing: Handle loiter relative alt correctly
PX4-Autopilot - v1.6.3 Stable Release

Published by LorenzMeier over 7 years ago

PX4 v1.6.3 requires a recent version of QGroundControl for the best user experience, currently available as “daily build” here.

  • Enables correct calibration of 4th magnetometer
  • Fixes VTOL back transition on RTL
PX4-Autopilot - v1.6.2 Stable Release

Published by LorenzMeier over 7 years ago

PX4 v1.6.2 requires a recent version of QGroundControl for the best user experience, currently available as “daily build” here.

New Hardware Support

  • Crazyflie v2
  • FMUv4 PRO (Prototype donation and manufacturing: Drotek)
  • FMUv5 (Prototype donation and manufacturing: Team Blacksheep)

New Features

  • New .ulg uLog logging format which directly logs uORB topics and offers more accurate time stamping. Supported in FlightPlot. @bkueng
  • New web-graphing engine for .ulg: http://review.px4.io @bkueng
  • Easier to use camera triggering @mhkabir
  • Basic support for real-time camera triggering feedback @mhkabir
  • Support for survey flights (multicopter and fixed wing) with intuitive UI
  • Temperature calibration and compensation (gyro, accel, mag, baro)
  • Support for MAVLink and PWM controlled gimbals @bkueng
  • Support for generic helicopters and Blade 130 mixer @bartslinger
  • Fixedwing acro and rattitude flight modes

Major Upgrades

  • EKF2 Robustness @priseborough @tumbili
  • Tremendously better user experience on Snapdragon Flight @ChristophTobler
  • Better user experience on Aero @lucasdemarchi
  • Hardening against marginal GPS reception @priseborough
  • Hardening against mag observability issues @priseborough
  • NuttX Update to a recent release @davids5
  • STM32F7 support @davids5
  • Change default to use the new ULog logging format supporting http://review.px4.io zoomable graphing
  • Significant reduction in RAM usage on STM32 @bkueng

Bugfixes and Improvements

  • Critical bugfixes in magnetometer calibration routine preventing a race condition @mhkabir
  • Improvements for FMUv3 / Pixhawk 2.1 HW support @mhkabir
  • Improvements for UAVCAN motor control and parameter transfer @eyeam3
  • Cleanup of PWM output driver, easier user-configuration of OneShot
  • More reliable reboot of Pixracer boards
  • Log tasks low on stack @AndreasAntener
  • Prevent overshooting of landing waypoints on VTOLS by calculating the acceptance radius based on ground speed @sanderux
  • Prevent takeoff in loiter mode when vehicle is on the ground and wait on transition to mission mode @julianoes
  • Improved robustness and reliability of land detector
  • Fix offboard attitude setpoint overwrite from RC channels @aivian
  • Add ground truth tests to SITL Gazebo CI @jgoppert
  • Disable the safety switch by default on Pixracer @LorenzMeier
  • Use ellipsoid instead of sphere fitting in magnetometer calibration @bugobliterator
  • Introduction of the event module @bkueng
  • Temperature calibration for IMU and barometric sensors @bugobliterator @priseborough
  • Don’t allow arming in low battery condition @LorenzMeier
  • Enable takeoff and landing with just local position (e.g. flow) @ChristophTobler
  • Add fixed-wing acro mode @AndreasAntener
  • Trigger quadchute on maximum roll and pitch angles to prevent stalling or actuation problems like reversed ailerons/elevons @sanderux
  • Add fast EKF2 replay for new ulog format @bkueng
  • UAVCAN performance audit @pavel-kirienko
  • Add preflight, postflight perf counters and process usage to ULog @bkueng
  • Improve VTOL standard transition improvements
  • Fix PX4 build on Windows platforms @MaEtUgR
  • Improve multicopter takeoff and landing in altitude controlled flight modes
  • Support for multiple UAVs in SITL simulation @mzahana
  • Fixedwing offboard control mode improvements
  • Fixedwing throttle scaling with battery voltage @Sander
  • VTOL land improved back transition waypoint accuracy
  • TECS height rate feed forward fixed
  • Fixedwing loiter to altitude landing improved predictibility @NatorGator
  • Fixedwing limits fix : The FW_PSP_OFF parameter no longer breaches the pitch min/max limits. @sanderux
  • Improved the mixer clipping performance on yaw saturation @bresch
  • BMI055 driver fixes for device IDs (from 1.6.0)
  • Fixes for mag rotation (from 1.6.0 and 1.6.1) @mhkabir

R&D

  • Iridium SBD @dagar
  • ICM20602 and ICM20689 @davids5
  • BMI055 and BMM150 @scheiermanns
PX4-Autopilot - v1.6.0 Release Candidate 4

Published by LorenzMeier over 7 years ago

Improvements on mag calibration on FMUv4 hardware

PX4-Autopilot - v1.6.0 Release Candidate 3

Published by LorenzMeier over 7 years ago

  • Improvements on EKF2 stability
  • General improvements of stability and usability
PX4-Autopilot - v1.6.0 Release RC2

Published by LorenzMeier over 7 years ago

Second release candidate for v1.6.0. Release notes TBC

PX4-Autopilot - 1.6.0 Release RC1

Published by LorenzMeier over 7 years ago

This is a release candidate for the current beta branch, nominally tagged as 1.6.0. We will likely conclude to skip 1.6-1.9 in favour of releasing a 2.0.0 in a couple weeks, so consider this release candidate a reasonably well tested snapshot (hence the RC naming) of the current development and not a preview for the next stable release.

PX4-Autopilot - v1.5.5 Stable Release

Published by LorenzMeier over 7 years ago

Minor bugfixes and improvements over v1.5.4.

PX4-Autopilot - Release v.1.5.4

Published by LorenzMeier almost 8 years ago

Geofence fix and re-labeled from v1.5.3 to v1.5.4 to fix version indication in QGC.

PX4-Autopilot - Release v1.5.2

Published by LorenzMeier almost 8 years ago

Improves the calibration handling on Pixhawk 2.1 boards.

PX4-Autopilot - Release v1.5.1

Published by LorenzMeier almost 8 years ago

This release changes the estimator to EKF2 for all vehicles as it is the most tested in typical outdoor scenarios. Indoor scenarios and general R&D applications continue to benefit greatly from the LPE estimator.

To switch back to the previous default, set SYS_MC_EST_GROUP to 1. To use EKF2, set SYS_MC_EST_GROUP to 2.

Most notable changes / improvements:

  • EKF2 default estimator
  • STM32F7 support added
  • Crazyflie support added
  • Parrot Bebop 2 support added
  • Log streaming via Wifi to the ground and straight to the cloud
  • New log analysis tool with real-time zoomable plots (logs.px4.io)
  • Reduction of memory footprint
  • Performance improvements in VTOL flight control
  • Pre-flight check improvements on EKF2
  • Side-slip support in EKF2

Hardware support

  • Intel Aero Flight Control
  • Qualcomm Snapdragon Flight
  • Parrot Bebop 2
  • Raspberry Pi / Emlid Navio 2+
  • CrazyFlie
  • Pixhawk 1 (FMUv2 architecture)
  • Pixhawk (2) Mini (FMUv3 architecture)
  • Pixhawk 2 (FMUv3 architecture)
  • Pixracer (FMUv4 architecture)
  • Dronesmith Lucy (FMUv4 architecture)
  • MindPX (FMUv4 architecture)
  • Pixhawk 3 Pro (FMUv4-PRO architecture)
  • Upcoming Pixracer 4 & Pixhawk 4 (FMUv5 architecture, STM32F7)