14.06.2022Betaflight 4.3.0
Wie immer kann die neue Version im Configurator oder auf der Releases-Seite auf Github heruntergeladen werden.
Features
Improvements
- Added dterm configurable expo curve to MSP by @IllusionFpv in #9475
- Add FF Interpolate options to MSP by @Asizon in #9465
- GPS Rescue: Add Configurable Buffer by @EggsBenedict in #9900
- Added vbat_sag_compensation to msp 1.44, revise dyn_idle by @Asizon in #9930
- Cleaned up 'getEstimatedVario()'. by @mikeller in #9867
- Cleaned up the output of the altitude estimation. by @mikeller in #9865
- Added metric for consumption in mAh to LTM telemetry. by @mikeller in #9756
- Removed the unused setting 'mag_declination'. by @mikeller in #9753
- Improved styling of error messages in CLI. by @mikeller in #9632
- H7 linker script cleanup by @hydra in #9641
- Only enable PINIOBOX task when needed by @etracer65 in #9682
- Correct gyro scaling factors by @etracer65 in #9724
- CMS over CRSF compression by @codecae in #9746
- Split initialization from pid.c for flash savings by @etracer65 in #9759
- Added the most common (reasonable) hardware settings to 'dump hardware'. by @mikeller in #9691
- Removed unneeded uppercasing of git revision. by @mikeller in #9752
- Add support for LSM6DSO gyro/acc by @etracer65 in #9767
- MAX7456: Support delayed initialization by @fiam in #9948
- Cleaned up rangefinder code, removed unsupported driver stubs. by @mikeller in #9936
- Refactor p_ratio to sample_rate (fraction of current PID loop frequency) by @fgiudice98 in #9803
- Barometer Infineon DPS310 support by @jflyper in #9957
- Spektrum SPI protocol improvements by @phobos- in #9960
- Removed unused 'io/motors.h' header file. by @mikeller in #9963
- Treat BME280 as BMP280 by @gereic in #9656
- [ADC] Remove MAX_ADC_SUPPORTED and related assertion by @jflyper in #9624
- Thrust linearisation changes by @ctzsnooze in #9740
- OSD: Move crosshair to active elements and not background by @McGiverGim in #9949
- Add DEBUG_D_LPF by @SteveCEvans in #9832
- Initial FrSky ACCST V2.1.x support by @MJ666 in #9697
- Show configuration status in CLI. by @mikeller in #9688
- Refactored assertion in 'settings.c'. by @mikeller in #9690
- Add blackbox fields selection by @fgiudice98 in #9726
- Remove vbat pid compensation by @mikeller in #9633
- Removed DTerm RPM filter. by @mikeller in #9984
- refactor Thrust Linear to initialise throttleCompensateAmount in pid_… by @ctzsnooze in #9990
- Added configurable minimum arming time for a flight to be counted in flight statistics. by @mikeller in #10011
- Added registration for bus devices. by @mikeller in #10000
- Fixed stack size monitoring. by @mikeller in #9998
- Fix issue entering pitmode as well as general VTX IRC tramp improvements. by @pgreenland in #9638
- Cleaned up separation of CRSF test code. by @mikeller in #9863
- Refactored Dshot enabled checks. by @mikeller in #9937
- Add MSP override feature by @birktj in #9915
- Add hdop in MSP_RAW_GPS by @dev-fred in #10064
- Added board information to CMS 'firmware' menu. by @mikeller in #10071
- Motor output reordering feature for CLI and MSP (Firmware part) by @limonspb in #9946
- Added vbat_sag_compensation to Blackbox header by @Asizon in #10079
- Updated dynamic gyro lowpass curve by @IllusionFpv in #10086
- Speed up gyro device detection; fix MPU6000 initialization by @etracer65 in #10098
- Cleaned up handling of 'oldMinRps' in dynamic idle code. by @mikeller in #10105
- feat: add additional min/warn battery cell voltages to CMS by @knoopx in #10112
- add thrust linearization to CSM by @knoopx in #10114
- Add support for British units in OSD by @haslinghuis in #10080
- Rename macros used in FAST_RAM/DATA by @SJ-Innovation in #10128
- [G4] I2C Add I2C pins overloaded with SWD pins by @jflyper in #10137
- [G4] Camera control support by @jflyper in #10138
- Disable stick commands when HID is active and USB is connected by @dkustec in #10095
- Fix default baro handling and address for DPS310 by @jflyper in #10129
- Fix debug names not unique with only 12 chars by @haslinghuis in #10146
- Clean up linker script by @SJ-Innovation in #10126
- Replace peak clipping of FF boost with lowpass filter by @ctzsnooze in #10164
- [G4] TIMER timer_def.h update by @jflyper in #10136
- Support MPU925x internal magnetometer over I2C by @krygacz in #10159
- Add late P boost to antigravity by @ctzsnooze in #10163
- [G4] USB_HID_CDC support by @jflyper in #10178
- Add box mode to disable stick commands by @etracer65 in #10183
- Made stick command disable mode name consistent with other names. by @mikeller in #10199
- Show stopped motors in Motor Diagnostic OSD element by @Igorshp in #10191
- [G4] Add USB/VCP support by @jflyper in #10177
- [G4] BB-DSHOT support (TIM1/TIM8 limited version) by @jflyper in #10176
- add fc attitude request for rcdevice protocol by @azolyoung in #10214
- [G4] CLI and config changes for clock configuration by @jflyper in #10221
- Add compile-time option to enable MSP push messages over the VCP port by @etracer65 in #10230
- [G4][SYSTEM] Basic & build files by @jflyper in #10222
- [H7] BB-Dshot support (TIM1/TIM8 limited version) by @jflyper in #10224
- [H7] Migrate to FW V1.8.0 library by @jflyper in #10175
- Added vbat sag compensation in CMS by @IllusionFpv in #10245
- Add optional high framerate OSD by @alexeystn in #10243
- Added dlpf gyro expo curve in CMS by @IllusionFpv in #10238
- New feature 'Beeper mute' by @dkustec in #10225
- Fix H7 USB MSC library support by @SteveCEvans in #10246
- Allow exit from VTX pitmode when arming craft by @pgreenland in #10166
- Add feedforward to OSD PID elements by @etracer65 in #10257
- Enabled gyro dlpf by default by @IllusionFpv in #10239
- Cleaned up Unified Target definition. by @mikeller in #10263
- Add Thrust Linearization to MSP by @klutvott123 in #10268
- Split mixer code into initialisation and runtime to reduce flash space usage. by @mikeller in #10261
- Improve CMS support of long lookup table names by @etracer65 in #10273
- Refactored mixer / servo init. by @mikeller in #10262
- Split acceleration code into init and runtime to save flash space by @etracer65 in #10279
- Changed optimisation on F7X2 targets to '-O2' to save flash space. by @mikeller in #10287
- Total flights stats for OSD (firmware part) by @limonspb in #10300
- Fix SPI FLASH speed and cycle time impact by @SteveCEvans in #10303
- bump SDK to latest Update by @TheIsotopes in #10306
- Moved parameter group defaults into main flash for STM32F722. by @mikeller in #10305
- Added the dynamic idle throttle offset to the blackbox header to fix the motor output display. by @mikeller in #10307
- Added persistent stats to CMS by @limonspb in #10310
- Include gyro_to_use in blackbox header by @atomgomba in #10315
- Quick rates expo on rc command by @IllusionFpv in #10316
- Add USB MSC support for H7 by @SteveCEvans in #10247
- Improved the naming of the digital idle offset getter. by @mikeller in #10317
- [H7] H723/H725 support by @jflyper in #10325
- Remove unused SRAM2 define. by @mikeller in #10319
- Enabled SPI Transaction support for F4 and F7. by @mikeller in #10333
- Implement RSSI (dBm and Pct), LQ, in GHST driver by @mikeller in #10360
- Dynamic idle and idle related mixer changes by @ctzsnooze in #10294
- Dshot commands via MSP by @limonspb in #10372
- New linear mixer (credits to @tylercorleone) by @borisbstyle in #10370
- Optimize pin reconfiguration in DSHOT ISR for H7 by @mluessi in #10383
- H7 LED strip by @SteveCEvans in #10378
- Removed deprecated Dshot commands to enable / disable bidirectional Dshot. by @mikeller in #10402
- Add debug support to GHST protocol driver by @tonycake in #10389
- Improve OSD blink timing logic by @etracer65 in #10424
- Cleaned up debug code in Dshot. by @mikeller in #10408
- Improve rate settings range checking by @etracer65 in #10430
- Simplified the OSD blink frequency calculation. by @mikeller in #10440
- Made fuel reporting for FrSky telemetry consistent. by @mikeller in #10441
- Refactor SD_Init() to return proper SD_Error_t code. by @tstibor in #10459
- Added vtx device status to MSP by @limonspb in #10413
- fixed problem msp_displayport send lost when serial port buffer full by @ligenxxxx in #10410
- [H7] Update power supply configuration by @jflyper in #10458
- Exclude yaw from AntiGravity generated P boost by @ctzsnooze in #10462
- Altitude hold removal cleanup by @etracer65 in #10467
- Add option to display OSD menus over a solid gray background by @etracer65 in #10443
- Fix baro sample size minimum range by @etracer65 in #10472
- Reordered configuration validation to put custom target validation to the end. by @mikeller in #10479
- Add up/down page indicator to CMS menu display by @etracer65 in #10484
- Make MSP displayPort respect the NTSC/PAL setting by @etracer65 in #10485
- new dashboard OLED page for Black Box by @krzysztofkuczek in #10486
- Enable Up/Down reference for artificial horizon in OSD by @bobbycisneros in #10417
- Removed unneeded include from flash_w25n01g.c. by @mikeller in #10539
- Improved the naming of OSD_TYPE_MASK to be more concise. by @mikeller in #10542
- Separate OSD warnings from OSD task and make available via MSP by @etracer65 in #10540
- Add OSD element variants for altitude by @etracer65 in #10551
- Added option to show cell value instead of batt value at stats screen by @dkustec in #9878
- Add a common function used to print formatted floats in the OSD by @etracer65 in #10555
- Fix disabled disarm when Paralyze is activated in armed state by @alexeystn in #10559
- Improved tuning sliders calculation by @IllusionFpv in #10509
- setting simplified_dterm_filters to off by defaults by @TheIsotopes in #10565
- Improve I2C_TIMINGR register calculation by @klutvott123 in #10624
- Use non-blocking access to dps310 baro by @SteveCEvans in #10611
- Fixed shoddy and non-compliant coding style in #10562. by @mikeller in #10630
- Fix RX processing impact on cycle time by @SteveCEvans in #10609
- Add support for S25FL064L by @crteensy in #10640
- Display late execution stats in tasks command by @SteveCEvans in #10605
- Remove non-required interpolated_sp parameters, simplify calling FF recalculation by @ctzsnooze in #10626
- move simplified tuning parameters by 5pt by @IllusionFpv in #10589
- Made the displayport initialisation consistent for all telemetry protocols. by @mikeller in #10543
- New OSD element: Tx Uplink Power by @dkustec in #10582
- add W25Q64JVXGIM flash support by @azolyoung in #10698
- MSP add GPS min rescue dth by @klutvott123 in #10684
- Added Unified Target for STM32G4. by @mikeller in #10577
- Add GPS coordinates OSD elements display variants; add support for Open Location Code display by @etracer65 in #10566
- Preserve resolution of RC input by @klutvott123 in #10707
- reduce FF jitter from duplicates by @ctzsnooze in #10670
- Remove unneeded library function 'powerf()'. by @mikeller in #10711
- default to Actual rates by @ctzsnooze in #10724
- Fix STM32G474 RAM overflow by @SteveCEvans in #10720
- Switched to 'maximum FIFO' version of the BMI270 microcode. by @mikeller in #10715
- Added MCU id / name for STM32G474. by @mikeller in #10714
- Cleaned up matrix rotation. by @mikeller in #10712
- Allow re-initialising dynamic notch by @klutvott123 in #10662
- OSD Fix: show hyphen when no sats by @TonyBlit in #10726
- add CRSF v3 support by @tbs-fpv in #10675
- Add W25Q128 QuadSPI support. by @hydra in #10579
- I2C configurable clockspeed by @klutvott123 in #10653
- Handle timing for gpsUpdate task by @SteveCEvans in #10686
- Handle timing for ledStripUpdate task by @SteveCEvans in #10687
- Allow FlightMode telemetry to be disabled on CRSF by @CapnBry in #10745
- Add GPS Telemetry support to GHST by @tonycake in #10744
- Moved some data into FLASH1 from FLASH to free up space. by @mikeller in #10743
- Small filter efficiency improvements by @KarateBrot in #10742
- Fixed coding style in GHST telemetry. by @mikeller in #10751
- New memory section types for DMA by @SteveCEvans in #10747
- Fixed SPI access for SD cards for STM32G4 and STM32H7. by @mikeller in #10776
- Add UART9/10 support. by @hydra in #10704
- Dynamic notch changes by @KarateBrot in #10767
- Added resetting to defaults for individual parameter groups. by @mikeller in #10755
- Add biquad crossfeeding + RPM filter fix by @KarateBrot in #10757
- New SPI API supporting DMA by @SteveCEvans in #10705
- Added optimised SPI DMA support for F4/F7/H7 access to FLASH for BB by @SteveCEvans in #10525
- Crossfire RSNR used for RSSI calculation by @TonyBlit in #10725
- Default yaw lowpass to 100hz by @ctzsnooze in #10841
- Added check to disable bidirectional Dshot when N-channel timers are used. by @mikeller in #10864
- Added indication for N-channel timers to 'resource show all'. by @mikeller in #10863
- Feedforward fix at centre and renaming by @ctzsnooze in #10805
- Add motorPoleCount to log headers by @atomgomba in #10894
- Changed naming of SPI DMA resources to reflect the SPI bus number. by @mikeller in #10865
- Rearranged flash on targets >512 kB to keep first sector from overflowing. by @mikeller in #10890
- Allow feedforward in level, horizon and other flight modes by @ctzsnooze in #10778
- Dmin high-pass changed from biquad to PT2 with cutoff optimisation by @ctzsnooze in #10889
- Dynamic notch refactoring by @KarateBrot in #10835
- move transition to feedforward by @ctzsnooze in #10777
- Fix typo in gps_conversion.c by @DusKing1 in #10904
- BV/BIT macro consolidation by @daleckystepan in #10806
- UART - Add generic pin swap functionality. by @hydra in #10940
- Suport for long range RC links with refresh rate lower than 33Hz down to 16Hz by @daleckystepan in #10832
- Add support for Zbit ZB25Q128 flash by @DusKing1 in #10812
- Change RPM Filter minHz limit / rename CLI commands and parameters by @KarateBrot in #10856
- New PID sliders and changed defaults by @ctzsnooze in #10919
- Clarified the macro name for the resourceValue_t max index. by @mikeller in #10969
- Cleaned up UART pin swap. by @mikeller in #10960
- Fixed optimisation for board alignment. by @mikeller in #10959
- change lowpass filter CLI names by @ctzsnooze in #10978
- Improved maintainability of the piniobox configuration. by @mikeller in #10923
- Fixed non-portable code. by @mikeller in #10947
- Removed softserial loopback. by @mikeller in #10949
- Cleanup of the bus switch functionality. by @mikeller in #10950
- Fixed instances of 'FAST_CODE FAST_CODE_NOINLINE'. by @mikeller in #10953
- Cleaned up the reset reason handling code a bit. by @mikeller in #10958
- Refactoring of rxFrameTimeUs by @daleckystepan in #10989
- set default iterm_windup to 85 for yaw by @ctzsnooze in #10991
- Keeping debug naming in-line with existing function naming convention. by @blckmn in #10952
- Support dual gyros sharing a common SPI bus by @SteveCEvans in #10997
- Changed the optimisation level for ITCM RAM code to free up some ITCM RAM space on F745. by @mikeller in #10988
- set feedforward max rate limit to 90 by @ctzsnooze in #11008
- Apply CMS simplified tuning settings on exit if there are changes. by @JoeriCapens in #11001
- Added application of simplified tuning on reset. by @mikeller in #10987
- refactor feedforward to minimise recurrent duplicate problems by @ctzsnooze in #11000
- Enabled custom USB product names for non-F4 boards. by @mikeller in #11013
- include gyro and dterm static lpf1 in simplified tuning by @ctzsnooze in #11038
- Make deduplication explicit by @mikeller in #11061
- Add constant (i.e. string) deduplication, including at link time. by @mikeller in #11060
- Change filter slider by @haslinghuis in #11050
- Remove Dynamic Notch from "Features" by @KarateBrot in #10673
- Add 50 mW TX power level to CRSF protocol by @avsaase in #10930
- Dynamic idle - values retained, can be activated without RPM filtering, ignores DShot Idle percentage by @ctzsnooze in #11043
- Allow selection of SPI MOSI/MISO DMA streams by @SteveCEvans in #11007
- MSPv2 over telemetry by @Coolbash in #11112
- No space in sizeof() as per Betaflight coding standard by @SteveCEvans in #11128
- Track state execution time for OSD, baro, rx and GPS tasks and inform scheduler of next state execution time by @SteveCEvans in #10813
- Fix missing SPI5/6 configuration. by @hydra in #10694
- deduplicate more blackbox names by @ctzsnooze in #11113
- Make CMS fields readonly when overridden by a slider and mark with an S by @SteveCEvans in #11111
- Added m9n support by @TonyBlit in #10921
- Fix code aligning in osd_elements.c by @DusKing1 in #11099
- Dshot dshot_bitbang=AUTO behaviour change for non-F4 by @SteveCEvans in #11011
- add SK6812 RGBW 4-channel LEDs by @g3gg0 in #10762
- Allow H7 targets to specify an ADC device and channel by @hydra in #10613
- Steve's mashup of proposed PRs for RC2 by @SteveCEvans in #11198
- Only allocate DMA streams for SPI_MOSI 1/SPI_MISO 1 if enabled on F4 by @SteveCEvans in #11252
- Rename task id to task attr by @daleckystepan in #11261
- Vtx smartaudtio fix space by @daleckystepan in #11299
- Rename attr by @haslinghuis in #11270
- changed the min value for simplified filters to 10 by @limonspb in #11370
- Update to BMI gyros to use OSR4 mode to reduce gyro hardware lowpass filter cutoffs by @ChrisRosser in #11480
- Make negotiated baud configurable for CRSF by @klutvott123 in #11472
- Adding CLI min for failsafe_delay (value of '2' - 0.2s) by @limonspb in #11504
- Failsafe changes proposed for RC5 by @ctzsnooze in #11509
- ELRS / NVIC cleanup by @hydra in #11461
- widening range of BLHeli/_S device id by @4712 in #11513
- Adding standard SIGN function by @blckmn in #11566
- Changes in "crash flip" OSD warning by @limonspb in #11621
Fixes