CoCalc Logo Icon
StoreFeaturesDocsShareSupportNewsAboutSign UpSign In
Ardupilot

Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.

GitHub Repository: Ardupilot/ardupilot
Path: blob/master/ArduCopter/ReleaseNotes.txt
Views: 1798
1
ArduPilot Copter Release Notes:
2
------------------------------------------------------------------
3
Release 4.6.0-beta2 11 Dec 2024
4
5
Changes from 4.6.0-beta1
6
7
1) Board specfic changes
8
9
- FoxeerF405v2 supports BMP280 baro
10
- KakuteH7, H7-Mini, H7-Wing, F4 support SPA06 baro
11
- MUPilot support
12
- SkySakura H743 support
13
- TBS Lucid H7 support
14
- VUAV-V7pro README documentation fixed
15
- X-MAV AP-H743v2 CAN pin definition fixed
16
17
2) Copter specific enhancements and bug fixes
18
19
- AutoTune fix for calc of maximum angular acceleration
20
- Advanced Failsafe customer build server option
21
22
3) Plane related enhancements and bug fixes
23
24
- QuadPlane fix for QLand getting stuck in pilot repositioning
25
- QuikTune C++ conversion (allow running quiktun on F4 and f7 boards)
26
- Takeoff direction fixed when no yaw source
27
- TECS correctly handles home altitude changes
28
29
4) Bug Fixes and minor enhancements
30
31
- AIRSPEED_AUTOCAL mavlink message only sent when required and fixed for 2nd sensor
32
- CAN frame logging added to ease support
33
- CRSF reconnection after failsafe fixed
34
- EKF3 position and velocity resets default to user defined source
35
- Ethernet IP address default 192.168.144.x
36
- Fence autoenable fix when both RCn_OPTION=11/Fence and FENCE_AUTOENABLE = 3 (AutoEnableOnlyWhenArmed)
37
- Fence pre-arm check that vehicle is within polygon fence
38
- Fence handling of more than 256 items fixed
39
- FFT protection against divide-by-zero in Jain estimator
40
- Frsky telemetry apparent wind speed fixed
41
- Inertial sensors stop sensor converging if motors arm
42
- Inertial sensors check for changes to notch filters fixed
43
- Real Time Clock allowed to shift forward when disarmed
44
- ROS2/DDS get/set parameter service added
45
- Scripting gets memory handling improvements
46
- Scripting promote video-stream-information to applet
47
- Topotek gimbal driver uses GIA message to retrieve current angle
48
- Tramp VTX OSD power indicator fixed
49
------------------------------------------------------------------
50
Release 4.6.0-beta1 13 Nov 2024
51
52
Changes from 4.5.7
53
54
1) Board specific changes
55
56
- AnyLeaf H7 supports compass and onboard logging
57
- Blitz743Pro supports CAN
58
- BlueRobotics Navigator supports BMP390 baro
59
- Bootloader ECC failure check fixed on boards with >128k bootloader space (e.g CubeRed)
60
- CB Unmanned Stamp H743 support
61
- ClearSky CSKY405 support
62
- CUAV-7-Nano default batt monitor fixed
63
- CubeRed bootloader fixes including disabling 2nd core by default
64
- CubeRed supports PPP networking between primary and secondary MCU
65
- CubeRedPrimary supports external compasses
66
- ESP32 main loop rate improvements
67
- ESP32 RC input fixes and wifi connection reliability improved
68
- ESP32 safety switch and GPIO pin support
69
- FlyingMoon no longer support MAX7456
70
- Flywoo F405HD-AIOv2 ELRS RX pin pulled high during boot
71
- Flywoo H743 Pro support
72
- Flywoo/Goku F405 HD 1-2S ELRS AIO v2
73
- FlywooF745 supports DPS310 baro
74
- FPV boards lose SMBus battery support (to save flash)
75
- GEPRC F745BTHD support
76
- GEPRCF745BTHD loses parachute support, non-BMP280 baros (to save flash)
77
- Here4FC bootloader fix for mismatch between RAM0 and periph that could prevent firmware updates
78
- Holybro Kakute F4 Wing support
79
- iFlight 2RAW H743 supports onboard logging
80
- JFB110 supports measuring servo rail voltage
81
- JFB110 supports safety switch LED
82
- JHEM-JHEF405 bootloader supports firmware updates via serial
83
- JHEMCU GF30H743 HD support
84
- JHEMCU-GF16-F405 autopilot support
85
- JHEMCU-GSF405A becomes FPV board (to save flash)
86
- KakuteF7 only supports BMP280 baro (to save flash)
87
- KakuteH7Mini supports ICM42688 IMU
88
- Linux auto detection of GPS baud rate fixed
89
- Linux board scheduler jitter reduced
90
- Linux board shutdown fixes
91
- MakeFlyEasy PixPilot-V6Pro support
92
- MatekF405, Pixhawk1-1M-bdshot, revo-mini loses blended GPS (to save flash)
93
- MatekH7A3 support Bi-directional DShot
94
- MicoAir405v2 and MicoAir405Mini support optical flow and OSD
95
- MicoAir743 internal compass orientation fixed
96
- MicroAir405Mini, MicroAir743, NxtPX4v2 support
97
- MicroAir405v2 Bi-directional DShot and LED DMA fixes
98
- MicroAir405v2 defined as FPV board with reduced features (to save flash)
99
- ModalAI VOXL2 support including Starling 2 and Starling 2 max
100
- mRo Control Zero Classic supports servo rail analog input
101
- mRo KitCAN revC fixed
102
- Mugin MUPilot support
103
- OmnibusF7v2 loses quadplane support (to save flash)
104
- Pixhack-v3 board added (same as fmuv3)
105
- Pixhawk6C bootloader supports flashing firmware from SD card
106
- RadiolinkPIX6 imu orientation fixed
107
- RadiolinkPIX6 supports SPA06 baro
108
- ReaperF745 V4 FC supports MPU6000 IMU
109
- RPI5 support
110
- SDModelH7v2 SERIAL3/7/9_PROTOCOL param defaults changed
111
- Solo serial ports default to MAVLink1
112
- SpeedyBeeF405Wing gets Bi-directional DShot
113
- SpeedyBeeF405WING loses landing gear support, some camera gimbals (to save flash)
114
- Spektreworks boom board support
115
- TrueNavPro-G4 SPI does not share DMA
116
- X-MAV AP-H743v2 support
117
118
2) AHRS/EKF enhancements and fixes
119
120
- AHRS_OPTION to disable fallback to DCM (affects Plane and Rover, Copter never falls back)
121
- AHRS_OPTION to disable innovation check for airspeed sensor
122
- Airspeed sensor health check fixed when using multiple sensors and AHRS affinity
123
- DCM support for MAV_CMD_EXTERNAL_WIND_ESTIMATE (Plane only)
124
- EK2 supports disabling external nav (see EK2_OPTIONS)
125
- EK3 External Nav position jump after switch from Optical flow removed (see EK3_SRC_OPTION=1)
126
- EK3 uses filtered velocity corrections for IMU position
127
- EKF2, EKF3, ExternalAHRS all use common origin
128
- EKF3 accepts set origin even when using GPS
129
- EKF3 allows earth-frame fields to be estimated with an origin but no GPS
130
- EKF3 copes better with GPS jamming
131
- EKF3 logs mag fusion selection to XKFS
132
- EKF3 wind estimation when using GPS-for-yaw fixed
133
- External AHRS improvements including handling variances, pre-arm origin check
134
- Inertial Labs External AHRS fixes
135
- VectorNav driver fix for handling of error from sensor
136
- VectorNav External AHRS enhancements including validation of config commands and logging improvements
137
- VectorNav support for sensors outside VN-100 and VN-300
138
139
3) Driver enhancements and bug fixes
140
141
- ADSB fix to display last character in status text sent to GCS
142
- Ainstein LR-D1 radar support
143
- Airspeed ASP5033 whoami check fixed when autopilot rebooted independently of the sensor
144
- AIRSPEED message sent to GCS
145
- Analog temperature sensor extended to 5th order polynomial (see TEMP_A5)
146
- ARSPD_OPTIONS to report calibration offset to GCS
147
- Baro EAS2TAS conversions continuously calculated reducing shocks to TECS (Plane only)
148
- Baro provides improved atmospheric model for high altitude flight
149
- BARO_ALT_OFFSET slew slowed to keep EKF happy
150
- BATTx_ESC_MASK param supports flexible mapping of ESCs to batteries
151
- BATTx_OPTION to not send battery voltage, current, etc to GCS
152
- Benewake RDS02U radar support
153
- Bi-directional DShot on IOMCU supports reversible mask
154
- Bi-directional DShot telemetry support on F103 8Mhz IOMCUs
155
- BMM350 compass support
156
- CAN rangefinders and proximity sensors may share a CAN bus (allows NRA24 and MR72 on a single CAN bus)
157
- Compass calibration world magnetic model checks can use any position source (e.g. not just GPS)
158
- CRSF baro and vertical speeed fixed
159
- CRSF RX bind command support
160
- DroneCAN battery monitor check to avoid memory corruption when type changed
161
- DroneCAN DNA server fixes including removing use of invalid node IDs, faster ID allocation, elimination of rare inability to save info
162
- DroneCAN EFI health check fix
163
- DroneCAN ESC battery monitors calculate consumed mah
164
- DroneCAN ESCs forced to zero when disarmed
165
- DroneCAN RPM message support
166
- DroneCAN timeout fix for auxiliary frames
167
- DroneCAN to serial tunneling params accepts short-hand baud rates (e.g. '57' for '57600')
168
- F9P, F10-N and Zed-F9P support for GPSx_GNSS_MODE to turn on/off SBAS, Galileo, Beidou and Glonass
169
- FuelLevel battery monitor fix to report capacity
170
- GPS_xxx params renamed to GPS1_xxx, GPS_xxx2 renamed to GPS2_xxx
171
- Hirth EFI logging includes modified throttle
172
- Hirth ICEngine supports reversed crank direction (see ICE_OPTIONS parameter)
173
- Hott and LTM telemetry deprecated (still available through custom build server)
174
- i-BUS telemetry support
175
- ICE_PWM_IGN_ON, ICE_PWM_IGN_OFF, ICE_PWM_STRT_ON, ICE_PWM_STRT_OFF replaced with SERVOx_MIN/MAX/REVERSED (Plane only)
176
- ICE_START_CHAN replaced with RC aux function (Plane only)
177
- ICEngine retry max added (see ICE_STRT_MX_RTRY)
178
- IE 2400 generator error message severity to GCS improved
179
- INA2xx battery monitor support (reads temp, gets MAX_AMPS and SHUNT params)
180
- MCP9600 temperature sensor I2C address fixed
181
- MLX90614 temperature sensor support
182
- MSP GPS ground course scaling fixed
183
- MSP RC uses scaled RC inputs (fixes issue with RCx_REVERSED having no effect)
184
- Networking supports reconnection to TCP server or client
185
- OSD params for adjusting horizontal spacing and vertical extension (see OSD_SB_H_OFS, OSD_SB_V_EXT)
186
- Relay inverted output support (see RELAYx_INVERTED parameter)
187
- ROMFS efficiency improvements
188
- RS-485 driver enable RTS flow control
189
- Sagetech MXS ADSP altitude fix (now uses abs alt instead of terrain alt)
190
- Septentrio GPS sat count correctly drops to zero when 255 received
191
- Septentrio supports selecting constellations (see GPS_GNSS_MODE)
192
- Single LED for user notification supported
193
- SPA06 baro supported
194
- Sum battery monitor optionally reports minimum voltage instead of average
195
- Sum battery monitor reports average temp
196
- Torqeedo dual motor support (see TRQ1, TRQ2 params)
197
- Ublox GPS driver uses 64 bit time for PPS interrupt (avoids possible dropout at 1hour and 12 minutes)
198
- UBlox GPS time ignored until at least 2D fix
199
- VideoTX supports additional freq bands (RushFPV 3.3Ghz)
200
- Volz logs desired and actual position, voltage, current, motor and PCB temp
201
- Volz server feedback and logging fixed
202
- Volz servo output in its own thread resulting in smoother movements
203
- W25N02KV flash support
204
205
4) Networking enhancements and fixes
206
207
- Allow multiple UDP clients to connect/disconnect/reconnect
208
- Ethernet supports faster log downloading (raised SDMMC clock limit on H7)
209
210
5) Camera and gimbal enhancements
211
212
- Alexmos precision improved slightly
213
- CAMERA_CAPTURE_STATUS mavlink msg sent to GCS (reports when images taken or video recorded, used by QGC)
214
- CAMERA_FOV_STATUS mavlink reports lat,lon of what camera is pointing at
215
- DO_MOUNT_CONTROL yaw angle interpreted as body-frame (was incorrectly being interpreted as earth-frame)
216
- Dual serial camera gimbal mounts fixed
217
- Lua script bindings to send CAMERA_INFORMATION and VIDEO_STREAM_INFORMATION messages to GCS
218
- Retract Mount2 aux function added (see RCx_OPTION = 113)
219
- Servo gimbal reported angles respect roll, pitch and yaw limits
220
- Siyi driver sends autopilot location and speed (recorded in images via EXIF)
221
- Siyi picture and video download scripts
222
- Siyi ZT6 and ZT30 support sending min, max temperature (see CAMERA_THERMAL_RANGE msg)
223
- Siyi ZT6 and ZT30 thermal palette can be changed using camera-change-setting.lua script
224
- Siyi ZT6 hardware id and set-lens fixed
225
- Topotek gimbal support
226
- Trigger distance ignores GPS status and only uses EKF reported location
227
228
6) Harmonic notch enhancements
229
230
- Harmonic notch is active in forward flight on quadplanes
231
- Harmonic notch filter freq clamping and disabling reworked
232
- Harmonic notch handles negative ESC RPMs
233
- Harmonic notch supports per-motor throttle-based harmonic notch
234
235
7) Copter specific enhancements and bug fixes
236
237
- Attitude control fix to dt update order (reduces rate controller noise)
238
- Auto mode fix to avoid prematurely advancing to next waypoint if given enough time
239
- Auto mode small target position jump when takeoff completes removed
240
- Auto mode yaw drift when passing WP removed if CONDITION_YAW command used and WP_YAW_BEHAVIOR = 0/None
241
- Auto, Guided flight mode pause RC aux switch (see RCx_OPTION = 178)
242
- AutoRTL (e.g. DO_LAND_START) uses copter stopping point to decide nearest mission command
243
- AutoRTL mode supports DO_RETURN_PATH_START (Copter, Heli only)
244
- AutoTune fix to prevent spool up after landing
245
- AutoTune performance and safety enhancements (less chance of ESC desync, fails when vehicle likely can't be tuned well)
246
- Autotune test gains RC aux switch function allows testing gains in any mode (see RCx_OPTION = 180)
247
- Config error avoided if auto mode is paused very soon after poweron
248
- FLIGHT_OPTIONS bit added to require position estimate before arming
249
- Follow mode slowdown calcs fixed when target is moving
250
- Ground oscillation suppressed by reducing gains (see ATC_LAND_R/P/Y_MULT)
251
- Guided mode internal error fix when taking off using SET_ATTITUDE_CONTROL message
252
- Guided mode internal error resolved when switching between thrust or climb rate based altitude control
253
- Guided mode yaw fixed when WP_YAW_BEHAVIOR = 0/None and CONDITION_YAW command received containing relative angle
254
- Landing detector fixed when in stabilize mode at full throttle but aircraft is upside down
255
- Landing detector logging added to ease support (see LDET message)
256
- Loiter unlimited command accepts NaNs (QGC sends these)
257
- Mavlink SYSTEM_STATUS set to BOOT during initialisation
258
- MOT_PWM_TYPE of 9 (PWMAngle) respects SERVOx_MIN/MAX/TRIM/REVERSED param values
259
- Payload place bug fix when aborted because gripper is already released
260
- RC based tuning (aka CH6 tuning) can use any RC aux function channel (see RCx_OPTION = 219)
261
- RTL_ALT minimum reduced to 30cm
262
- SystemID position controller support (Copter and Heli)
263
- TriCopter motor test and slew-up fixed
264
- WPNAV_SPEED min reduced to 10 cm/s (Copter only)
265
- Loiter mode zeros desired accel when re-entering from Auto during RC failsafe
266
267
8) TradHeli specific enhancements
268
269
- Autorotation yaw behaviour fix
270
- Autotune improvements including using low frequency dwell for feedforward gain tuning and conducting sweep in attitude instead of rate
271
- Blade pitch angle logging added (see SWSH log message)
272
- Constrain cyclic roll for intermeshing
273
- ICE / turbine cool down fix
274
- Inverted flight extended to non manual throttle modes
275
- Inverted flight transitions smoothed and restricted to only Stabilize mode
276
- SWSH logging fix for reversed collectives
277
278
9) Plane specific enhancements and bug fixes
279
280
- AIRSPEED_STALL holds vehicle stall speed and is used for minimum speed scaling
281
- Allow for different orientations of landing rangefinder
282
- Assistance requirements evaluted on mode change
283
- FBWB/CRUISE climb/sink rate limited by TECS limits
284
- FLIGHT_OPTION to immediately climb in AUTO mode (not doing glide slope)
285
- Glider pullup support (available only through custom build server)
286
- Loiter breakout improved to better handle destinations inside loiter circle
287
- Manual mode throttle made consistent with other modes (e.g battery comp and watt limit is done if enabled)
288
- Mavlink GUIDED_CHANGE_ALTITUDE supports terrain altitudes
289
- Minimum throttle not applied during SLT VTOL airbrake (reduces increase in airspeed and alt during back transition)
290
- Q_APPROACH_DIST set minimum distance to use the fixed wing approach logic
291
- Quadplane assistance check enhancements
292
- Quadplane Deca frame support
293
- Quadplane gets smoother takeoff by input shaping target accel and velocity
294
- Servo wiggles in altitude wait staged to be one after another
295
- Set_position_target_global_int accepts MAV_FRAME_GLOBAL_RELATIVE_ALT and MAV_FRAME_GLOBAL_TERRAIN_ALT frames
296
- Takeoff airspeed control improved (see TKOFF_MODE, TKOFF_THR_MIN)
297
- Takeoff fixes for fence autoenable
298
- Takeoff improvements including less overshoot of TKOFF_ALT
299
- TECS reset along with other controllers (important if plane dropped from balloon)
300
- Tilt quadplane ramp of motors on back transition fixed
301
- Tiltrotor tilt angles logged
302
- TKOFF_THR_MIN applied to SLT transitions
303
- Twin motor planes with DroneCAN ESCs fix to avoid max throttle at arming due to misconfiguration
304
- VTOLs switch to QLAND if a LONG_FAILSAFE is triggered during takeoff
305
306
10) Rover specific enhancements and bug fixes
307
308
- Auto mode reversed state maintained if momentarily switched to Hold mode
309
- Circle mode tracks better and avoids getting stuck at circle edge
310
- Flight time stats fixed
311
- MAV_CMD_NAV_SET_YAW_SPEED deprecated
312
- Omni3Mecanum frame support
313
- Stopping point uses max deceleration (was incorrectly using acceleration)
314
- Wheel rate controller slew rate fix
315
316
11) Antenna Tracker specific enhancements and bug fixes
317
318
- Never track lat,lon of 0,0
319
320
12) Scripting enhancements
321
322
- advance-wp.lua applet supports advancing Auto mode WP via RC switch
323
- AHRS_switch.lua supports switching between EKF2 and EKF3 via RC switch
324
- battery_internal_resistance_check.lua monitors battery resistance
325
- CAN:get_device returns nil for unconfigured CAN device
326
- copter_terrain_brake.lua script added to prevent impact with terrain in Loiter mode (Copter only)
327
- Copter:get_target_location, update_target_location support
328
- crosstrack_restore.lua example allows returning to previous track in Auto (Plane only)
329
- Display text on OLED display supported
330
- Docs improved for many bindings
331
- EFI get_last_update_ms binding
332
- EFI_SkyPower.lua driver accepts 2nd supply voltage
333
- ESC_slew_rate.lua example script supports testing ESCs
334
- Filesystem CRC32 check to allow scripts to check module versions
335
- forced arming support
336
- GPIO get/set mode bindings (see gpio:set_mode, get_mode)
337
- GPS-for-yaw angle binding (see gps:gps_yaw_deg)
338
- Halo6000 EFI driver can log all CAN packets for easier debugging
339
- handle_external_position_estimate binding allows sending position estimate from lua to EKF
340
- I2C:transfer support
341
- IMU gyros_consistent and accels_consistent bindings added
342
- INF_Inject.lua driver more robust to serial errors, improved logging, throttle and ignition control
343
- INS bindings for is calibrating, gyro and accel sensor values
344
- IPV4 address bindings (see SocketAPM_ipv4_addr_to_string) to allow UDP server that responds to individual clients
345
- Logging of booleans supported
346
- Lua language checks improved (finds more errors)
347
- MAVLink commands can be called from scripting
348
- MCU voltage binding (see analog:mcu_voltage)
349
- NMEA 2000 EFI driver (see EFI_NMEA2k.lua)
350
- "open directory failed" false warning when scripts in ROMFS fixed
351
- Param_Controller.lua supports quickly switching between 3 parameter sets via RC switch
352
- Pass by reference values are always initialized
353
- pelco_d_antennatracker.lua applet supports sending Pelco-D via RS-485 to PTZ cameras
354
- plane_aerobatics.lua minor enhancements
355
- REPL applet (read-evaluate-print-loop, see repl.lua) for interactive testing and experimentation
356
- "require" function failures in rare circumstances fixed
357
- "require" function works for modules in ROMFS (e.g. not on SD card)
358
- revert_param.lua supports more params (e.g ATC_RATE_R/P/Y, PTCH2SRV_TCONST, RLL2SRV_TCONST, TECS_)
359
- Scripts may receive mavlink messages which fail CRC (e.g messages which FC does not understand)
360
- SD card formatting supported
361
- Serial device simulation support (allows Lua to feed data to any supported serial protocol for e.g. sensor simulation)
362
- set_target_throttle_rate_rpy allows rate control from scripts (new for Copter)
363
- sitl_standby_sim.lua example shows how to switch between redundant flight controllers using an RC switch
364
- Slung payload oscillation suppression applet added (see copter-slung-payload.lua)
365
- Temperature sensor bindings added
366
- uint64 support
367
- Various performance and memory usage optimizations
368
- VTOL-quicktune.lua minor enhancements including increasing YAW_FLTE_MAX to 8
369
- x-quad-cg-allocation.lua applet corrects for the CoM discrepancy in a quad-X frame
370
371
13) GCS / mavlink related changes and fixes
372
373
- BATTERY2 message deprecated (replaced by BATTERY_STATUS)
374
- CMD_MISSION_START/STOP rejected if first-item/last-item args provided
375
- Deny attempts to upload two missions simultaneously
376
- Fence and Rally points may be uploaded using FTP
377
- GPS_INPUT and HIL_GPS handles multiple GPSs
378
- HIGHRES_IMU mavlink message support (used by companion computers to receive IMU data from FC)
379
- MAV_CMD_COMPONENT_ARM_DISARM accepts force arm magic value of 21196
380
- MAV_CMD_DO_SET_SAFETY_SWITCH_STATE support
381
- MAV_CMD_SET_HAGL support (Plane only)
382
- MAVFTP respects TX buffer flow control to improve FTP on low bandwidth links
383
- MAVLink receiver support (RADIO_RC_CHANNELS mavlink message)
384
- Message interval supports TERRAIN_REPORT msg
385
- Mission upload may be cancelled using MISSION_CLEAR_ALL
386
- MOUNT_CONFIGURE, MOUNT_CONTROL messages deprecated
387
- RC_CHANNELS_RAW deprecated
388
- Serial passthrough supports parity allowing STM32CubeProgrammer to be used to program FrSky R9 receivers
389
- SET_ATTITUDE_TARGET angular rate input frame fixed (Copter only)
390
- TIMESYNC and NAMED_VALUE_FLOAT messages not sent on high latency MAVLink ports
391
392
14) Logging enhancements and fixes
393
394
- AC_PID resets and I-term sets logged
395
- ANG provides attitude at high rate (equivalent to ATT)
396
- ATT logs angles as floats (better resolution than ints)
397
- CAND message gets driver index
398
- DCM log message includes roll/pitch and yaw error
399
- EDT2 log msg includes stress and status received via extended DShot Telemetry v2
400
- EFI ECYL cylinder head and exhaust temp logs in degC (was Kelvin)
401
- ESCX log msg includes DroneCAN ESCs status, temp, duty cycle and power pct
402
- FMT messages written as required instead of all at beginning
403
- Logging restarted after download completes when LOG_DISARMED = 1
404
- MISE msg logs active mission command (CMD logged when commands are uploaded)
405
- ORGN message logging fixed when set using SET_GPS_GLOBAL_ORIGIN
406
- RPM sensor logging gets instance field, quality and health fields
407
- Short filename support removed (e.g log1.BIN instead of 00000001.BIN)
408
- Temperature sensor logging option for only sensors with no source (see TEMP_LOG)
409
- UART data rates logged at 1hz (see UART message)
410
411
15) ROS2 / DDS support
412
413
- Airspeed published
414
- Battery topic reports all available batteries
415
- Compile-time configurable rates for each publisher
416
- DDS_TIMEOUT_MS and DDS_MAX_RETRY set timeout and num retries when client pings XRCE agent
417
- GPS global origin published at 1 Hz
418
- High frequency raw imu data transmission
419
- Joystick support
420
- Support sending waypoints to Copter and Rover
421
- Remove the XML refs file in favor of binary entity creation
422
423
16) Safety related enhancements and fixes
424
425
- Accel/Gyro inconsistent message fixed for using with only single IMU
426
- Battery monitor failure reported to GCS, triggers battery failsafe but does not take action
427
- Far from EKF origin pre-arm check removed (Copter only)
428
- Fence breach warning message slightly improved
429
- Fence enhancements incluiding alt min fence (Copter only, see FENCE_AUTOENABLE, FENCE_OPTIONS)
430
- Fences can be stored to SD Card (see BRD_SD_FENCE param)
431
- ICEngine stopped when in E-Stop or safety engaged (Plane only)
432
- LEDs flash green lights based on EKF location not GPS
433
- Parachute option to skip disarm before parachute release (see CHUTE_OPTIONS)
434
- Plane FENCE_AUTOENABLE of 1 or 2 deprecation warning added
435
- Pre-arm check if OpenDroneID is compiled in but disabled
436
- Pre-arm check of duplicate RC aux functions fixed (was skipping recently added aux functions)
437
- Pre-arm checks alert user more quickly on failure
438
- Prearm check for misconfigured EAHRS_SENSORS and GPS_TYPE
439
- Proximity sensor based avoidance keeps working even if one proximity sensor fails (Copter, Rover)
440
- RC aux functions for Arm, Disarm, E-Stop and Parachute ignored when RC is first turned on
441
- Warning of duplicate SERIALx_PROTOCOL = RCIN
442
443
17) Other bug fixes and minor enhancements
444
445
- Accel cal fixed for auxiliary IMUs (e.g. IMU4 and higher)
446
- Bootloader fix to reduce unnecessary mass erasing of flash when using STLink or Jlink tools
447
- Bootloader rejects allocation of broadcast node ID
448
- CAN forward registering/de-registering fix (affected Mission Planner DroneCAN UI)
449
- Dijkstras fix to correct use of uninitialised variable
450
- DShot rates are not limited by NeoPixel rates
451
- Ethernet and CAN bootloader fix to prevent getting stuck in bootloader mode
452
- Filesystem does not show entries for empty @ files
453
- Filesystem efficiency improvements when reading files
454
- Flight statistics only reset if user sets STAT_RESET to zero (avoids accidental reset)
455
- Flight time statistics updated on disarm (avoids issue if vehicle powered-down soon after disarm)
456
- Internal error thrown if we lose parameters due to saving queue being too small
457
- MAVLink via DroneCAN baud rate fix
458
- SPI pins may also be used as GPIOs
459
- Terrain cache size configurable (see TERRAIN_CACHE_SZ)
460
461
18) Developer focused fixes and enhancements
462
463
- AP_Camera gets example python code showing how to use GStreamer with UDP and RTSP video streams
464
- Cygwin build fix for non-SITL builds
465
- Cygwin build fixed with malloc wrap
466
- DroneCAN and scripting support FlexDebug messages (see CAN_Dn_UC_OPTION, FlexDebug.lua)
467
- EKF3 code generator documentation and cleanup
468
- GPS jamming simulator added
469
- MacOS compiler warnings reduced
470
- SFML joystick support
471
- SITL support for OpenBSD
472
- Text warning if older Fence or Rally point protocols are used
473
------------------------------------------------------------------
474
Release 4.5.7 08 Oct 2024
475
476
Changes from 4.5.7-beta1
477
478
1) Reverted Septentrio GPS sat count correctly drops to zero when 255 received
479
------------------------------------------------------------------
480
Release 4.5.7-beta1 26 Sep 2024
481
482
Changes from 4.5.6
483
484
1) Bug fixes and minor enhancements
485
486
- VUAV-V7pro support
487
- CUAV-7-Nano correction for LEDs and battery volt and current scaling
488
- DroneCAN deadlock and saturation of CAN bus fixed
489
- DroneCAN DNA server init fix (caused logging issues and spam on bus)
490
- F4 boards with inverter support correctly uninvert RX/TX
491
- Nanoradar M72 radar driver fix for object avoidance path planning
492
- RC support for latest version of GHST
493
- Septentrio GPS sat count correctly drops to zero when 255 received
494
- TradHeli DDVP tail rotor pitch actuator fixed
495
496
2) ROS2/DDS and other developer focused enhancements
497
498
- AP quaternions normalised for ROS2 to avoid warnings
499
- Dependencies fixed for easier installation
500
- ROS2 SITL launch file enhancements including displaying console and map
501
- ROS_DOMAIN_ID param added to support multiple vehicles or instances of ROS2
502
- Python 3.12 support
503
------------------------------------------------------------------
504
Release 4.5.6 03 Sep 2024
505
506
No changes from 4.5.6-beta1
507
------------------------------------------------------------------
508
Release 4.5.6-beta1 20 Aug 2024
509
510
Changes from 4.5.5
511
512
1) Board specific enhancements and bug fixes
513
514
- 3DR Control Zero H7 Rev G support
515
- CUAV-7-Nano support
516
- FoxeerF405v2 servo outputs increased from 9 to 11
517
- Holybro Pixhawk6C hi-power peripheral overcurrent reporting fixed
518
- iFlight 2RAW H7 support
519
- MFT-SEMA100 support
520
- TMotorH743 support BMI270 baro
521
- ZeroOneX6 support
522
523
2) Minor enhancements and bug fixes
524
525
- Cameras using MAVLink report vendor and model name correctly
526
- DroneCAN fix to remove occasional NodeID registration error
527
- GPS NMEA and GSoF driver ground course corrected (now always 0 ~ 360 deg)
528
- ICP101XX barometer slowed to avoid I2C communication errors
529
- IMU temp cal param (INSn_ACCSCAL_Z) stored correctly when bootloader is flashed
530
- IMU gyro/accel duplicate id registration fixed to avoid possible pre-arm failure
531
- Logging to flash timestamp fix
532
- OSD displays ESC temp instead of motor temp
533
- PID controller error calculation bug fix (was using target from prev iteration)
534
- Relay on MAIN pins fixed
535
536
3) Copter specific fixes
537
538
- Payload place bug fix (calimb rate after releasing payload was unreliable)
539
540
------------------------------------------------------------------
541
Release 4.5.5 1st Aug 2024
542
543
No changes from 4.5.5-beta2
544
------------------------------------------------------------------
545
Release 4.5.5-beta2 27 July 2024
546
547
Changes from 4.5.5-beta1
548
549
1) Board specific enhancements and bug fixes
550
551
- CubeRed's second core disabled at boot to avoid spurious writes to RAM
552
- CubeRed bootloader's dual endpoint update method fixed
553
------------------------------------------------------------------
554
Release 4.5.5-beta1 1st July 2024
555
556
Changes from 4.5.4
557
558
1) Board specific enhancements and bug fixes
559
560
- fixed IOMCU transmission errors when using bdshot
561
- update relay parameter names on various boards
562
- add ASP5033 airspeed in minimal builds
563
- added RadiolinkPIX6
564
- fix Aocoda-RC H743Dual motor issue
565
- use ICM45686 as an ICM20649 alternative in CubeRedPrimary
566
567
2) System level minor enhancements and bug fixes
568
569
- correct use-after-free in script statistics
570
- added arming check for eeprom full
571
- fixed a block logging issue which caused log messages to be dropped
572
- enable Socket SO_REUSEADDR on LwIP
573
- removed IST8310 overrun message
574
- added Siyi ZT6 support
575
- added BTFL sidebar symbols to the OSD
576
- added CRSF extended link stats to the OSD
577
- use the ESC with the highest RPM in the OSD when only one can be displayed
578
- support all Tramp power levels on high power VTXs
579
- emit jump count in missions even if no limit
580
- improve the bitmask indicating persistent parameters on bootloader flash
581
- fix duplicate error condition in the MicroStrain7
582
583
3) AHRS / EKF fixes
584
585
- fix infinite climb bug when using EK3_OGN_HGT_MASK
586
587
4) Copter specific changes
588
589
- fix MAV_CMD_CONDITION_YAW with relative angle
590
591
5) Other minor enhancements and bug fixes
592
593
- specify pymonocypher version in more places
594
- added DroneCAN dependencies to custom builds
595
596
------------------------------------------------------------------
597
Release 4.5.4 12th June 2024
598
599
Changes from 4.5.3
600
601
Disable highres IMU sampling on ICM42670 fixing an issue on some versions of Pixhawk6X
602
603
------------------------------------------------------------------
604
Release 4.5.3 28th May 2024
605
606
No changes from 4.5.3-beta1
607
------------------------------------------------------------------
608
Release 4.5.3-beta1 16th May 2024
609
610
Changes from 4.5.2
611
612
1) Board specific enhancements and bug fixes
613
614
- correct default GPS port on MambaH743v4
615
- added SDMODELV2
616
- added iFlight Blitz H7 Pro
617
- added BLITZ Wing H743
618
- added highres IMU sampling on Pixhawk6X
619
620
2) System level minor enhancements and bug fixes
621
622
- fixed rare crash bug in lua scripting on script fault handling
623
- fixed Neopixel pulse proportions to work with more LED variants
624
- fixed timeout in lua rangefinder drivers
625
- workaround hardware issue in IST8310 compass
626
- allow FIFO rate logging for highres IMU sampling
627
628
3) Copter specific changes
629
630
- fixed speed constraint during avoidance backoff
631
632
------------------------------------------------------------------
633
Release 4.5.2 14th May 2024
634
635
No changes from 4.5.2-beta1
636
------------------------------------------------------------------
637
Release 4.5.2-beta1 29th April 2024
638
639
Changes from 4.5.1
640
641
1) Board specific enhancements and bug fixes
642
643
- FoxeerF405v2 support
644
- iFlight BLITZ Mini F745 support
645
- Pixhawk5X, Pixhawk6C, Pixhawk6X, Durandal power peripherals immediately at startup
646
647
2) System level minor enhancements and bug fixes
648
649
- Camera lens (e.g. RGB, IR) can be selected from GCS or during missions using set-camera-source
650
- Crashdump pre-arm check added
651
- Gimbal gets improved yaw lock reporting to GCS
652
- Gimbal default mode fixed (MNTx_DEFLT_MODE was being overriden by RC input)
653
- RM3100 compass SPI bus speed reduced to 1Mhz
654
- SBUS output fix for channels 1 to 8 also applying to 9 to 16
655
- ViewPro gimbal supports enable/disable rangefinder from RC aux switch
656
- Visual Odometry delay fixed (was always using 1ms delay, see VISO_DELAY_MS)
657
- fixed serial passthrough to avoid data loss at high data rates
658
659
3) AHRS / EKF fixes
660
661
- Compass learning disabled when using GPS-for-yaw
662
- GSF reset minimum speed reduced to 1m/s (except Plane which remains 5m/s)
663
- MicroStrain7 External AHRS position quantization bug fix
664
- MicroStrain7 init failure warning added
665
- MicroStrain5 and 7 position and velocity variance reporting fix
666
667
4) Copter specific changes
668
669
- Auto mode condition yaw fix to avoid pointing at out-of-date target
670
- Guided mode angle control yaw target initialisation fix (was always turning North)
671
672
5) Other minor enhancements and bug fixes
673
674
- DDS_UDP_PORT parameter renamed (was DDS_PORT)
675
- Harmonic Notch bitmask parameter conversion fix (see INS_HNTCH_HMNCS)
676
677
------------------------------------------------------------------
678
679
Release 4.5.1 8th April 2024
680
681
This release fixes a critical bug in the CRSF R/C protocol parser that
682
can lead to a handfault and a vehicle crashing. A similar fix was
683
applied to the GHST protocol, although we believe that GHST could not
684
be affected by the bug, so this was just a precaution.
685
686
There are no other changes in this release.
687
688
------------------------------------------------------------------
689
Release 4.5.0 2nd April 2024
690
691
No changes from 4.5.0-beta4
692
------------------------------------------------------------------
693
Release 4.5.0-beta4 22nd March 2024
694
695
Changes from 4.5.0-beta3
696
697
1) system changes
698
699
- fixed a cache corruption issue with microSD card data on H7 based boards
700
- rename parameter NET_ENABLED to NET_ENABLE
701
- fixed FDCAN labels for adding new H7 boards
702
- avoid logging dma.txt to save CPU
703
- fixed roll/pitch in viewpro driver
704
- added band X in VideoTX
705
- fixed quaternion attitude reporting for Microstrain external AHRS
706
- add RPLidarC1 proximity support
707
708
2) new boards
709
- added MicoAir405v2
710
- add Orqa F405 Pro
711
712
------------------------------------------------------------------
713
Release 4.5.0-beta3 14-March-2024
714
715
Changes from 4.5.0-beta2
716
717
1) Board specific changes
718
- added PixFlamingo F7 board
719
- support ICM42688 on BlitzF745AIO
720
- fixed IMU orientation of CubeRedSecondary
721
- enable all FPV features on SpeedyBeeF405WING
722
723
2) System level changes
724
725
- improved robustness of CRSF parser
726
- reduced memory used by DDS/ROS2
727
- added filesystem crc32 binding in lua scripting
728
- support visual odometry quality metric and added autoswitching lua script
729
- allow for expansion of fence storage to microSD for larger pologon fences
730
- allow FTP upload of fence and rally points
731
- fixed vehicle type of ship simulation for ship landing
732
- make severity level depend on generator error level in IE 2400 generator
733
- speed up initial GPS probe by using SERIALn_BAUD first
734
- allow NanoRadar radar and proximity sensor to share the CAN bus
735
- added MR72 CAN proximity sensor
736
- only produce *_with_bl.hex not *.hex in builds if bootloader available
737
- fixed check for GPS antenna separation in moving baseline yaw
738
- added GPS_DRV_OPTIONS options for fully parsing RTCMv3 stream
739
- fixed logging of RTCM fragments in GPS driver
740
- fixed video recording while armed
741
- robostness and logging improvements for ExternalAHRS
742
- fixed RPM from bdshot on boards with IOMCU
743
- fixed accel cal simple to remove unused IMUs
744
745
3) Copter specific changes
746
- check fence breaches more often on copter for smaller overrun
747
- improved copter follow mode at close distances
748
- fixed default for FLTD for yaw
749
- fixed reset_target_and_rate method in attitude control
750
751
------------------------------------------------------------------
752
Copter 4.5.0-beta2 14-February-2024
753
754
Changes from 4.5.0-beta1:
755
756
1) New Autopilots supported
757
- YJUAV_A6Ultra
758
- AnyLeaf H7
759
760
2) System level changes
761
- fixed float rounding issue in HAL_Linux millis and micros functions
762
- fixed loading of defaults.parm parameters for dynamic parameter subtrees
763
- fixed discrimination between GHST and CRSF protocols
764
- fixed bug in DroneCAN packet parsing for corrupt packets that could cause a crash
765
- fixed handling of network sockets in scripting when used after close
766
- fixed bit timing of CANFD buses
767
768
3) Copter specific changes
769
- added filter to EKF variances for EKF failsafe
770
771
4) Camera and gimbal enhancements
772
- wait for non-zero camera version in SIYI driver
773
774
5) Miscellaneous
775
- do relay parameter conversion for parachute parameters if ever has been used
776
- broaden acceptance criteria for GPS yaw measurement for moving baseline yaw
777
778
------------------------------------------------------------------
779
Copter 4.5.0-beta1 30-Jan-2024
780
Changes from 4.4.4
781
1) New autopilots supported
782
- ACNS-F405AIO
783
- Airvolute DCS2 onboard FMU
784
- Aocoda-RC-H743Dual
785
- BrainFPV RADIX 2 HD
786
- CAN-Zero
787
- CM4Pilot
788
- CubeRed
789
- Esp32-tomte76, esp32nick, esp32s3devkit
790
- FlyingMoonH743
791
- Flywoo F405 Pro
792
- FlywooF405S-AIO with alternative IMUs
793
- Here4 GPS as flight controller
794
- Holybro 6X revision 6
795
- Holybro6X-45686 with 3x ICM45686 IMUs
796
- JAE JFB110
797
- KakuteH7 using ICM42688
798
- PixFlamingo (uses STM32L4PLUS CPU)
799
- PixPilot-C3
800
- PixSurveyA1-IND
801
- QiotekAdeptF407
802
- Sierra TrueNavIC
803
- SPRacing H7RF
804
- SW-Nav-F405
805
- YJUAV_A6
806
- YJUAV_A6SE, YJUAV_A6SE_H743
807
2) Autopilot specific changes
808
- 1MB boards lose features to save flash (Payload Place, some battery monitors, NMEA Output, bootloaders, Turtle mode)
809
- CubeOrangePlus supports IMU high resolution sampling (works with ICM42688, ICM42652, ICM42670, ICM45686 IMUs)
810
- F4 processors with only 1 IMU gain Triple Harmonic Notch support
811
- F765-SE bdshot support on 1st 4 pin
812
- F7 and H7 boards lose DMA on I2C ports (not required, limited DMA better used elsewhere)
813
- FlyingMoonH743, FlyingMoonF427 2nd and 3rd IMU order swapped
814
- HEEWING-F405 supports CRSF
815
- MatekL431-RC bootloader added, DMA used for RC and GPS
816
- PH4-mini, PH4-mini-bdshot, Swan-K1 and TBS-Colibri-F7 BRD_SER4_RTSCTS param conflict fixed
817
- Pixhawk6C supports BMI088 baro
818
- TMotorH743, Heewing-F405 serial parameter definitions fixed
819
3) AHRS/EKF enhancements and fixes
820
- AHRS_OPTIONS supports disabling fallback to DCM
821
- BARO_ALT_OFFSET slews more slowly (was 20sec, now 1min)
822
- EKF2 removed (can be re-enabled with Custom build server)
823
- External AHRS support for multiple GPSs
824
- InertialLabs INS-U external AHRS support
825
- Lord external AHRS renamed to MicroStrain5
826
- MAV_CMD_EXTERNAL_POSITION_ESTIMATE supports setting approximate position during dead-reckoning
827
- Microstrain7 (aka 3DM-QG7) external AHRS support
828
4) Driver enhancements
829
- 3DR Solo supports up to 6S batteries
830
- Airspeed health checks vs GPS use 3D velocity
831
- BDshot on the first four channels of boards with F103-based IOMCUs (e.g. Pixhawk 6X)
832
- Dshot on all IOMCU channels on all boards with an IOMCU (e.g. all CubePilot autopilots)
833
- Dshot commands (e.g. motor reversal abd beeps) and EDT supported on IOMCU
834
- DroneCAN battery monitors calculate consumed energy if battery doesn't provide directly
835
- DroneCAN RC and Ghost RC protocol support
836
- EFI MAVLink driver
837
- Extended DShot Telemetry support (requires BLHeli32 ver 32.10 or BlueJay, set SERVO_DSHOT_ESC=3 or 4)
838
- GPS L5 band health override to enable L5 signal use (see GPS_DRV_OPTIONS)
839
- GPS-for-yaw works at lower update rate (3hz minimum)
840
- GSOF GPS supports GPS_COM_PORT parameter
841
- Hirth ICEngine support
842
- ICE option to enable/disable starting while disarmed
843
- ICE support for starter via relay
844
- IMUDATA serial protocol outputs raw IMU data on serial port (only available using custom build server)
845
- Innomaker LD06 360deg lidar support
846
- Intelligent Energy fuel cells new protocol support
847
- IRC Tramp supports 1G3 bands A and B
848
- IRC Ghost support
849
- JAE JRE-30 radar
850
- KDECAN driver rewrite (params moved to KDE_, works on all vehicles)
851
- MCP9601 temperature sensor support
852
- NanoRadar NRA24 rangefinder support
853
- NeoPixelsRGB support
854
- NoopLoop TOFSense, TOFSenseF-I2c rangefinder support
855
- OSD shows flashing horizon when inverted
856
- OSD2 support (e.g. second OSD)
857
- QMC5883P compass support
858
- Relay refactored to support RELAYx_FUNCTION, RELAY_STATUS message support added
859
- Reventech fuel level support (extends existing analog driver, see BATT_FL_xx parameters)
860
- RPLidarS1 360 deg lidar support and improved reliability for all RPLidars
861
- SBF GPS supports yaw from dual antennas
862
- Temperature sensor using analog voltages supported
863
- Trimble PX-1 support added as a GPS
864
- Winch driver enhancements including stuck protection, option for spin-free on startup
865
5) Control and navigation changes and enhancements
866
- Auto missions can always be cleared while disarmed (would fail if mission still running)
867
- DO_ENGINE_CONTROL allows starting engine even when disarmed
868
- DO_SET_MISSION_CURRENT command can reset mission (see Reset Mission field)
869
- DO_SET_SERVO, DO_REPEAT_SERVO work with servo outputs set to RCInxScaled
870
- Fractional Loiter Turn Support in missions
871
- HarmonicNotch supports up to 16 harmonics
872
- JUMP command sends improved text msg to pilot (says where will jump to)
873
- MAV_CMD_AIRFRAME_CONFIGURATION can control landing gear on all vehicles
874
- MOT_OPTIONS allows voltage compensation to use raw battery voltages (instead of current corrected voltage)
875
- PID controllers get DFF/D_FF (derivative feed-forward), NTF (target notch filter index) and NEF (error notch filter index)
876
- PID controllers get PDMX param to limit P+D output (useful for large vehicles and/or slow actuators)
877
- PID notch filter configured via new filter library using FILT parameters
878
- RTL mode uses RTL_CLIMB_MIN even if within cone slope (previously always climbed 2m)
879
6) Copter specific enhancements
880
- MOT_SPOOL_TIM_DN allows slower spool down of motors
881
- Precision landing gets fast descent option (see PLND_OPTIONS)
882
- Throw mode min and max altitude support (see THROW_ALT_MIN/MAX)
883
- TKOFF_TH_MAX allows lower throttle during takeoff
884
- ZigZag mode sends position target to GCS
885
7) TradHeli specific enhancements
886
- Arming checks improved
887
- Motor test removed (it was non-functional)
888
- OSD shows main rotor RPM
889
- RPM based dynamic notch can track below reference (e.g. below INS_HNTCH_FM_RAT)
890
- Thrust linearization for DDFP tails
891
- Heli_idle_control.lua closed loop throttle control Lua script
892
8) Parameters renamed
893
- COMPASS_TYPEMASK renamed to COMPASS_DISBLMSK
894
9) ROS2 / DDS support
895
- Added support for EProsima MicroXRCEDDS as a transport in SITL and hardware
896
- Added sensor data topic support such as NavSatStatus and BatteryState
897
- Added velocity control support in Copter
898
- Added a new AP_ExternalControl library for generic control support in SI units
899
- Added support for building ArduPilot with the colcon build system
900
- DDS topics comply with ROS REP-147
901
- Added Gazebo Garden and Gazebo Harmonic simulation with examples
902
- Added support for ROS 2 services such as Arm and Mode control
903
- Added high level goal interface for waypoints
904
- Wiki updated to support ROS 2
905
- Added ROS 2 launch scripts for SITL, MAVProxy and micro-ROS agent
906
- Add pytests for DDS client and ROS 2 launch scripts and integrate into CI
907
10) Camera and gimbal enhancements
908
- Calculates location where camera gimbal is pointing (see CAMERA_FOV_STATUS)
909
- CAMx_MNT_INST allows specifying which mount camera is in
910
- Camera lens (e.g. live video stream) selectable using RC aux function
911
- Follow mode can point gimbal at lead vehicle
912
- Circle mode can point gimbal at circle center (see CIRCLE_OPTIONS)
913
- Interval timer (for taking pictures at timed intervals)
914
- Image tracking support (ViewPro only)
915
- MAVLink Gimbal Protocol v2 support for better GCS integration
916
- MNTx_SYSID_DFLT allows easier pointing gimbal at another vehicle
917
- MOUNT_CONTROL, MOUNT_CONFIGURE messages deprecated
918
- RangeFinder support (only logged, only supported on Siyi, Viewpro)
919
- Pilot's RC input re-takes manual control of gimbal (e.g. switches to RC_TARGETING mode)
920
- Siyi driver gets Zoom control, sends autopilot attitude and time (reduces leans)
921
- Video recording may start when armed (see CAMx_OPTIONS)
922
- ViewPro driver (replaces equivalent Lua driver)
923
- Xacti camera gimbal support
924
- Zoom percentage support (for both missions and GCS commands)
925
11) Logging and reporting changes
926
- Battery logging (e.g. BAT) includes health, temperature, state-of-health percentage
927
- CAM and MNT messages contain camera gimbal's desired and actual angles
928
- INS_RAW_LOG_OPT allows raw, pre-filter and post-filter sensor data logging (alternative to "batch logging", good for filtering analysis)
929
- PID logging gets reset and I-term-set flags
930
- Rangefinder logging (e.g. RFND) includes signal quality
931
- RC aux functions sorted alphabetically for GCS
932
- RC logging (RCI, RCI2) include valid input and failsafe flags
933
- RTK GPS logging includes number of fragments used or discarded
934
12) Scripting enhancements
935
- Autopilot reboot support
936
- Baro, Compass, IMU, IOMCU health check support
937
- Battery cell voltage bindings
938
- Battery driver support
939
- BattEsimate.lua applet estimates SoC from voltage
940
- Camera and Mount bindings improved
941
- CAN input packet filtering reduces work required by Lua CAN drivers
942
- DJI RS2/RS3 gimbal driver supports latest DJI firmware version (see mount-djirs2-driver.lua)
943
- EFI drivers for DLA serial, InnoFlight Inject EFI driver
944
- EFI bindings improved
945
- Fence support
946
- Generator drivers for Halo6000, Zhuhai SVFFI
947
- GCS failsafe support
948
- Hobbywing_DataLink driver (see Hobbywing_DataLink.lua)
949
- is_landing, is_taking_off bindings
950
- led_on_a_switch.lua sets LED brightness from RC switch
951
- MAVLink sending and receiving support
952
- Mission jump_to_landing_sequence binding
953
- mount-poi.lua upgraded to applet, sends better feedback, can lock onto Location
954
- Networking/Ethernet support
955
- Proximity driver support
956
- Rangefinder drivers can support signal quality
957
- revert_param.lua applet for quickly reverting params during tuning
958
- RockBlock.lua applet supports setting mode, fix for battery voltage reporting
959
- Serial/UART reading performance improvement using readstring binding
960
- sport_aerobatics.lua rudder control fixed
961
- Thread priority can be set using SCR_THD_PRIORITY (useful for Lua drivers)
962
- Wind alignment and head_wind speed bindings
963
13) Safety related enhancements and fixes
964
- Arm/Disarmed GPIO may be disabled using BRD_OPTIONS
965
- Arming check of compass vs world magnetic model to detect metal in ground (see ARMING_MAGTHRESH)
966
- Arming check of GPIO pin interrupt storm
967
- Arming check of Lua script CRC
968
- Arming check of mission loaded from SD card
969
- Arming check of Relay pin conflicts
970
- Arming check of emergency stop skipped if emergency stop aux function configured
971
- Arming failures reported more quickly when changing from success to failed
972
- ARMING_OPTIONS allows supressing "Armed", "Disarmed" text messages
973
- BRD_SAFETY_MASK extended to apply to CAN ESCs and servos
974
- Buzzer noise for gyro calibration and arming checks passed
975
- Dijkstras object avoidance supports "fast waypoints" (see AVOID_OPTIONS)
976
- FENCE_OPTIONS supports union OR intersection of all polygon fences
977
- FLTMODE_GCSBLOCK blocks GCS from changing vehicle to specified modes
978
- GCS failsafe action to switch to Brake mode (see FS_GCS_ENABLE)
979
- Main loop lockup recovery by forcing mutex release (only helps if caused by software bug)
980
- Rally points supports altitude frame (AMSL, Relative or Terrain)
981
- SERVO_RC_FS_MSK allows outputs using RC passthrough to move to SERVOx_TRIM on RC failsafe
982
- TKOFF_RPM_MAX aborts takeoff if RPM is too high (for cases where a propeller has come off)
983
14) System Enhancements
984
- CAN port can support a second CAN protocol on the same bus (2nd protocol must be 11 bit, see CAN_Dn_PROTOCOL2)
985
- CAN-FD support (allows faster data transfer rates)
986
- Crash dump info logged if main thread locksup (helps with root cause analysis)
987
- Ethernet/Networking support for UDP and TCP server and client (see NET_ENABLED) and PPP (see SERIALx_PROTOCOL)
988
- Firmware flashing from SD card
989
- Linux board SBUS input decoding made consistent with ChibiOS
990
- Linux boards support DroneCAN
991
- Parameter defaults stored in @ROMFS/defaults.parm
992
- SD Card formatting supported on all boards
993
- Second USB endpoint defaults to MAVLink (instead of SLCAN) except on CubePilot boards
994
- Serial over DroneCAN (see CAN_D1_UC_SER_EN) useful for configuring F9P DroneCAN GPSs using uCenter
995
15) Custom Build server include/exclude features extended to include
996
- APJ Tools
997
- Brake mode
998
- Bootloader flashing
999
- Button
1000
- Compass calibration
1001
- DroneCAN GPS
1002
- ExternalAHRS (e.g. MicroStrain, Vectornav)
1003
- Generator
1004
- Highmark Servo
1005
- Hobbywing ESCs
1006
- Kill IMU
1007
- Payload Place
1008
- Precision landing
1009
- Proximity sensor
1010
- RC Protocol
1011
- Relay
1012
- SBUS Output
1013
- ToneAlarm
1014
- Winch
1015
16) Developer specific items
1016
- ChibiOS upgrade to 21.11
1017
- UAVCAN replaced with DroneCAN
1018
- AUTOPILOT_VERSION_REQUEST message deprecated (use REQUEST_MESSAGE instead)
1019
- PREFLIGHT_SET_SENSOR_OFFSETS support deprecated (was unused by all known ground stations)
1020
- MISSION_SET_CURRENT message deprecated (use DO_SET_MISSION_CURRENT command instead)
1021
- MISSION_CURRENT message sends num commands and stopped/paused/running/complete state
1022
- Python version requirement increased to 3.6.9
1023
- mavlink_parse.py shows all suported mavlink messages
1024
- COMMAND_INT messages can be used for nearly all commands (previously COMMAND_LONG)
1025
17) Bug fixes:
1026
- 3DR Solo gimbal mavlink routing fixed
1027
- Airspeed health always checked before use (may not have been checked when using "affinity")
1028
- Auto mode fix for DO_CHANGE_SPEED commands placed immediately after TAKEOFF (previously were ignored)
1029
- Bootloop fixed if INS_GYRO_FILTER set too high
1030
- Button Internal Error caused by floating pin or slow device power-up fixed
1031
- CAN Compass order maintained even if compass powered up after autopilot
1032
- Compass device IDs only saved when calibrated to ensure external compasses appear as primary on new boards
1033
- Cut corners more by defaulting WPNAV_ACCEL_C to 2x WPNAV_ACCEL
1034
- Currawong ECU EFI does not send exhaust gas temperature
1035
- DJI RS2/RS3 gimbal reported angle fix
1036
- DO_SET_ROI, ROI_LOCATION, ROI_NONE bug fix that could lead to gimbal pointing at old target
1037
- Generator parameter init fix (defaults might not always have been loaded correctly)
1038
- GPS_TC_BLEND parameter removed (it was unused)
1039
- Guided mode protection against targets with NaN values
1040
- Guided mode yaw fix (vehicle might rotate too slowly)
1041
- Harmonic Notch gets protection against extremely low notch filter frequencies
1042
- IE 650/800 Generators report fuel remaining
1043
- INS calibration prevents unlikely case of two calibrations running at same time
1044
- LPS2XH Baro supported over I2C fixed
1045
- MatekH743 storage eeprom size fixed
1046
- MAVLink routing fix to avoid processing packet meant for another vehicle
1047
- Mount properly enforces user defined angle limits
1048
- MPU6500 IMU filter corrected to 4k
1049
- NMEA output time and altitude fixed
1050
- OSD gets labels for all supported serial protocols
1051
- OSD RF panel format fixed
1052
- RobotisServo initialisation fix
1053
- RPM accuracy and time wrap handling improved
1054
- Sagetech ADSB MXS altitude fix (needs amsl, was sending alt-above-terrain)
1055
- SageTechMXS ADSB climb rate direction fixed
1056
- SBUS out exactly matches SBUS in decoding
1057
- Serial port RTS pins default to pulldown (SiK radios could getting stuck in bootloader mode)
1058
- SERIALx_ parameters removed for ports that can't actually be used
1059
- Servo gimbal attitude reporting fix
1060
- Servo output fix when using scaled RC passthrough (e.g. SERVOx_FUNCTION = RCinXScaled)
1061
- Siyi continuous zoom stutter fixed
1062
- Siyi gimbal upside-down mode fixed (avoid bobbing if upside-down)
1063
- SmartRTL premature "buffer full" failure fixed
1064
- ST24 RC protocol fixed
1065
- STM32L496 CAN2 init fix (AP_Periph only?)
1066
- Tricopter, SingleCopter, CoaxCopter fins centered if using BLHeli/DShot
1067
- VFR_HUD climb rate reports best estimate during high vibration events (previously it would stop updating)
1068
- Visual Odometry healthy check fix in case of out-of-memory
1069
- VTX_MAX_POWER restored (allows setting radio's power)
1070
- Yaw limit calculations fixed
1071
------------------------------------------------------------------
1072
Copter 4.4.4 19-Dec-2023 / 4.4.4-beta1 05-Dec-2023
1073
Changes from 4.4.3
1074
1) Autopilot related enhancement and fixes
1075
- CubeOrange Sim-on-hardware compilation fix
1076
- RADIX2HD supports external I2C compasses
1077
- SpeedyBeeF405v4 support
1078
2) Bug fixes
1079
- DroneCAN battery monitor with cell monitor SoC reporting fix
1080
- NTF_LED_TYPES parameter description fixed (was missing IS31FL3195)
1081
- ProfiLED output fixed in both Notify and Scripting
1082
- Scripting bug that could cause crash if parameters were added in flight
1083
- STAT_BOOTCNT param fix (was not updating in some cases)
1084
- Takeoff RPM check fixed where motors are attached to AUX channels
1085
- don't query hobbywing DroneCAN ESC IDs while armed
1086
------------------------------------------------------------------
1087
Copter 4.4.3 14-Nov-2023
1088
Changes from 4.4.3-beta1
1089
1) AP_GPS: correct uBlox M10 configuration on low flash boards
1090
------------------------------------------------------------------
1091
Copter 4.4.3-beta1 07-Nov-2023
1092
Changes from 4.4.2
1093
1) Autopilot related enhancements and fixes
1094
- BETAFTP-F405 board configuration fixes
1095
- CubeOrangePlus-BG edition ICM45486 IMU setup fixed
1096
- YJUAV_A6SE_H743 support
1097
2) Minor enhancements
1098
- GPS_DRV_OPTION allows using ellipsoid height in more GPS drivers
1099
- Lua script support for fully populating ESC telemetry data
1100
3) Bug fixes
1101
- AK09916 compass being non-responsive fixed
1102
- IxM42xxx IMUs "stuck" gyros fixed
1103
- MAVLink response fixed when no airspeed sensor during preflight calibration
1104
- Notch filtering protection when using uninitialised RPM source in ESC telemetry
1105
- SIYI gimbal driver parsing bug fixed (was causing lost packets)
1106
------------------------------------------------------------------
1107
Copter 4.4.2 22-Oct-2023 / Copter 4.4.2-beta1 13-Oct-2023
1108
Changes from 4.4.1
1109
1) Autopilot related enhancements and fixes
1110
- BETAFPV-F405 support
1111
- MambaF405v2 battery and serial setup corrected
1112
- mRo Control Zero OEM H7 bdshot support
1113
- SpeedyBee-F405-Wing gets VTX power control
1114
- SpeedyBee-F405-Mini support
1115
- T-Motor H743 Mini support
1116
2) EKF3 supports baroless boards
1117
3) GPS-for-yaw allows base GPS to update at only 3Hz
1118
4) INA battery monitor supports config of shunt resistor used (see BATTx_SHUNT)
1119
5) Log VER message includes vehicle type
1120
6) OpenDroneId option to auto-store IDs in persistent flash
1121
7) RC SBUS protection against invalid data in first 4 channels
1122
8) Bug fixes
1123
- BMI088 IMU error value handling fixed to avoid occasional negative spike
1124
- Dev environment CI autotest stability improvements
1125
- OSD correct DisplayPort BF MSP symbols
1126
- OSD option to correct direction arrows for BF font set
1127
- Sensor status reporting to GCS fixed for baroless boards
1128
------------------------------------------------------------------
1129
Copter 4.4.1 26-Sep-2023 / 4.4.1-beta2 14-Sep-2023
1130
Changes from 4.4.1-beta1
1131
1) Autopilot related enhancements
1132
- H750 external flash optimisations for to lower CPU load
1133
- MambaF405Mini fixes to match manufacturer's recommended wiring
1134
- RADIX2 HD support
1135
- YJUAV_A6SE support
1136
2) Bug fixes
1137
- Airbotf4 features minimised to build for 4.4
1138
- ChibiOS clock fix for 480Mhz H7 boards (affected FDCAN)
1139
- RPI hardware version check fix
1140
------------------------------------------------------------------
1141
Copter 4.4.1-beta1 05-Sep-2023
1142
Changes from 4.4.0
1143
1) Autopilot related fixes and enhancements
1144
- KakuteH7-wing get 8 bit directional dshot channel support
1145
- Luminousbee5 boards defaults updated
1146
- Navigator autopilot GPIOs fix (PWM output was broken)
1147
- Pixhawk6C Serial RTS lines pulled low on startup
1148
- QiotekZealotF427 and QiotekZealotH743 battery monitor default fixed
1149
- SDMODELH7V1 support
1150
2) Driver enhancements
1151
- DroneCAN battery monitors allow reset of battery SoC
1152
- Himark DroneCAN servo support
1153
- Hobbywing DroneCAN ESC support
1154
3) EKF3 high vibration handling improved with EK3_GLITCH_RADIUS option
1155
4) Custom build server gets mission storage on SDCard selection
1156
5) SITL default parameter handling bug fix
1157
------------------------------------------------------------------
1158
Copter 4.4.0 18-Aug-2023 / 4.4.0-beta5 12-Aug-2023
1159
Changes from 4.4.0-beta4
1160
1) Autopilots specific changes
1161
- SIYI N7 support
1162
2) Bug fixes
1163
- DroneCAN airspeed sensor fix to handle missing packets
1164
- DroneCAN GPS RTK injection fix
1165
- Notch filter gyro glitch caused by race condition fixed
1166
------------------------------------------------------------------
1167
Copter 4.4.0-beta4 27-July-2023
1168
Changes from 4.4.0-beta3
1169
1) Autopilots specific changes
1170
- Diatone-Mamba-MK4-H743v2 uses SPL06 baro (was DPS280)
1171
- DMA for I2C disabled on F7 and H7 boards
1172
- Foxeer H743v1 default serial protocol config fixes
1173
- HeeWing-F405 and F405v2 support
1174
- iFlight BlitzF7 support
1175
2) Scripts may take action based on VTOL motor loss
1176
3) Bug fixes
1177
- BLHeli returns battery status requested via MSP (avoids hang when using esc-configurator)
1178
- CRSFv3 rescans at baudrates to avoid RX loss
1179
- EK3_ABIAS_P_NSE param range fix
1180
- Scripting restart memory corruption bug fixed
1181
- Siyi A8/ZR10 driver fix to avoid crash if serial port not configured
1182
------------------------------------------------------------------
1183
Copter 4.4.0-beta3 03-July-2023
1184
Changes from 4.4.0-beta2
1185
1) Autopilots specific changes
1186
- Holybro KakuteH7-Wing support
1187
- JFB100 external watchdog GPIO support added
1188
- Pixhawk1-bdshot support
1189
- Pixhawk6X-bdshot support
1190
- SpeedyBeeF4 loses bdshot support
1191
2) Device drivers
1192
- added LP5562 I2C LED driver
1193
- added IS31FL3195 LED driver
1194
3) TradHeli gets minor fix to RSC servo output range
1195
4) Camera and Gimbal related changes
1196
- DO_SET_ROI_NONE command support added
1197
5) Applet changes
1198
- added QUIK_MAX_REDUCE parameter to VTOL quicktune lua applet
1199
6) Bug fixes
1200
- ADSB sensor loss of transceiver message less spammy
1201
- AutoTune Yaw rate max fixed
1202
- EKF vertical velocity reset fixed on loss of GPS
1203
- GPS pre-arm failure message clarified
1204
- SERVOx_PROTOCOL "SToRM32 Gimbal Serial" value renamed to "Gimbal" because also used by Siyi
1205
- SERIALx_OPTION "Swap" renamed to "SwapTXRX" for clarity
1206
- SBF GPS ellipsoid height fixed
1207
- Ublox M10S GPS auto configuration fixed
1208
- ZigZag mode user takeoff fixed (users could not takeoff in ZigZag mode previously)
1209
------------------------------------------------------------------
1210
Copter 4.4.0-beta2 05-Jun-2023
1211
Changes from 4.4.0-beta1
1212
1) Autopilots specific changes
1213
- FlywooF745 update to motor pin output mapping and baro
1214
- FoxeerH743 support
1215
- JFB100 support
1216
- Mamba-F405v2 supports ICM42688
1217
- Matek-F405-TE/VTOL support
1218
- Matek-H743 IMU SPI slowed to 1Mhz to avoid init issues
1219
- SpeedyBee-405-Wing support
1220
2) Copter specfic fixes and enhancements
1221
- RTL speed fix so changes to WPNAV_SPEED have no effect if RTL_SPEED is non-zero
1222
- RTL mode accepts do-change-speed commands from GCS
1223
3) AHRS/EKF related fixes and Enhancements
1224
- EKF allocation failure handled to avoid watchdog
1225
- EKF3 accel bias calculation fix and tuning for greater robustness
1226
- Airspeed sensor remains enabled during dead-reckoning (few copters have airspeed sensors)
1227
- Wind speed estimates updates reduced while dead-reckoning
1228
4) Other Enhancements
1229
- Attitude control slew limits always calculated (helps tuning reporting and analysis)
1230
- INA228 and INA238 I2C battery monitor support
1231
- LOG_DISARMED=3 logs while disarmed but discards log if never eventually armed
1232
- LOG_DARM_RATEMAX reduces logging while disarmed
1233
- Serial LEDs threading enhancement to support longer lengths without dshot interference
1234
4) Bug fixes
1235
- Analog battery monitor2 current parameter default fixed
1236
- AutoTune fix for loading Yaw Rate D gains
1237
- BRD_SAFETYOPTION parameter documentation fix (ActiveForSafetyEnable and Disable were reversed)
1238
- Compassmot fix to protect against bad gyro biases from GSF yaw
1239
- ICE engine fix for starting after reaching a specified altitude
1240
- LED thread locking fix to avoid watchdog
1241
- Logging rotation on disarm disabled if Replay logging active (avoids gaps in logs)
1242
- RC input on IOMCU bug fix (RC might not be regained if lost)
1243
- Serial passthrough fixed
1244
5) Custom build server fix to which features are included/excluded
1245
------------------------------------------------------------------
1246
Copter 4.4.0-beta1 19-Apr-2023
1247
Changes from 4.3.6
1248
1) New autopilots supported
1249
- ESP32
1250
- Flywoo Goku F405S AIO
1251
- Foxeer H743v1
1252
- MambaF405-2022B
1253
- PixPilot-V3
1254
- PixSurveyA2
1255
- rFCU H743
1256
- ThePeach K1/R1
1257
2) Autopilot specific changes
1258
- Bi-Directional DShot support for CubeOrangePlus-bdshot, CUAVNora+, MatekF405TE/VTOL-bdshot, MatekL431, Pixhawk6C-bdshot, QioTekZealotH743-bdshot
1259
- Bi-Directional DShot up to 8 channels on MatekH743
1260
- BlueRobotics Navigator supports baro on I2C bus 6
1261
- BMP280 baro only for BeastF7, KakuteF4, KakuteF7Mini, MambaF405, MatekF405, Omnibusf4 to reduce code size (aka "flash")
1262
- CSRF and Hott telemetry disabled by default on some low power boards (aka "minimised boards")
1263
- Foxeer Reaper F745 supports external compasses
1264
- OmnibusF4 support for BMI270 IMU
1265
- OmnibusF7V2-bdshot support removed
1266
- KakuteF7 regains displayport, frees up DMA from unused serial port
1267
- KakuteH7v2 gets second battery sensor
1268
- MambaH743v4 supports VTX
1269
- MatekF405-Wing supports InvensenseV3 IMUs
1270
- PixPilot-V6 heater enabled
1271
- Raspberry 64OS startup crash fixed
1272
- ReaperF745AIO serial protocol defaults fixed
1273
- SkystarsH7HD (non-bdshot) removed as users should always use -bdshot version
1274
- Skyviper loses many unnecessary features to save flash
1275
- UBlox GPS only for AtomRCF405NAVI, BeastF7, MatekF405, Omnibusf4 to reduce code size (aka "flash")
1276
- VRBrain-v52 and VRCore-v10 features reduced to save flash
1277
3) Driver enhancements
1278
- ARK RTK GPS support
1279
- BMI088 IMU filtering and timing improved, ignores bad data
1280
- CRSF OSD may display disarmed state after flight mode (enabled using RC_OPTIONS)
1281
- Daiwa winch baud rate obeys SERIALx_BAUD parameter
1282
- EFI supports fuel pressure and ignition voltage reporting and battery failsafe
1283
- ICM45686 IMU support
1284
- ICM20602 uses fast reset instead of full reset on bad temperature sample (avoids occasional very high offset)
1285
- ICM45686 supports fast sampling
1286
- MAX31865 temp sensor support
1287
- MB85RS256TY-32k, PB85RS128C and PB85RS2MC FRAM support
1288
- MMC3416 compass orientation fix
1289
- MPPT battery monitor reliability improvements, enable/disable aux function and less spammy
1290
- Multiple USD-D1-CAN radar support
1291
- NMEA output rate configurable (see NMEA_RATE_MS)
1292
- NMEA output supports PASHR message (see NMEA_MSG_EN)
1293
- OSD supports average resting cell voltage (see OSD_ACRVOLT_xxx params)
1294
- Rockblock satellite modem support
1295
- Serial baud support for 2Mbps (only some hardware supports this speed)
1296
- SF45b lidar filtering reduced (allows detecting smaller obstacles
1297
- SmartAudio 2.0 learns all VTX power levels)
1298
- UAVCAN ESCs report error count using ESC Telemetry
1299
- Unicore GPS (e.g. UM982) support
1300
- VectorNav 100 external AHRS support
1301
- 5 IMUs supported
1302
4) EKF related enhancements
1303
- Baro compensation using wind estimates works when climbing or descending (see BAROx_WCF_UP/DN)
1304
- External AHRS support for enabling only some sensors (e.g. IMU, Baro, Compass) see EAHRS_SENSORS
1305
- Magnetic field tables updated
1306
- Non-compass initial yaw alignment uses GPS course over GSF (mostly affects Planes and Rover)
1307
5) Control and navigation enhancements
1308
- AutoTune of attitude control yaw D gain (set AUTOTUNE_AXES=8)
1309
- Circle moode and Loiter Turns command supports counter-clockwise rotation (set CIRCLE_RATE to negative number)
1310
- DO_SET_ROI_NONE command turns off ROI
1311
- JUMP_TAG mission item support
1312
- Missions can be stored on SD card (see BRD_SD_MISSION)
1313
- NAV_SCRIPT_TIME command accepts floating point arguments
1314
- Pause/Resume returns success if mission is already paused or resumed
1315
- Payload Place enhancements
1316
- Descent speed is configurable (see PLDP_SPEED_DN)
1317
- Manual release supported (detects pilot release of gripper)
1318
- Post release delay is configurable (see PLDP_DELAY)
1319
- Range finder range used to protect against premature release (see PLDP_RNG_MIN)
1320
- Touchdown detection threshold is configurable (see PLDP_THRESH)
1321
- Position controller angle max adjusted inflight with CH6 Tuning knob (set TUNE=59)
1322
- Surface tracking time constant allows tuning response (see SURFTRAK_TC)
1323
- Throttle-Gain boost increases attitude control gains when throttle high (see ATC_THR_G_BOOST)
1324
- Waypoint navigation cornering acceleration is configurable (see WPNAV_ACCEL_C)
1325
- WeatherVane into the wind in Auto and Guided modes (see WVANE_ENABLE)
1326
6) TradHeli specific enhancements
1327
- Manual autorotation support
1328
- Improved collect to yaw compensation
1329
7) Filtering enhancements
1330
- FFT notch can be run based on filtered data
1331
- Warn of motor noise at RPM frequency using FFT
1332
- In-flight FFT can better track low frequency noise
1333
- In-flight FFT logging improved
1334
- IMU data can be read and replayed for FFT analysis
1335
8) Camera and gimbal enhancements
1336
- BMMCC support included in Servo driver
1337
- DJI RS2/RS3-Pro gimbal support
1338
- Dual camera support (see CAM2_TYPE)
1339
- Gimbal/Mount2 can be moved to retracted or neutral position
1340
- Gremsy ZIO support
1341
- IMAGE_START_CAPTURE, SET_CAMERA_ZOOM/FOCUS, VIDEO_START/STOP_CAPTURE command support
1342
- Paramters renamed and rescaled
1343
- CAM_TRIGG_TYPE renamed to CAM1_TYPE and options have changed
1344
- CAM_DURATION renamed to CAM1_DURATION and scaled in seconds
1345
- CAM_FEEDBACK_PIN/POL renamed to CAM1_FEEBAK_PIN/POL
1346
- CAM_MIN_INTERVAL renamed to CAM1_INTRVAL_MIN and scaled in seconds
1347
- CAM_TRIGG_DIST renamed to CAMx_TRIGG_DIST and accepts fractional values
1348
- RunCam2 4k support
1349
- ViewPro camera gimbal support
1350
9) Logging changes
1351
- BARD msg includes 3-axis dynamic pressure useful for baro compensation of wind estimate
1352
- MCU log msg includes main CPU temp and voltage (was part of POWR message)
1353
- RCOut banner message always included in Logs
1354
- SCR message includes memory usage of all running scripts
1355
- CANS message includes CAN bus tx/rx statistics
1356
- OFCA (optical flow calibration log message) units added
1357
- Home location not logged to CMD message
1358
- MOTB message includes throttle output
1359
10) Scripting enhancements
1360
- Copter deadreckoning upgraded to applet
1361
- EFI Skypower driver gets improved telem messages and bug fixes
1362
- Generator throttle control example added
1363
- Heap max increased by allowing heap to be split across multiple underlying OS heaps
1364
- Hexsoon LEDs applet
1365
- Logging from scripts supports more formats
1366
- Parameters can be removed or reordered
1367
- Parameter description support (scripts must be in AP's applet or driver directory)
1368
- Rangefinder driver support
1369
- Runcam_on_arm applet starts recording when vehicle is armed
1370
- Safety switch, E-Stop and motor interlock support
1371
- Scripts can restart all scripts
1372
- Script_Controller applet supports inflight switching of active scripts
1373
11) Custom build server enhancements
1374
- AIS support for displaying nearby boats can be included
1375
- Battery, Camera and Compass drivers can be included/excluded
1376
- EKF3 wind estimation can be included/excluded
1377
- PCA9685, ToshibaLED, PLAY_TUNE notify drivers can be included/excluded
1378
- Preclanding can be included/excluded
1379
- RichenPower generator can be included/excluded
1380
- RC SRXL protocol can be excluded
1381
- SIRF GPSs can be included/excluded
1382
12) Safety related enhancements and fixes
1383
- Arming check for high throttle skipped when arming in Auto mode
1384
- Arming check for servo outputs skipped when SERVOx_FUNCTION is scripting
1385
- Arming check fix if both "All" and other bitmasks are selected (previously only ran the other checks)
1386
- "EK3 sources require RangeFinder" pre-arm check fix when user only sets up 2nd rangefinder (e.g. 1st is disabled)
1387
- Pre-arm check that low and critical battery failsafe thresholds are different
1388
- Pre-arm message fixed if 2nd EKF core unhealthy
1389
- Pre-arm check if reboot required to enabled IMU batch sampling (used for vibe analysis)
1390
- RC failsafe (aka throttle failsafe) option to change to Brake mode
1391
- RC failsafe timeout configurable (see RC_FS_TIMEOUT)
1392
- Takeoff check of motor RPM (see TKOFF_RPM_MIN)
1393
- Turtle mode warns user to raise throttle to arm
1394
13) Minor enhancements
1395
- Boot time reduced by improving parameter conversion efficiency
1396
- BRD_SAFETYENABLE parameter renamed to BRD_SAFETY_DEFLT
1397
- Compass calibration auxiliary switch function (set RCx_OPTION=171)
1398
- Disable IMU3 auxiliary switch function (set RCx_OPTION=110)
1399
- Frame type sent to GCS defaults to multicopter to ease first time setup
1400
- Rangefinder and FS_OPTIONS param conversion code reduced (affects when upgrading from 3.6 or earlier)
1401
- MAVFTP supports file renaming
1402
- MAVLink in-progress reply to some requests for calibration from GCS
1403
14) Bug fixes:
1404
- ADSB telemetry and callsign fixes
1405
- Battery pct reported to GCS limited to 0% to 100% range
1406
- Bi-directional DShot fix on H7 boards after system time wrap (more complete fix than in 4.3.6)
1407
- DisplayPort OSD screen reliability improvement on heavily loaded OSDs especially F4 boards
1408
- DisplayPort OSD artificial horizon better matches actual horizon
1409
- EFI Serial MS bug fix to avoid possible infinite loop
1410
- EKF3 Replay fix when COMPASS_LEARN=3
1411
- ESC Telemetry external temp reporting fix
1412
- Fence upload works even if Auto mode is excluded from firmware
1413
- FMT messages logged even when Fence is exncluded from firmware (e.g. unselected when using custom build server)
1414
- Guided mode slow yaw fix
1415
- Hardfault avoided if user changes INS_LOG_BAT_CNT while batch sampling running
1416
- ICM20649 temp sensor tolerate increased to avoid unnecessary FIFO reset
1417
- IMU detection bug fix to avoid duplicates
1418
- IMU temp cal fix when using auxiliary IMU
1419
- Message Interval fix for restoring default rate https://github.com/ArduPilot/ardupilot/pull/21947
1420
- RADIO_STATUS messages slow-down feature never completely stops messages from being sent
1421
- SERVOx_TRIM value output momentarily if SERVOx_FUNCTION is changed from Disabled to RCPassThru, RCIN1, etc. Avoids momentary divide-by-zero
1422
- Scripting file system open fix
1423
- Scripting PWM source deletion crash fix
1424
- MAVFTP fix for low baudrates (4800 baud and lower)
1425
- ModalAI VOXL reset handling fix
1426
- MPU6500 IMU fast sampling rate to 4k (was 1K)
1427
- NMEA GPGGA output fixed for GPS quality, num sats and hdop
1428
- Position control reset avoided even with very uneven main loop rate due to high CPU load
1429
- SingleCopter and CoaxCopter fix to fin centering when using DShot
1430
- SystemID mode fix to write PID log messages
1431
- Terrain offset increased from 15m to 30m (see TERRAIN_OFS_MAX)to reduce chance of "clamping"
1432
- Throttle notch FFT tuning param fix
1433
- VTX protects against pitmode changes when not enabled or vehicle disarmed
1434
15) Developer specific items
1435
- DroneCAN replaces UAVCAN
1436
- FlighAxis simulator rangefinder fixed
1437
- Scripts in applet and drivers directory checked using linter
1438
- Simulator supports main loop timing jitter (see SIM_TIME_JITTER)
1439
- Simulink model and init scripts
1440
- SITL on hardware support (useful to demo servos moving in response to simulated flight)
1441
- SITL parameter definitions added (some, not all)
1442
- Webots 2023a simulator support
1443
- XPlane support for wider range of aircraft
1444
------------------------------------------------------------------
1445
Copter 4.3.8 24-Aug-2023 / 4.3.8-beta1 12-Aug-2023
1446
Changes from 4.3.7
1447
1) Bug fixes
1448
- DroneCAN GPS RTK injection fix
1449
- INAxxx battery monitors allow for battery reset remaining
1450
- Notch filter gyro glitch caused by race condition fixed
1451
- Scripting restart memory corruption bug fixed
1452
------------------------------------------------------------------
1453
Copter 4.3.7 31-May-2023 / 4.3.7-beta1 24-May-2023
1454
Changes from 4.3.6
1455
1) Bug fixes
1456
a) EKF3 accel bias calculations bug fix
1457
b) EKF3 accel bias process noise adjusted for greater robustness
1458
c) GSF yaw numerical stability fix caused by compassmot
1459
d) INS batch sampler fix to avoid watchdog if INS_LOG_BAT_CNT changed without rebooting
1460
e) Memory corruption bug in the STM32H757 (very rare)
1461
f) RC input on IOMCU bug fix (RC might not be regained if lost)
1462
------------------------------------------------------------------
1463
Copter 4.3.6 05-Apr-2023 / 4.3.6-beta1, 4.3.6-beta2 27-Mar-2023
1464
Changes from 4.3.5
1465
1) Bi-directional DShot fix for possible motor stop approx 72min after startup
1466
------------------------------------------------------------------
1467
Copter Copter 4.3.5 14-Mar-2023 / 4.3.5-rc1 01-Mar-2023
1468
Changes from 4.3.4
1469
1) Bug fixes
1470
a) GPS unconfigured error fix for non-M10 uBlox GPS
1471
b) Gremsy gimbal fix when attached to autopilot's serial3 (or higher)
1472
c) Landing detector fix with large AHRS_TRIM values (>0.1)
1473
d) MambaF405 2022 gets VTX power on support
1474
e) MCU voltage enabled on H757 CPUs (including CubeOrangePlus)
1475
f) PiccoloCAN fix for ESC voltage and current scaling
1476
g) Servo gimbal mount yaw handling fix (only affects 3-axis servo gimbals)
1477
------------------------------------------------------------------
1478
Copter 4.3.4 01-Mar-2023
1479
Changes from 4.3.4-rc1
1480
1) Lua script PWMSource feature disabled (will be back in 4.4.x)
1481
------------------------------------------------------------------
1482
Copter 4.3.4-rc1 14-Feb-2023
1483
Changes from 4.3.3
1484
1) AutoPilot specific enhancements
1485
a) CubeOrangePlusBG support
1486
b) Foxeer ReaperF745 supports external compass
1487
c) MambaH743v4 supports VTX power
1488
2) Precision landing option to resume tracking target after pilot repositioning
1489
3) Bug fixes
1490
a) Arming check fix for terrain following with rangefinder (failed if terrain db was disabled)
1491
b) Arming check fix if BARO_FIELD_ELEV set
1492
c) Compass calibration diagonals set to 1,1,1 if incorrectly set to 0,0,0
1493
d) FFT notch tune feature disabled (will be re-released in 4.4)
1494
e) Gimbal's yaw feed-forward set to zero when landed (affects Gremsy gimbals)
1495
f) IOMCU double reset and safety disable fix
1496
g) Logging fix for duplicate format messages
1497
h) OpenDroneId sets emergency status on crash or chute deploy
1498
i) Peripheral firmware updates using MAVCAN fixed
1499
j) RC protocol cannot be changed once detected on boards with IOMCU
1500
k) Surface tracking uses filtered and corrected rangefinder values
1501
------------------------------------------------------------------
1502
Copter 4.3.3 20-Jan-2023
1503
Changes from 4.3.3-rc1
1504
1) Bug fixes
1505
a) MAVFTP fix to terminate session error (could cause FTP failures)
1506
b) IMU fast fifo reset log message max frequency reduced
1507
------------------------------------------------------------------
1508
Copter 4.3.3-rc1 09-Jan-2023
1509
Changes from 4.3.2
1510
1) Autopilot related changes
1511
a) AIRLink LTE module enable pin and HEAT_ params added
1512
b) CUAV Nora/Nora+ bdshot firmware (allows Bi-directional DShot)
1513
c) CubeOrange, CubeYellow gets fast reset of ICM20602
1514
d) MambaH743v2 with dual ICM42688 supported
1515
e) PixPilot-V6
1516
2) Attitude and Navigation controllers use real-time dt (better handles variable or slow main loop)
1517
3) MAVFTP speed improvement including faster param download
1518
4) Bug fixes
1519
a) Analog rangefinder GPIO pin arming check fixed
1520
b) Arming check of AHRS/EKF vs GPS location disabled if GPS disabled
1521
c) CRSF gets RC_OPTIONS for ELRS baudrate to avoid RC failsafes
1522
d) Null pointer checks avoid watchdog when out of memory
1523
e) Position Controller limit handling improved to avoid overshooting and hard landings
1524
f) Position Controller internal error after 70min of flight fixed
1525
g) PSC_ANGLE_MAX param reduction causing WPNAV_ACCEL to be set too low fixed
1526
h) Servo gimbal yaw jump to opposite side fixed
1527
i) Siyi A8 gimbal driver's record video feature fixed
1528
j) SToRM32 serial gimbal driver actual angle reporting fixed (pitch and yaw angle signs were reversed)
1529
k) Takeoff in Auto, Guided fixed when target altitude is current altitude
1530
l) Takeoff in Auto handles baro drift before takeoff
1531
m) Takeoff twitch due to velocity integrator init bug fixed
1532
------------------------------------------------------------------
1533
Copter 4.3.2 23-Dec-2022
1534
Changes from 4.3.2-rc1
1535
1) Reverted arming check that main loop is running at configured speed (e.g. SCHED_LOOP_RATE)
1536
------------------------------------------------------------------
1537
Copter 4.3.2-rc1 10-Dec-2022
1538
Changes from 4.3.1
1539
1) Arming check that main loop is running at configured speed (e.g. SCHED_LOOP_RATE)
1540
2) uBlox M10 support
1541
3) Autopilot specific changes
1542
a) CubeOrange defaults to using 2nd IMU as primary
1543
b) SIRF and SBP GPS disabled on BeastF7v2, MatekF405-STD, MAtekF405-Wing, omnibusf4pro
1544
4) Bug fixes
1545
a) AutoTune gains loaded correctly during pilot testing
1546
b) Camera driver's CAM_MIN_INTERVAL fixed if pilot manually triggers extra picture
1547
c) EKF3 fix when using EK3_RNG_USE_HGT/SPD params and rangefinder provides bad readings
1548
d) Main loop slowdown after arming fixed (parameter logging was causing delays)
1549
e) Main loop's fast tasks always run (caused twitches in Loiter on heavily loaded CPUs)
1550
f) MAVLink commands received on private channels checked for valid target sysid
1551
g) ModalAI cameras support fixed (ODOMETRY message frame was consumed incorrectly)
1552
h) Param reset after firmware load fixed on these boards
1553
- BeastF7v2
1554
- CubeYellow-bdshot
1555
- f405-MatekAirspeed
1556
- FlywooF745Nano
1557
- KakuteF4Mini
1558
- KakuteF7-bdshot
1559
- MatekF405-bdshot
1560
- MatekF405-STD
1561
- MatekF405-Wing-bdshot
1562
- MatekF765-SE
1563
- MatekF765-Wing-bdshot
1564
i) Siyi A8 gimbal support fixed
1565
j) Windows builds move to compiling only 64-bit executables
1566
------------------------------------------------------------------
1567
Copter 4.3.1 05-Dec-2022 / 4.3.1-rc1 17-Nov-2022
1568
Changes from 4.3.0
1569
1) Autopilot specific enhancements
1570
a) ARKV6X support
1571
b) MatekH743 supports 8 bi-directional dshot channels
1572
c) Pixhawk boards support MS5607 baros
1573
d) SpeedbyBee F405v3 support
1574
2) DroneCAN Airspeed sensor support including hygrometer (aka water vapour) readings
1575
3) EFI support (electronic fuel injection engines)
1576
4) Pre-arm warning if multiple UARTs with SERIALx_PROTOCOL = RCIN
1577
5) Siyi gimbal support
1578
6) Bug fixes
1579
a) Arm check warning loses duplicate "AHRS" prefix
1580
b) AtomRCF405NAVI bootloader file name fixed
1581
c) BRD_SAFETY_MASK fixed on boards with both FMU safety switch and IOMCU
1582
d) Compass calibration continues even if a single compass's cal fails
1583
e) Gremsy gimbal driver sends autopilot info at lower rate to save bandwidth
1584
f) Invensense 42605 and 42609 IMUs use anti-aliasing filter and notch filter
1585
g) Mode change to AUTOTUNE message shortened
1586
h) OSD stats screen fix
1587
i) RC input on serial port uses first UART with SERIALx_PROTOCOL = 23 (was using last)
1588
j) RunCam caching fix with enablement and setup on 3-pos switch
1589
k) RTK CAN GPS fix when GPSs conneted to separate CAN ports on autopilot
1590
l) SkyViper GPS fix
1591
m) Turtle mode safety fixes (e.g. can only enter Tutle mode with at zero throttle)
1592
------------------------------------------------------------------
1593
Copter 4.3.0 31-Oct-2022 / 4.3.0-beta4 24-Oct-2022
1594
Changes from 4.3.0-beta3
1595
1) Scripting supports implementing AUX functions
1596
2) Bug fixes
1597
a) BMI085 accel scaling fixed
1598
b) Build with gcc 11.3 fixed (developer only)
1599
c) EKF3 alt discrepancy if GPS or baro alt changed soon after startup fixed
1600
d) Harmonic Notch and ESC telem fix when motor outputs are non-contiguous
1601
e) NMEA GPS's KSXT message parsing fixed (affected position accuracy)
1602
f) Scripting random number generator fix
1603
------------------------------------------------------------------
1604
Copter 4.3.0-beta3 14-Oct-2022
1605
Changes from 4.3.0-beta2
1606
1) Pixhawk1-1M, fmuv2, fmuv3 display warning if firmware mismatches board's flash size (1M and 2M)
1607
2) Scripting support for multi-byte i2c reads
1608
3) Bug fixes
1609
a) Airspeed CAN sensor ordering fixed (ordering could change if using multiple airspeed sensors)
1610
b) BRD_SAFETY_MASK fix for enabling outputs when safety is on
1611
c) Defaults.parm file processing fixed when a line has >100 characters and/or no new line (developer only)
1612
d) NMEA serial output precision fixed (was only accurate to 1m, now accurate to 1cm)
1613
------------------------------------------------------------------
1614
Copter 4.3.0-beta2 4-Oct-2022
1615
Changes from 4.3.0-beta1
1616
1) Autopilot specific fixes and enhancements
1617
a) AIRLink autopilot supports UART2
1618
b) CUAV V6X supports CAN battery monitor by default
1619
c) MatekF405-CAN board uses less memory to fix compass calibration issues
1620
d) Pixhawk1-1M only supports uBlox and NMEA GPSs to save flash space
1621
e) SkystarsH7HD-bdshot (allows Bi-directional DShot)
1622
f) SkystarsH7HD supports VTX power by default
1623
2) EFI support
1624
a) Currawong ECU support (added as Electronic Fuel Injection driver)
1625
b) Scripting support for EFI drivers (allows writing EFI drivers in Lua)
1626
c) SkyPower and HFE CAN EFI drivers (via scripting)
1627
3) Safety features
1628
a) Arming check that SPIN_MIN less than 0.3 and greater than SPIN_ARM
1629
4) Minor enhancements
1630
a) Autopilot board names max length increased to 23 characters (was 13)
1631
b) CAN actuators can report PWM equivalent values (eases debugging)
1632
c) Log download speed improved for boards with "block" backends
1633
d) Notch filter slew limit reduces chance of notch freq moving incorrectly
1634
e) SLCAN disabled when vehicle is armed to reduce CPU load
1635
5) Bug fixes
1636
a) DO_JUMP mission command fixed if active command changed before changing to Auto mode
1637
b) EKF3 altitude error fix when using dual GPSs and affinity enabled
1638
c) FFT indexing bug fixed
1639
d) Gimbal mount fix to default mode (see MNTx_DEFLT_MODE parameter)
1640
e) MSP fix to report arm status to DJI FPV goggles
1641
f) Notch fix for non-throttle notch (was being incorrectly disabled)
1642
g) OSD fixes for params, font and resolution
1643
h) RPM reporting from harmonic notch fixed
1644
i) "Sending unknown message (50)" warning removed
1645
j) SBF/GSOF/NOVA GPS auto detction of baud rate fixed
1646
k) VideoTX fixes for buffer overruns and Tramp video transmitter support
1647
------------------------------------------------------------------
1648
Copter 4.3.0-beta1 14-Sep-2022
1649
Changes from 4.2.3
1650
1) New autopilot support
1651
a) AtomRCF405
1652
b) CubeOrange-SimOnHardWare
1653
c) DevEBoxH7v2
1654
d) KakuteH7Mini-Nand
1655
e) KakuteH7v2
1656
f) Mamba F405 Mk4
1657
g) SkystarsH7HD
1658
h) bi-directional dshot (aka "bdshot") versions for CubeOrange, CubeYellow, KakuteF7, KakuteH7, MatekF405-Wing, Matek F765, PH4-mini, Pixhawk-1M
1659
2) EKF enhancements and fixes
1660
a) EK3_GPS_VACC_MAX threshold to control when GPS altitude is used as alt source
1661
b) EKF ring buffer fix for very slow sensor updates (those that update once every few seconds)
1662
c) EKF3 source set change captured in Replay logs
1663
3) Gimbal enhancements
1664
a) Angle limit params renamed and scaled to degrees (e.g. MNT1_ROLL_MIN, MNT1_PITCH_MIN, etc)
1665
b) BrushlessPWM driver (set MNT1_TYPE = 7) is unstabilized Servo driver
1666
c) Dual mount support (see MNT1_, MNT2 params)
1667
d) Gremsy driver added (set MNT1_TYPE = 6)
1668
e) MAVLink gimbalv2 support including sending GIMBAL_DEVICE_STATUS_UPDATE (replaces MOUNT_STATUS message)
1669
f) "Mount Lock" auxiliary switch supports follow and lock modes in RC targetting (aka earth-frame and body-frame)
1670
g) RC channels to control gimbal set using RCx_OPTION = 212 (Roll), 213 (Pitch) or 214 (Yaw)
1671
h) RC targetting rotation rate in deg/sec (see MNT1_RC_RATE which replaces MNT_JSTICK_SPD)
1672
i) Yaw can be disabled on 3-axis gimbals (set MNTx_YAW_MIN = MNTx_YAW_MAX)
1673
4) Navigation and Flight mode enhancements
1674
a) Auto mode ATTITUDE_TIME command allows specifying lean angle for specified number of seconds (GPS not required)
1675
b) Auto mode support of DO_GIMBAL_MANAGER_PITCHYAW command
1676
c) Auto mode LOITER_TURNS command max radius increased to 2.5km
1677
d) AutoTune allows higher ANGLE_P gains
1678
e) Guided mode support DO_CHANGE_SPEED commands
1679
f) Manual modes throttle mix reduced (improves landing)
1680
g) Payload touchdown detection reliability improved
1681
h) Takeoff detection improved to reduce chance of flip before takeoff if GPS moves
1682
i) TKOFF_SLEW_TIME allows slower takeoffs in Auto, Guided, etc
1683
5) Notch filter enhancements
1684
a) Attitude and filter logging at main loop rate
1685
b) Batch sampler logging both pre and post-filter
1686
c) FFT frame averaging
1687
d) In-flight throttle notch parameter learning using averaged FFTs
1688
e) Triple harmonic notch
1689
5) RemoteId and SecureBoot enhancements
1690
a) Remote update of secure boot's public keys (also allows remote unlocking of bootloader)
1691
6) Safety enhancements
1692
a) Arming checks of FRAME_CLASS/TYPE made mandatory (even if ARMING_CHECK=0)
1693
b) crash_dump.bin file saved to SD Card on startup (includes details re cause of software failures)
1694
c) Dead-reckoning for 30sec on loss of GPS (requires wind estimation be enabled)
1695
d) Dead-reckoning Lua script (On loss of GPS flies towards home for specified number of seconds)
1696
e) Disabling Fence clears any active breaches (e.g. FENCE_TYPE = 0 will clear breaches)
1697
f) "GPS Glitch" message clarified to "GPS Glitch or Compass error"
1698
g) Pre-arm check that configured AHRS is being used (e.g. checks AHRS_EKF_TYPE not changed since boot)
1699
h) Pre-arm check that gimbals are healthy (currently only for Gremsy gimbals, others in future release)
1700
i) Pre-arm check that all motors are setup
1701
j) Pre-arm check that scripts are running
1702
k) Pre-arm check that terrain data loaded if RTL_ALT_TYPE set to Terrain
1703
l) Pre-arm messages are correctly prefixed with "PreArm:" (instead of "Arm:")
1704
m) RC auxiliary switch option for Arm / Emergency Stop
1705
n) RC failsafe made pre-arm check (previously only triggered at arming)
1706
o) RC failsafe option (see FS_OPTIONS) to continue in Guided obeyed even if GCS failsafe disabled
1707
p) TKOFF_RPM_MIN checks all motors spinning before takeoff
1708
q) Vibration compensation disabled in manual modes
1709
7) Scripting enhancements
1710
a) CAN2 port bindings to allow scripts to communicate on 2nd CAN bus
1711
b) ESC RPM bindings to allow scripts to report engine RPM
1712
c) Gimbal bingings to allow scripts to control gimbal
1713
d) Pre-arm check bindings (allows scripts to check if pre-arm checks have passed)
1714
e) Semicolon (:) and period (.) supported (e.g both Logger:write() and Logger.write will work)
1715
8) Sensor driver enhancements
1716
a) Benewake H30 radar support
1717
b) BMI270 IMU performance improvements
1718
c) IRC Tramp VTX suppor
1719
d) Logging pause-able with auxiliary switch. see RCx_OPTION = 165 (Pause Stream Logging)
1720
e) Proximity sensor support for up to 3 sensors
1721
f) Precision Landing consumes LANDING_TARGET MAVLink message's PositionX,Y,Z fields
1722
g) RichenPower generator maintenance-required messages can be suppressed using GEN_OPTIONS param
1723
h) TeraRanger Neo rangefinder support
1724
i) GPS support to provide ellipsoid altitude instead of AMSL (see GPS_DRV_OPTIONS)
1725
j) W25N01GV 1Gb flash support
1726
9) Bug fixes
1727
a) Accel calibration throws away queued commands from GCS (avoids commands being run long after they were sent)
1728
b) Airmode throttle mix at zero throttle fix
1729
c) Cygbot proximity sensor fix to support different orientations (see PRXx_ORIENT)
1730
d) Loiter fix to avoid potential wobble on 2nd takeoff (was not clearing non-zero attitude target from previous landing)
1731
e) Lutan EFI message flood reduced
1732
f) Missions download to GCS corruption avoided by checking serial buffer has space
1733
g) Payload place fix so vehicle flies to specified Lat,Lon (if provided). Previously it could get stuck
1734
h) Safety switch disabled if IOMCU is disabled (see BRD_IO_ENABLE=0)
1735
i) Script restart memory leak fixed
1736
j) Takeoff vertical velocity limits enforced correctly even if PILOT_TKOFF_ALT set to a significant height
1737
10) Developer items
1738
a) Custom controller support
1739
b) Fast loop task list available in real-time using @SYS/tasks.txt
1740
c) Parameter defaults sent to GCS with param FTP and recorded in onboard logs
1741
d) ROS+ArduPilot environment installation script
1742
e) Sim on Hardware allows simulator to run on autopilot (good for exhibitions)
1743
f) Timer info available in real-time using @SYS/timers.txt
1744
------------------------------------------------------------------
1745
Copter 4.2.4 16-Aug-2023
1746
1) Loiter fix to avoid potential wobble or flip on takeoff
1747
------------------------------------------------------------------
1748
Copter 4.2.3 30-Aug-2022
1749
Changes from 4.2.3-rc3
1750
1) OpenDroneId bug fix to consume open-drone-id-system-update message
1751
------------------------------------------------------------------
1752
Copter 4.2.3-rc3 20-Aug-2022
1753
Changes from 4.2.3-rc2
1754
1) OpenDroneId improvements including reporting if operator location is lost
1755
2) Firmware ID and CRC check (disabled by default)
1756
3) Bug Fixes
1757
a) Auto takeoff with terrain altitude frame fix (could cause climb away if rangefinder became out of range)
1758
b) Revert Notch filter ordering on loss of RPM source (see 4.2.3-rc1's 3g below) because fix is incomplete
1759
------------------------------------------------------------------
1760
Copter 4.2.3-rc2 13-Aug-2022
1761
Changes from 4.2.3-rc1
1762
1) BlueRobotics Navigator autopilot filesystem fix
1763
------------------------------------------------------------------
1764
Copter 4.2.3-rc1 12-Aug-2022
1765
Changes from 4.2.2
1766
1) OpenDroneId support (aka RemoteID)
1767
2) New autopilot support
1768
a) CubeOrange+
1769
b) Foxeer Reaper F745
1770
c) MFE PixSurveyA1
1771
d) Pixhawk6C and Pixhawk6X
1772
3) Bug Fixes and minor enhancements
1773
a) Battery monitor health check fixed to check all enabled monitors
1774
b) ICE Lutan EFI update serial flood fixed
1775
c) ICM42xxx IMU filter settings improved and allow for faster sample rates
1776
d) INA2xx batteries may init after startup
1777
e) KakuteH7 OSD parameter menu enabled
1778
f) Lua script support to set desired speed in Auto mode
1779
g) Notch filter ordering bug on loss of RPM source fixed
1780
h) Payload Place mission command obeys specified altitude type (was always terrain alt)
1781
i) PreArm check that MOT_PWM_MIN/MAX are non-zero
1782
j) PreArm check of Rangefinder pin conflict and servo outputs
1783
k) SCurve logs debug if internal error occurs
1784
l) WSL2 upload fixed (developer issue only)
1785
------------------------------------------------------------------
1786
Copter 4.2.2 18-Jul-2022 / 4.2.2-rc2 04-Jul-2022
1787
No changes from 4.2.2
1788
------------------------------------------------------------------
1789
Copter 4.2.2-rc1 21-Jun-2022
1790
Changes from 4.2.1
1791
1) MambaH743v4 and MambaF405 MK4 autopilot support
1792
2) Second full harmonic notches available (see INS_HNTC2_ parameters)
1793
3) UAVCAN memory usage reduced (see CAN_Dn_UC_POOL parameter to control DroneCAN pool size)
1794
4) VTOL QuikTune lua script added
1795
5) Watchdog (caused by hardfault) saves crash dump logs to SD card
1796
6) Bug fixes
1797
a) Circle mode stops below altitude fence
1798
b) CRSF protection against watchdog on bad frames
1799
c) CRSF reset in flight handled
1800
d) FFT init watchdog fix when ARMING_REQUIRE=0 (not actually possible on Copter)
1801
e) OSD flight modes menu includes newer flight modes
1802
f) Param download (via MAVFTP) fixed for params with overlapping names
1803
g) PWM rangefinder bug fix and added SCALING parameter support
1804
h) Replay bug fix when EK3_SRCs changed
1805
i) SERIALx_OPTION fix when "Don't forward mavlink to/from" selected (resolves MAVLink gimbal detection)
1806
j) TradHeli Autotune fix which could cause incorrect gains to be loaded
1807
k) VL53L1X rangefinder preserves addresses
1808
------------------------------------------------------------------
1809
Copter 4.2.1 07-Jun-2022 / 4.2.1-rc1 28-May-2022
1810
Changes from 4.2.0
1811
1) CAN ESCs bus bandwidth efficiency improvements (see CAN_Dx_UC_ESC_OF parameter)
1812
2) DShot timing improvements to support for ESC variants
1813
3) LOITER_TURNS command radius max increased from 255m to 2550m (but only 10m accuracy when over 255)
1814
4) Luftan EFI measures fuel consumption (see EFI_COEF1, EFI_COEF2)
1815
5) Bug fixes
1816
a) CAN ESCs work on boards with no safety switch (e.g. MatekH743)
1817
b) Inflight Compass calibration checks GSF yaw estimate is good
1818
c) LOITER_TURNS command's Turns field limited to 255 (previously would wrap to lower number)
1819
d) NeoPixel colour fix
1820
e) Precision Landing maintains yaw during retries
1821
------------------------------------------------------------------
1822
Copter 4.2.0 23-May-2022 / 4.2.0-rc4 14-May-2022
1823
Changes from 4.2.0-rc3
1824
1) FlyingMoon F407 and F427 autopilots supported
1825
2) Vibration failsafe disabled in manual modes
1826
3) Bug fixes
1827
a) Log file list with over 500 logs fixed
1828
b) Loiter mode ignores ATC_SLEW_YAW parameter
1829
c) RSSI when using IOMCU pin 103 fixed
1830
d) TradHeli internal error during takeoff fixed
1831
------------------------------------------------------------------
1832
Copter 4.2.0-rc3 07-May-2022
1833
Changes from 4.2.0-rc2
1834
1) Bug fixes
1835
a) Blended Z axis accel calculation fix when not using first IMU
1836
b) Custom compass orientation for DroneCAN compasses
1837
------------------------------------------------------------------
1838
Copter 4.2.0-rc2 29-Apr-2022
1839
Changes from 4.2.0-rc1
1840
1) Minor Enhancements
1841
a) Button, Relay and RPM GPIO pin conflict pre-arm check improved
1842
b) DShot uses narrower bitwidths for more accurate timing (allows BLHeli BlueJay to work)
1843
c) iFlight Chimera default parameters file added
1844
d) INS_NOTCH parameters renamed to INS_HNTC2
1845
e) Matek F765-Wing-bdshot firmware added
1846
f) Matek H743 supports ICM42688
1847
g) QiotekZealot H743 supports ICM4xxxx
1848
h) Scripting heap size increased to 100k on F7/H7
1849
i) SPRacingH7 improvements including external flash performance improvements
1850
2) Bug fixes
1851
a) BMI088 IMU FIFO overruns fixed
1852
b) DO_SET_SERVO with SERVOn_FUNCTION=0 fixed, added pre-arm check of servo functions configured on disabled channels
1853
c) Log file descriptor init fixed (issues only seen on Linux autopilots)
1854
d) Log list cope with gaps, performance improvement to reduce impact on EKF and some ESCs
1855
e) Proximity sensor fix when using MAVLink lidars in non-forward orientations
1856
f) RPM sensor fix to avoid "failed to attach pin" spam to GCS
1857
g) STM32 DMA fatal exceptions disabled (caused watch dogs reboots with zero information)
1858
h) SysID mode bug fix (was not restoring body-frame feedforward setting upon exit)
1859
i) Tradheli autotune fix when max frequency is exceeded
1860
------------------------------------------------------------------
1861
Copter 4.2.0-rc1 10-Apr-2022
1862
Changes from 4.2.0-beta3
1863
1) Minor Enhancements
1864
a) Log and monitor threads stack size increased
1865
b) SPro H7 Extreme QSPI support improved
1866
2) Bug fixes
1867
a) EKF3 accel bias fixed when an IMU is disabled
1868
b) MatekH743 buzzer fixed by reverting to 16 bit timer
1869
c) STM32 H7 flash storage bug fixed that caused re-init on overflow
1870
d) @SYS file logging fixed
1871
e) Timer bug fixed that could cause a watchdog on boards using flash storage
1872
f) UART driver incorrect lock class fixed
1873
------------------------------------------------------------------
1874
Copter 4.2.0-beta3 30-Mar-2022
1875
Changes from 4.2.0-beta2
1876
1) Minor Enhancements
1877
a) BATT_OPTIONS supports sending resting voltage (corrected for internal resistance) to the ground station
1878
b) KakuteH7-bdshot support
1879
c) MatekH743 uses a 32 bit timer to resolve occasional 68ms timing glitch
1880
d) RC input protocol text message sent to GCS (helps pilot awareness during RC handover)
1881
e) Autotune code changes to reduce flash size (no functional impact)
1882
2) Bug fixes
1883
a) Battery remaining percentage fixed when using Sum battery
1884
b) DShot reversal bug with IOMCU based boards (see SERVO_BLH_RVMASK)
1885
c) GPS blending fix that could have resulted in the wrong GPS being used for a short time
1886
d) Param conversion bug (impacted airspeed enable)
1887
e) RC handover between IOMCU RC input and a secondary RC input on a serial port fixed
1888
f) Terrain reference adjustment ensures alt-above-terrain is zero at takeoff (see TERRAIN_OFS_MAX)
1889
g) QioTek Zealot H743 SLCAN port and relays fixed
1890
------------------------------------------------------------------
1891
Copter 4.2.0-beta2 10-Mar-2022
1892
Changes from 4.2.0-beta1
1893
1) Auto and Guided mode changes
1894
a) Delay removed when waypoints are very close together
1895
b) Pause and continue support (GCS changes are still pending)
1896
c) Takeoff and landing use position controller with slower reposition speed (also affects RTL, Land modes)
1897
d) Waypoint navigation will make use of maximum waypoint radius to maximize speed through corners
1898
2) Follow mode supports FOLLOW_TARGET message (sent by QGC ground station)
1899
3) Bug fixes
1900
a) Arming checks ignore SERVOx_MIN, MAX if setup as GPIO pin
1901
b) BeastH7v2 BMI270 baro support
1902
c) DShot prescaler fix (ESCs were not initialising correctly)
1903
d) EKF3 variance constraint fix used to prevent "ill-conditioning"
1904
e) POWR log message MCU voltage fix (min and max voltage were swapped)
1905
f) SPRacingH7 firmware install fix
1906
------------------------------------------------------------------
1907
Copter 4.2.0-beta1 28-Feb-2022
1908
Changes from 4.1.5
1909
1) AHRS/EKF improvements
1910
a) EKF startup messages reduced
1911
b) GPS<->Opticalflow automatic switching improved (see ahrs-source-gps-optflow.lua script)
1912
c) LORD Microstrain CX5/GX5 external AHRS support
1913
d) ModalAI VOXL non-GPS system supported (set VISO_TYPE=3, uses ODOMETRY mavlink msg)
1914
2) Control and flight mode enhancements
1915
a) Acro max rate params renamed and improved (see ACRO_RP_RATE, ACRO_Y_RATE, PILOT_Y_RATE, PILOT_Y_EXPO)
1916
b) Airmode NOT enabled when arming with switch (see ACRO_OPTIONS and "ArmDisarm with AirMode" RCx_OPTION)
1917
c) Auto and Guided support pausing (uses DO_PAUSE_CONTINUE mavlink command)
1918
d) Auto supports up to 100 DO_JUMP commands on high memory boards
1919
e) Autotune reporting improved (less spam, prints final tune)
1920
f) FLIGHT_OPTIONS to release gripper on thrust loss
1921
g) ForceFlying auxiliary switch allows pilot to disable land-detector
1922
h) Guided mode acceleration target support
1923
i) Guided mode logging of targets improved (GUID msg split into GUIP, GUIA)
1924
j) Harmonic notch filter on more than four motors
1925
k) Land mode pilot controlled repositioning max speed reduced (also affects RTL and Auto)
1926
l) Precision landing improvements esp when using PLAND_EST_TYPE = 1/KalmanFilter
1927
m) RTL's safe altitude (RTL_ALT) increased 85km (was 325m)
1928
n) Simple mode heading reset via auxiliary switch
1929
o) Sport mode deprecated
1930
p) SURFTRAK_MODE allows disabling surface tracking in Loiter, AltHold, etc
1931
q) Turtle mode (allows righting a copter while on the ground)
1932
3) Custom build server support (see https://custom.ardupilot.org)
1933
4) Lua scripting improvements
1934
a) ahrs::get_location replaces get_position (get_position still works for now)
1935
b) Auto support for NAV_SCRIPT_TIME commands (Lua within Auto)
1936
c) Frame string support (allows scripting based frame to display custom description after startup)
1937
d) Parameter support (no need to always use SCR_USERx)
1938
e) Servo output control by channel number (previously was only possibly by specifying the SERVOn_FUNCTION value)
1939
f) Script logged to onboard log (can be disabled by setting SCR_DEBUG_OPTS)
1940
5) New autopilots supported
1941
a) AirLink
1942
b) BeastF7v2, BeastH7v2
1943
c) JHEMCU GSF405A
1944
d) KakuteH7, KakuteH7Mini
1945
e) MambaF405US-I2C
1946
f) MatekF405-TE
1947
g) ModalAI fc-v1
1948
h) PixC4-Jetson
1949
i) Pixhawk5X
1950
j) QioTekZealotH743
1951
k) RPI-Zero2W
1952
l) SPRacingH7 Extreme
1953
m) Swan-K1
1954
6) Safety improvements
1955
a) Dijkstra's avoidance performance improvements including converting to A*
1956
b) Motor PWM range always uses MOT_PWM_MIN/MAX (if these are not set, they are defaulted to RC3_MIN/MAX values)
1957
c) Parachute option to leave servo in open position (see CHUTE_OPTIONS parameter)
1958
d) Parachute released arming check added
1959
e) Pre-arm check of IMU heater temp
1960
f) Pre-arm check of rangefinder health
1961
g) Pre-arm check of throttle position skipped if PILOT_THR_BHV is "Feedback from mid stick"
1962
7) Sensor driver enhancements
1963
a) ADIS16470, ADIS16507 and BMI270 IMU support
1964
b) Airspeed sensor support (reporting only, not used for estimation or control)
1965
c) AK09918 compass support
1966
d) Battery monitor supports voltage offset (see BATTx_VLT_OFFSET)
1967
e) Benewake TFMiniPlus I2C address defaults correctly
1968
f) Buzzer can be connected to any GPIO on any board
1969
g) Compass calibration (in-flight) uses GSF for better accuracy
1970
h) CRSFv3 support, CSRF telemetry link reports link quality in RSSI
1971
i) Cybot D1 Lidar
1972
j) DroneCan (aka UAVCAN) battery monitors support scaling (see BATTx_CURR_MULT)
1973
k) DroneCan (aka UAVCAN) GPS-for-yaw support
1974
l) Electronic Fuel Injection support incl Lutan EFI
1975
m) FETtecOneWire resyncs if EMI causes lost bytes
1976
n) IMU heater params renamed to BRD_HEAT_xxx
1977
o) Landing gear enable parameter added (see LGR_ENABLE)
1978
p) Lightware SF40C ver 0.9 support removed (ver 1.0 and higher still supported)
1979
q) Maxbotix serial sonar driver support RNGFNDx_SCALING parameter to support for varieties of sensor
1980
r) MPPT solar charge controller support
1981
s) MTK GPS driver removed
1982
t) Optical flow in-flight calibration
1983
u) Ping200x support
1984
v) Proximity sensor min and max range (see PRX_MIN, PRX_MAX)
1985
w) QSPI external flash support
1986
x) uLanding (aka USD1) radar provides average of last few samples
1987
y) Unicore NMEA GPS support for yaw and 3D velocity
1988
8) TradHeli enhancements
1989
a) Attitude control default gains improved
1990
- ATC_RAT_RLL_FF, _I, _IMAX, _ILMI, _FLTT
1991
- ATC_RAT_PIT_FF, _I, _IMAX, _ILMI, _FLTT
1992
- ATC_RAT_YAW_IMAX, _FLTT
1993
b) AutoTune mode
1994
c) Collective setup (users will be forced to setup new collective parameters)
1995
d) Rotor Speed Controller Internal Governor improvements (users required to retune governor)
1996
e) Rotor Speed Controller Cooldown timer added for ICE and turbine engines
1997
f) _VFF params renamed to _FF
1998
9) Other System enhancements
1999
a) Board ID sent in AUTOPILOT_VERSION mavlink message
2000
b) Compass calibration stick gestures removed
2001
c) DO_SET_CAM_TRIG_DIST supports instantly triggering camera
2002
d) DJI FPV OSD multi screen and stats support
2003
e) GPIO pins configured by setting SERVOx_FUNCTION to -1 (also see SERVO_GPIO_MASK. BRD_PWM_COUNT removed)
2004
f) GPIO pin support on main outputs on boards with IOMCU
2005
g) GyroFlow logging (see LOG_BITMASK's "VideoStabilization" option)
2006
h) Firmware version logged in VER message
2007
i) SD card format via MAVLink
2008
j) Serial port option to disable changes to stream rate (see SERIALx_OPTIONS)
2009
k) VIBE logging units to m/s/s
2010
10) Bug fixes
2011
a) Auto and Guided mode takeoff alt fixed if taking off from below home or frame set to absolute (aka AMSL)
2012
b) Auto mode CONDITION_YAW command completion fix
2013
c) Auto mode infinite loop with nav commands that fail to start fixed
2014
d) AutoTune disables ATC_RAT_xxx_SMAX during twitch (SMAX may limit gains to reduce oscillation)
2015
e) BLHeli passthrough reliability improvements
2016
f) Compass learning (inflight) fixed to ignore unused compasses (e.g. those with COMPASS_USE = 0)
2017
g) EKF optical flow terrain alt reset fixed (large changes in rangefinder alt might never be fused)
2018
h) EKF resets due to bad IMU data occur at most once per second
2019
i) GPIO pin fix on CubeOrange, F4BY, mRoControlZeroF7, R9Pilot
2020
j) Guided mode yaw rate timeout fix (vehicle could keep yawing even if companion computer stopped sending target)
2021
k) MAVlink2 serial ports always send MAVLink2 messages (previously waited until other side sent MAVLink2)
2022
l) Motor Test, Turtle mode respect emergency stop switch
2023
m) Omnibusf4pro bi-directional dshot fix
2024
n) PosHold braking fix if SCHED_LOOP_RATE set to non-default value
2025
o) Precision landing in RTL activates even if pilot had earlier deactivated by repositioning in Land
2026
p) Real-Time-Clock (RTC) oldest possible date updated to Jan-2022
2027
q) Tricopter, Coax copter fin trim fix when using DShot/BLheli
2028
------------------------------------------------------------------
2029
Copter 4.1.6 16-Mar-2023
2030
Changes from 4.1.5
2031
1) Loiter fix to avoid potential wobble or flip on takeoff
2032
------------------------------------------------------------------
2033
Copter 4.1.5 19-Feb-2022 / 4.1.5-rc1 10-Feb-2022
2034
Changes from 4.1.4
2035
1) Bug fixes
2036
a) attitude control I-term always reset when landed (previously only reset after spool down)
2037
b) revert SBUS RC frame gap change from 4.1.4
2038
------------------------------------------------------------------
2039
Copter 4.1.4 08-Feb-2022 / 4.1.4-rc1 27-Jan-2022
2040
Changes from 4.1.3
2041
1) Benewake CAN Lidar support
2042
2) CAN GPS default lag dropped to 0.1 seconds (was 0.22 seconds)
2043
3) Bug fixes
2044
a) Compass custom orientation is never overwritten during calibration
2045
b) EKF logging gaps fixed (some messages were occasionally being skipped)
2046
c) Guided mode cornering improvements
2047
d) IMU logging fix for IREG message (records IMU register changes)
2048
e) LOITER_TO_ALT mission command's climb rate fixed (could climb or descend too quickly)
2049
f) Position controller init fix to avoid twitch on vehicles with high vibrations
2050
g) Position controller init fix to better handle high speed entry to flight mode
2051
h) Position controller prioritises reducing cross track error
2052
i) Position controller relax fix
2053
j) SBUS RC frame gap increased to better handle some new receivers
2054
k) SERVOx_FUNCTION protection to avoid memory overwrite if set too high
2055
l) SD card init triggering watchdog fixed
2056
m) Spline path max lateral acceleration reduced (vehicle stays on path better but may be slower)
2057
n) Takeoff bug fix if taking off below home or frame specified as MSL
2058
------------------------------------------------------------------
2059
Copter 4.1.3 31-Dec-2021 / 4.1.3-rc2 21-Dec-2021
2060
Changes from 4.1.3-rc1
2061
1) Suport for IIM-42652, ICM-40605 and ICM-20608-D IMUs
2062
2) Bug fixes
2063
a) Autotune twitches at no more than ATC_RATE_R/P/Y_MAX param value
2064
b) SmartAudio high CPU load fix (previously it could starve other threads of CPU)
2065
c) Debug pins disabled by default to prevent rare inflight reset due to electrostatic discharge
2066
d) EKF3 reset causing bad accel biases fixed
2067
e) RC protocol detection fix that forced PH4-mini users to powerup autopilot before transmitter
2068
------------------------------------------------------------------
2069
Copter 4.1.3-rc1 18-Dec-2021
2070
Changes from 4.1.2
2071
1) Enhancements:
2072
a) CUAV-X7 servo voltage detection support
2073
2) Bug fixes
2074
a) Main loop delay fix for boards with 16 bit timers (affects KakuteF4, MatekH743, MatekF405, MatekF765, SpeedybeeF4)
2075
b) MOT_MIX_MAX constrained between 0.1 and 4.0 (would previously reset to 0.5 if set too high or low)
2076
c) Polygon Fence upload fix when replacing fence with one that has fewer points
2077
d) TradHeli fix for missions which continue after a Land command
2078
------------------------------------------------------------------
2079
Copter 4.1.2 07-Dec-2021 / 4.1.2-rc1 22-Nov-2021
2080
Changes from 4.1.1
2081
1) CAN_Dn_UC_OPTION param added to help resolve DroneCAN DNA conflicts
2082
2) Durandal with alternative ICM-20602 IMU
2083
3) OBAL autopilot support (Open Board Architecture for Linux)
2084
4) FETtec One ESC protocol support
2085
5) Bug Fixes
2086
a) ADSB vertical velocity reporting fix
2087
b) APM/LOGS directory creation fixed on some boards
2088
c) AutoTune fix to disable SMAX limits that could interfere with tune
2089
d) EKF3 fix to switch to non-zero primary core when disarmed
2090
e) Notch filter update rate fix
2091
f) Surface tracking fix if rangefinder glitches
2092
g) TradHeli rename of H_COLL_HOVER to H_COL_HOVER
2093
------------------------------------------------------------------
2094
Copter 4.1.1 10-Nov-2021 / 4.1.1-rc1 16-Oct-2021
2095
Changes from 4.1.0
2096
1) EK3_PRIMARY allows selection of which EKF core/IMU to use on startup
2097
2) ESC telemetry sent during compassmot
2098
3) TradHeli landing detector improvement
2099
4) Bug Fixes
2100
a) Auto/Guided mode fix to EXTENDED_SYS_STATE message's "landed state" field after takeoff
2101
b) MAVFTP init fix (could cause slow parameter download)
2102
c) Scripting fix when logging strings
2103
d) Serial flow control fix (affected at least Lightware LW20 serial lidar)
2104
e) QiotekZealotF427 IMU (ICM42605) orientation fixed
2105
------------------------------------------------------------------
2106
Copter 4.1.0 08-Oct-2021 / 4.1.0-rc4 01-Oct-2021
2107
Changes from 4.1.0-rc3
2108
1) Position controller PSC/Z logging changed to PSCN/E/D and includes "desired"
2109
2) Bug Fixes
2110
a) Position Controller init fix (could cause unexpected movement after entering Guided)
2111
b) Serial8 parameter description fixed
2112
------------------------------------------------------------------
2113
Copter 4.1.0-rc3 27-Sep-2021
2114
Changes from 4.1.0-rc2
2115
1) Enhancements
2116
a) Guided mode supports yaw control during takeoff
2117
b) MatekH743 supports icm42605 IMU
2118
2) Bug Fixes
2119
a) CSRF fix to avoid intermittent loss of telemetry
2120
b) EKF3 fix to init of wind speed variance
2121
c) Guided mode fix to yaw change after takeoff completes
2122
d) Guided mode uses GUID_OPTIONS to ignore pilot yaw during takeoff
2123
e) Lightware SF45b jumpy readings fixed by using lower update rate
2124
------------------------------------------------------------------
2125
Copter 4.1.0-rc2 15-Sep-2021
2126
Changes from 4.1.0-rc1
2127
1) Enhancements
2128
a) Guided mode supports using SCurves and OA for position control
2129
2) Bug Fixes
2130
a) Serial port auto detection of flow control fix
2131
------------------------------------------------------------------
2132
Copter 4.1.0-rc1 10-Sep-2021
2133
Changes from 4.1.0-beta8
2134
1) Enhancements
2135
a) Log download speeds improved on F765 and F777 based boards (USB buffers increased)
2136
b) Serial port DMA contention heuristics improved (reduces chance of delays writing to serial devices)
2137
c) WPNAV_SPEED param changes take immediate effect in Auto
2138
2) Bug Fixes
2139
a) Airmode fix if throttle held at zero for long time
2140
b) Auto mode SCurve jerk time calculation fix (prevents jerk from being set too high)
2141
c) CRSF frame timeout increased to reduce RC failsafes
2142
d) Declination automatic lookup rounding fix (caused inaccurate declination in some parts of world)
2143
e) DShot (bi-directional) support on Pixhawk4, CUAVv5, CUAVv5-Nano
2144
f) IMU semaphore fix to avoid occasional corruption
2145
g) QioTek Zealot F427 GPIO pin fix
2146
h) Replay/DAL RMGH log message format fix
2147
i) Rangefinder initial buffer size and baudrate fix (affected Aintein US-D1 radar)
2148
j) Surface tracking fix to reduce lag and overshoot
2149
k) WPNAV_SPEED change with ch6 tuning knob feature gets divide-by-zero protection
2150
l) WPNAV_SPEED_DN handles negative values
2151
------------------------------------------------------------------
2152
Copter 4.1.0-beta8 28-Aug-2021
2153
Changes from 4.1.0-beta7
2154
1) Enhancements
2155
a) Flywoo F745 Goku Nano support
2156
b) MatekF765-Wing support
2157
c) Scripting support for getting circle mode radius and setting rate
2158
d) Scripting support for new Guided mode controls including acceleration control
2159
2) Bug Fixes
2160
a) ATC_RATE_Y_MAX applies to all modes including Loiter
2161
b) ChibiOS scheduling slip workaround to avoid occasional 60ms delays found on MatekH7
2162
c) EKF2 divide-by-zero protection when using optical flow (issue only found in simulator)
2163
d) External AHRS (e.g. VectorNav driver) init fix
2164
e) KakuteF4Mini SBUS fix
2165
f) Pixhawk4 blue and red LEDs swapped
2166
g) Position control fixes to limit initial desired accel (horizontal and vertical) which could lead to an excessive climb or descent
2167
h) TradHeli takeoff in Guided fix
2168
------------------------------------------------------------------
2169
Copter 4.1.0-beta7 14-Aug-2021
2170
Changes from 4.1.0-beta6
2171
1) Enhancements
2172
a) Attitude and altitude control changes to support higher lean angles
2173
b) Flywoo F745 supports external I2C compasses
2174
c) GPS-for-yaw arming check added
2175
d) GPS_DRV_OPTIONS allows forcing UBlox GPS to 115200 baud
2176
e) Guided mode accepts higher speed and accel targets (no longer limited by WPNAV_ parameters)
2177
f) Lua scripts can be placed in root of ROMFS (only relevant for developers)
2178
g) PSC_VELXY_FILT renamed to _FLTE, PSC_VELXY_D_FILT renamed to _FLTD
2179
2) Bug Fixes
2180
a) Beacon driver protected from requests for data for non-existant beacons
2181
b) CAN threading fix to resolve potential lockup when lua scripts use CAN
2182
c) EKF3 GSF can be invoked multiple times with source switching (no longer limited by EK3_GSF_RST_MAX)
2183
d) EKF3 IMU offset fix (vehicle's reported position was slightly incorrect if INS_POS_XYZ params set)
2184
e) Guided mode terrain following init fix (might fly at incorrect alt on second use)
2185
f) Guided mode yaw rate target timeout fix (vehicle could keep spinning even after targets stopped arriving)
2186
g) OSD overwrite and nullptr check fix
2187
h) Proximity Avoidance auxiliary switch also disables avoidance using upward facing lidar
2188
i) Proximity sensor pre-arm check disabled if avoidance using proximity sensors is disabled
2189
j) RCOut banner displayed at very end of startup procedure to avoid invalid output
2190
k) Tricopter tail servo alway uses regular PWM (fixes use with BLHeli motors)
2191
------------------------------------------------------------------
2192
Copter 4.1.0-beta6 23-Jul-2021
2193
Changes from 4.1.0-beta5
2194
1) Enhancements
2195
a) ACRO_Y_EXPO supports negative numbers (-0.5 to +1)
2196
b) GPS-for-yaw enhancements including using position and yaw from different GPSs
2197
c) Guided mode acceleration control
2198
d) Long distance travel supported (thousands of km) including double precision EKF and moving origin
2199
2) Bug Fixes
2200
a) Auto and Guided mode terrain following fixed (could impact terrain if terrain was very steep. see WPNAV_TER_MARGIN)
2201
b) BendyRuler avoidance fixed (was slow and jerky)
2202
c) BLHeli fix that could cause failure to boot
2203
d) Crosstrack reporting fixed
2204
e) CRSF message spamming and firmware string length fixed
2205
f) Display re-enabled on 1MB boards
2206
g) DShot always sends 0 when disarmed (protects against motors spin while disarmed due to misconfiguration)
2207
h) DShot fix that could cause main loop jitter
2208
i) DShot buzzer tone disabled during motor test to remove bad interation
2209
j) Guided mode accepts position targets at high rate
2210
k) Longitude wrap fix (allows autonomous flights as longitude wraps between -180 and 180 deg)
2211
l) Log created on forced arm
2212
m) MatekF405-bdshot NeoPixel LEDs re-enabled on PWM5
2213
n) Precision landing init fix (if pilot took control, subsequent landings might not trying to land on target)
2214
o) Serial port performance improvements using FIFO on H7 boards
2215
p) TradHeli ground check of yaw fixed (yaw servo was not moving when landed)
2216
q) Throw mode waits for throttle up to improve reliability
2217
------------------------------------------------------------------
2218
Copter 4.1.0-beta5 30-Jun-2021
2219
Changes from 4.1.0-beta4
2220
1) Enhancements
2221
a) Arming check of distance from EKF origin increased to 250km horizontally (was 50km), 50km vertically (was 500m)
2222
b) Position control accuracy improved at very long distances (aka "Loiter bucketing")
2223
c) Pre-arm check of FLTMODE_CH and RCx_OPTION conflict
2224
d) QioTekZealotH743 autopilot support
2225
e) Scripting support for set home and get EKF origin
2226
2) Bug fixes
2227
a) Autonomous mode (Auto, RTL, etc) stopping point calculation fixed (could cause alt drop entering RTL)
2228
b) Auto mode Internal Error fixed when origin and destination are very close
2229
c) Auto mode Terrain following less bouncy and RNGFND_FILT param added for configurable filtering
2230
d) EKF alt estimate more robust when using GPS-for-yaw
2231
e) EKF origin altitudes consistent across cores even if user takes off with no GPS lock
2232
f) Logging start does not affect EKF (EKF could become unhealthy due to timing delays)
2233
g) Loiter rocking while landing fixed
2234
h) Loiter speed fixed with low LOIT_ACC_MAX values
2235
i) Loiter aggressive deceleration fixed (occured if vehicle was previously switched out of Loiter during decleration)
2236
j) Longitude wrap fixed (allows flying across international date line)
2237
k) MOT_THST_EXPO limits fixed to allow values between -1 and +1 (was 0.25 to +1)
2238
l) Position jump fixed during GPS glitch and GPS/Non-GPS transitions
2239
m) Proximity sensor status (used for object avoidance) fixed when using only upward facing lidar
2240
n) Vibration failsafe fixed
2241
o) 6DOF copter fixed
2242
------------------------------------------------------------------
2243
Copter 4.1.0-beta4 14-Jun-2021
2244
Changes from 4.1.0-beta3
2245
1) Minor enhancements (or changes)
2246
a) CSRF telemetry improvements to power setting and pass param requests more quickly
2247
b) CUAV X7/Nora supports ICM42688P IMU
2248
c) Pix32v5 USB product string fixed and IMU heater enabled
2249
d) RunCam Hybrid supported (see RUNCAM_TYPE parameter)
2250
e) VisualOdom feature removed from 1MB boards
2251
2) Bug fixes
2252
a) BLHeli Auto only affects telemetry passthrough to ease setup
2253
b) Circular complex fence radius not truncated
2254
c) CubeOrange serial1/2 DMA fixed
2255
d) EKF ground effect compensation fixed
2256
e) ESC telemetry fixes including motor index on boards with I/O mcu
2257
f) I/O MCU reset fix if user had disabled safety switch (recovery from reset would leave motors not spinning)
2258
g) MSP temperature scaling fixed
2259
h) Pilot yaw rate input during arming ignored
2260
i) PreArm check of roll/pitch and yaw angle difference fixed
2261
j) Serial port info file (@SYS/uarts.txt) easier to understand
2262
k) Scheduler fix of premature run of tasks every 163 seconds
2263
l) Visual odometry yaw alignment fixed
2264
m) WPNAV_RADIUS never less than 5cm
2265
------------------------------------------------------------------
2266
Copter 4.1.0-beta3 24-May-2021
2267
Changes from 4.1.0-beta2
2268
1) Dshot bug fix for autopilots with I/O boards (CubeBlack, CubeOrange, etc)
2269
------------------------------------------------------------------
2270
Copter 4.1.0-beta2 19-May-2021
2271
Changes from 4.1.0-beta1
2272
1) Attitude control and Navigation
2273
a) Auto mode Spline command fix when using terrain altitudes
2274
b) Drift after takeoff fix if GPS position has moved
2275
c) Feed forward angular velocity calculation fix
2276
d) Guided mode option (GUID_OPTIONS) to configure how SET_ATTITUDE_TARGET's thrust field is interpreted
2277
e) Improved position control during loss of yaw control by using thrust vector with heading
2278
f) Standby mode disables hover learning
2279
2) BLHeli improvements and fixes
2280
a) Bi-directional ESC telemetry fixes
2281
b) Bi-directional dshot 1200 supported
2282
c) Control of digital with non-digital outputs fixed
2283
d) Support dshot commands for LED, buzzer and direction control
2284
e) Passthru reliability improved
2285
3) New autopilot boards
2286
a) PixC4-Pi and PixC4-Jetson
2287
4) Avoidance fixes
2288
a) OBSTACLE_DISTANCE_3D boundary cleared after 0.75 seconds, allows easier multi-camera support
2289
b) Simple avoidance logging re-enabled
2290
5) Other enhancements
2291
a) Auxiliary function logging shows how it was invoked (switch, button or scripting)
2292
b) External IST8308 compass supported on CubeBlack
2293
c) FLOW_TYPE parameter hides/displays other FLOW_ parameters
2294
d) FrSky telem reports failsafe, terrain alt health and fence status
2295
e) Harmonic notch support for CAN ESCs (KDECAN, PiccoloCAN, ToshibaCAN, UAVCAN)
2296
f) OSD gets fence icon
2297
g) RunCam OSD and camera control
2298
h) Septentrio GPSs support GPS_SBAS_MOD parameter
2299
6) Bug fixes
2300
a) Barometer averaging fixes for BMP380, BMP280, LPS2XH, SPL06 drivers
2301
b) EKF3 fix to reset yaw after GPS-for-yaw recovers
2302
c) KDECAN output range, motor order and pre-arm check messages fixed
2303
d) Logging memory leak when finding last log fixed
2304
e) Pixhawk4 mini safety switch fix
2305
f) SD card slowdown with early mounts fixed
2306
------------------------------------------------------------------
2307
Copter 4.1.0-beta1 14-Apr-2021
2308
Changes from 4.0.7
2309
1) EKF changes:
2310
a) EKF3 is default estimator (EKF2 is available as an option)
2311
b) External AHRS/IMU support (e.g. VectorNav)
2312
c) Gaussian Sum Filter (GSF) allows emergency yaw correction using GPS
2313
d) GPS-for-yaw (dual F9 UBlox, Septentrio, NMEA GPS can provide yaw)
2314
e) Lane switching logic improvements
2315
f) Sensor affinity (improves sensor failure redundancy)
2316
g) Source switching for GPS/Non-GPS transitions (see EK3_SRCx_ parameters)
2317
h) Yaw estimation and reliability improvements
2318
i) Wind speed estimation and barometer interference compensation
2319
2) Control and Navigation improvements:
2320
a) Acro "air mode" support (see ACRO_OPTIONS)
2321
b) Auto mode arming and takeoff (see AUTO_OPTIONS)
2322
c) Circle options to face direction of travel and/or init at circle center (see CIRCLE_OPTIONS)
2323
d) DO_LAND_START command support for landing sequences
2324
e) Horizontal Velocity controller gets feed forward and logging
2325
f) Position controller update to remove hard-coded Alt Hold velocity derivative and other enhancements
2326
g) Rate PID slew limiting to to detect and suppress oscillations
2327
h) SCurves for waypoint navigation
2328
i) Yaw imbalance check
2329
3) TradHeli improvements:
2330
a) Conventional and compound helicopter SITL dynamic models improved
2331
b) Intermeshing rotor and coaxial rotor support added to Dual heli frame
2332
4) 6DoF frame support
2333
5) Object avoidance:
2334
a) BendyRuler hesitancy improvements
2335
b) Intel Realsense 435/455 camera support (companion computer required)
2336
c) Obstacle database now 3D
2337
d) Obstacle filtering improvements
2338
e) Obstacles ignored in cylinder around home (see OA_DB_ALT_MIN)
2339
f) Obstacles ignored near ground (see PRX_IGN_GND)
2340
g) Vertical BendyRuler
2341
h) Simple avoidance backs away from obstacles (see AVOID_BACKUP_SPD parameter)
2342
i) Simple avoidance accel limited (see AVOID_ACCEL_MAX parameter)
2343
j) Simple avoidance enabled above min altitude (see AVOID_ALT_MIN)
2344
k) Simultaneous Dijkstra and BendyRuler path planning
2345
6) Compass enhancements
2346
a) Custom orientations
2347
b) In-flight learning improvements (see COMPASS_LEARN = 3)
2348
c) Large vehicle calibration support (e.g. point vehicle north and push button in MP)
2349
7) Intel RealSense T265 support (see VISO_TYPE = 2, companion computer required)
2350
a) Position and velocity from external sources accepted at up to 50hz
2351
b) Resets from external sources accepted
2352
8) New autopilot boards
2353
a) FlywooF745
2354
b) iFlight BeastF7 and BeastH7
2355
c) MambaF405v2
2356
d) QioTekZealotF427
2357
9) IMU improvements:
2358
a) temperature calibration
2359
b) faster gyro sampling on high performance autopilots (F7 and faster, see INS_GYRO_RATE)
2360
10) New drivers
2361
a) AllyStar NMEA GPS
2362
b) BMM150 as external compass
2363
c) CRSF and SRXL2 RC protocols
2364
d) Dshot (bi-directional) for RPM telemetry
2365
e) GY-US32-v2 lidar
2366
f) HC-SR04 lidar
2367
g) Intelligent Energy hydrogen fuel cell
2368
h) Lightware SF45b lidar
2369
i) MSP protocol support (and DJI DPV systems)
2370
j) RichenPower generator
2371
k) Rotoye smart battery
2372
l) RunCam Split 4 and RunCam hybrid support
2373
m) Smart Audio
2374
n) SMBus batteries up to 12 cells
2375
o) USD1 CAN radar
2376
11) Harmonic Notch Improvements
2377
a) Bi-directional dshot support
2378
b) Double notch support (see INS_HNTCH_OPTS = 1)
2379
c) In-flight FFT (see INS_HNTCH_MODE = 4, FFT_* params)
2380
d) In-flight learning of throttle notch using in-flight FFT
2381
e) Notch per motor support using ESC telemetry and notch-per-peak with FFT (INS_HNTCH_OPTS = 2)
2382
f) Notch slewing and increased update rate to avoid "shot" noise
2383
g) RPM status driven from harmonic notch input
2384
12) Scripting enhancements:
2385
a) Button, Proximity, RPM sensor support
2386
b) DO_ mission commands can be triggered from scripts
2387
c) I2C sensor driver support (i.e. allows writing sensor drivers in Lua)
2388
d) Logging (i.e. allows Lua scripts to write to onboard logs)
2389
e) Mission item read support
2390
f) Motor drivers support allowing custom frame types and 6DOF
2391
g) Pre-arm checks (i.e. allows writing custom pre-arm checks in Lua)
2392
h) ROMFS support (allows writing scripts to ROMFS instead of SD Card)
2393
i) Serial port support (allows reading/writing to serial port from Lua)
2394
j) ToshibaCAN ESC usage time read support
2395
13) Other enhancements:
2396
a) Baro parameters start with BARO_ (was GND_)
2397
b) Barometers get device id for easier identification
2398
c) ChibiOS upgrade to 20.3
2399
d) CRSF passthrough for Yaapu widget
2400
e) DShot rates increased (see SERVO_DSHOT_RATE)
2401
f) Filesystem/MAVFTP expansion including @SYS for performance monitoring
2402
g) GCS failsafe timeout configurable
2403
h) MAV_CMD_DO_REPOSITION support
2404
i) MAVFTP performance improvements
2405
j) Serial option to disable forwarding of mavlink to/from a port
2406
k) Serial ports may use shared DMA for better performance
2407
l) Spektrum VTX control
2408
m) Spektrum SRXL2 listen-only device support
2409
n) Vibration logged for all IMUs
2410
o) @SYS/tasks.txt, dma.txt, uart.txt for near real-time inspection of system performance
2411
14) Bug fixes:
2412
a) CAN GPS ordering fix (previously order could switch meaning GPS_POS_ params were used on the wrong GPS)
2413
------------------------------------------------------------------
2414
Copter 4.0.8 12-Oct-2021 (TradHeli only release)
2415
Changes from 4.0.7
2416
1) TradHeli landing detector fix
2417
2) Proximity sensor distance validity checked before pushing to object database
2418
------------------------------------------------------------------
2419
Copter 4.0.7 22-Feb-2021
2420
Changes from 4.0.7-rc1
2421
1) fixed build on Durandal board
2422
2) multiple fixes for mRo boards: ControlZero*, PixracerPro
2423
------------------------------------------------------------------
2424
Copter 4.0.7rc1 6-Feb-2021
2425
Changes from 4.0.6
2426
1) added automatic backup/restore of parameters in case of FRAM corruption for F7/H7 boards with 32k FRAM parameter storage
2427
2) fixed a bug in EKF2/EKF3 that could cause memory corruption if external naviagtion sources (such as vision based position and velocity data) is supplied before the EKF has initialised
2428
3) fixed a problem with low accuracy data from UAVCAN GPS modules when GPS blending is enabled
2429
4) fixed an arming check failure with u-blox M9 based GPS modules
2430
5) fixed a race condition in SmartRTL which could cause a LAND mode to be triggered
2431
------------------------------------------------------------------
2432
Copter 4.0.6 25-Jan-2021 / 4.0.6-rc2 16-Jan-2021
2433
Changes from 4.0.6-rc1
2434
1) Add support for keeping a backup of storage for last 100 boots
2435
2) Bug fixes:
2436
a) Fix support for BLHeli_S passthru
2437
------------------------------------------------------------------
2438
Copter 4.0.6-rc1 23-Dec-2020
2439
Changes from 4.0.5
2440
1) Bug fixes:
2441
a) Fix vertical flyaways when rangefinder stops providing data and the user has configured EK*_ALT_SOURCE=1
2442
b) Correct units on raw accel data
2443
c) Fport RSSI value fix
2444
d) Correct compilation when Advanced Failsafe compile time option is enabled
2445
e) Correct time wrap in RAW_IMU mavlink message
2446
f) PixracerPro - Fix analog volt pin assignments
2447
g) fix landing detector for tradheli in acro mode
2448
2) Small enhancements:
2449
a) Parameter documentation enhancements and corrections
2450
b) Improve harmonic notch filter parameter documentation
2451
c) Report prearm check status in the MAV_SYS_STATUS_PREARM_CHECK flag of the SYS_STATUS mavlink message
2452
d) Smooth I term reset over 0.5 seconds
2453
3) TradHeli enhancements:
2454
a) Differential Collective Pitch (DCP) trim support for Dual Heli
2455
b) Incorporate hover collective learning
2456
c) Option for pitch, roll and yaw I term to be based on takeoff/landing
2457
------------------------------------------------------------------
2458
Copter 4.0.5 27-Oct-2020 / 4.0.5-rc2 08-Oct-2020
2459
Changes from 4.0.5-rc1
2460
1) Bug fixes:
2461
a) Serial/UART DMA race condition that could cause watdog reset fixed (Critical fix)
2462
b) SBUS output when no RC input fixed (Critical fix)
2463
------------------------------------------------------------------
2464
Copter 4.0.5-rc1 02-Oct-2020
2465
Changes from 4.0.4
2466
1) Bug fixes:
2467
a) Acro expo calculation fix (fixes sluggish behaviour)
2468
b) F32Lightening board IMU fast sampling fix
2469
c) GPS minimum accuracy added to protect EKF from unrealistic values
2470
d) KakuteF7/mini DShot glitch fix
2471
e) RC input gets additional protection against out-of-range inputs (<RCx_MIN or >RCx_MAX)
2472
f) RC_OPTION = 4 fix on boards with IOMCU (Pixhawk, etc). This allows ignoring SBUS failsafes
2473
2) Small enhancements:
2474
a) Linux boards accept up to 16 RC inputs when using UDP
2475
b) Protect against two many interrupts from RPM sensor, etc
2476
c) RM3100 compass support for probing all four I2C addresses
2477
d) Durandal telem3 port enabled
2478
------------------------------------------------------------------
2479
Copter 4.0.4 16-Sep-2020
2480
Changes from 4.0.4-rc4
2481
1) Matek H743, 765-Wing and F405-Wing get DPS310 Baro support
2482
------------------------------------------------------------------
2483
Copter 4.0.4-rc4 28-Aug-2020
2484
Changes from 4.0.4-rc3
2485
1) Bug fixes:
2486
a) Compass startup reordering based on compass priorities fix
2487
b) TradHeli servo test fix
2488
c) Precision landing logging fix
2489
d) Mavlink commands ignored after reboot request
2490
------------------------------------------------------------------
2491
Copter 4.0.4-rc3 30-Jul-2020
2492
Changes from 4.0.4-rc2
2493
1) Bug Fixes and minor enhancements:
2494
a) Compass ids from missing compasses reset after compass cal
2495
b) LIS3MDL compass enabled on all boards
2496
c) Lightware I2C lidar fix when out-of-range
2497
d) Parameter erase fix for revo-mini and other boards that store to flash
2498
------------------------------------------------------------------
2499
Copter 4.0.4-rc2 16-Jun-2020
2500
Changes from 4.0.4-rc1
2501
1) Bug Fixes:
2502
a) Watchdog monitor memory increased (may have caused watchdog reset)
2503
b) Compass ordering fix when COMPASS_PRIOx_ID is 0
2504
c) Hex CubeOrange 2nd current sensor pin correction
2505
d) Hott telemetry fix
2506
e) Lightware I2C driver fix when out-of-range
2507
f) MatekF765-Wing voltage and scaling fixed
2508
g) MatekH743 baro on I2C2 bus
2509
h) Proximity (360 lidar) ignore zone fix
2510
2) Flight controller support:
2511
a) Bitcraze Crazyflie 2.1
2512
b) CUAV Nora V1.2
2513
c) Holybro Pix32v5
2514
d) mRo Pixracer Pro
2515
3) Minor enhancements:
2516
a) Benewake RangeFinder parameter descriptions clarified
2517
b) Pre-arm check of attitude ignores DCM if multiple EKF cores present
2518
------------------------------------------------------------------
2519
Copter 4.0.4-rc1 26-May-2020
2520
Changes from 4.0.3
2521
1) Bug Fixes:
2522
a) I/O CPU fix so safety remains off after inflight reboot (Critical fix)
2523
b) Acro mode yaw expo supports values under 0.5 (see ACRO_Y_EXPO param)
2524
c) Auto mode Loiter-Turn commands points towards center
2525
d) Change-Speed commands applied smoothly
2526
e) Compass scaling factor threshhold increased
2527
f) EKF compass variance reporting to GCS made consistent with onboard logs
2528
g) Gimbal control using RC input ignores RCx_TRIM param
2529
h) Holybro Durandal buzzer fix
2530
i) Parameter reset fix caused by Eeprom race condition
2531
j) Read-only parameter write failure msg only sent once to GCS
2532
k) Compass declination can be overriden with COMPASS_DEC param (and EKF stops using world magnetic tables)
2533
l) Terrain database (SRTM) file fix (will cause all terrain to be reloaded after upgrade)
2534
2) Bootloader update to reduce chance of param resets during firmware load
2535
3) Compass ordering and prioritisation improvements
2536
4) Flight controller support:
2537
a) CUAV-Nora
2538
b) CUAV-X7
2539
c) MatekSys H743
2540
e) mRo Nexus
2541
d) R9Pilot
2542
5) GPS moving baseline (aka Yaw from GPS) for UBlox F9 GPSs
2543
6) Graupner Hott telemetry support
2544
7) Landing detector filter improvement improves detection on hard surfaces
2545
8) Object Avoidances Fixes and improvements:
2546
a) BendyRuler runs more slowly to reduce CPU load and reduce timeouts
2547
b) Dijkstra's avoidance works with more fence points
2548
c) Proximity drivers (i.e. 360deg lidar) simplified to reduce CPU load
2549
9) ProfiLED LEDs support
2550
10) Smart Battery improvements:
2551
a) Cycle count added
2552
b) NeoDesign battery support
2553
c) SUI battery support
2554
11) Other enhancements:
2555
a) Betaflight X frame type support
2556
b) Landing gear auto deploy/retract configurable using LGR_OPTIONS param
2557
c) MOT_PWM_MIN/MAX pre-arm check (checks fail if only one has been set)
2558
d) Solo gimbal and camera control improvements
2559
e) USB IDs updated to new ArduPilot specific IDs
2560
------------------------------------------------------------------
2561
Copter 4.0.3 28-Feb-2020 / 4.0.3-rc1 20-Feb-2020
2562
Changes from 4.0.2
2563
1) Bug Fixes:
2564
a) "RCInput: decoding" message watchdog reset when using MAVLink signing (Critical Fix)
2565
b) HeliQuad yaw control fix
2566
c) Do-Set-Servo commands can affect sprayer, gripper outputs
2567
d) BLHeli passthrough fix for H7 boards (CubeOrange, Holybro Durandal)
2568
2) USB IDs updated for "composite" devices (fixes GCS<->autopilot connection issues for boards which present 2 USB ports)
2569
3) RCOut banner helps confirm correct setup for pwm, oneshot, dshot
2570
4) ZigZag mode supports arming, takeoff and landing
2571
------------------------------------------------------------------
2572
Copter 4.0.2 11-Feb-2020
2573
Changes from 4.0.2-rc4
2574
1) MAVFTP stack size increased to 3k (fixes reboot when using MAVFTP)
2575
------------------------------------------------------------------
2576
Copter 4.0.2 11-Feb-2020 / 4.0.2-rc4 05-Feb-2020
2577
Changes from 4.0.2-rc3
2578
1) Bug Fixes:
2579
a) Spektrum receivers decoding fix for Pixracer
2580
b) Current Alt frame always relative to home (RTL could return at wrong alt)
2581
c) Circle mode pitch control direction fixed
2582
d) EKF only uses world magnetic tables if COMPASS_SCALE is set
2583
e) Logging reliability improvements especially for FRAM logs
2584
f) RangeFinders using PWM interface use RNGFNDx_OFFSET param (attempt2)
2585
g) SpeedyBeeF5 probes all I2C ports for external baro
2586
2) Rangefinder fallback support (both must have same _ORIENT)
2587
------------------------------------------------------------------
2588
Copter 4.0.2-rc3 01-Feb-2020
2589
Changes from 4.0.2-rc2
2590
1) Bug Fixes:
2591
a) AutoTune fix to restore original gains when AutoTune completes
2592
------------------------------------------------------------------
2593
Copter 4.0.2-rc2 31-Jan-2020
2594
Changes from 4.0.1
2595
1) Bug Fixes:
2596
b) IO CPU timing fix which reduces ESC sync issues
2597
c) PX4Flow driver probes all I2C ports on Hex Cubes
2598
d) RangeFinders using PWM interface (like Garmin LidarLite) use RNGFNDx_OFFSET param
2599
e) RC override fix when RC_OVERRIDE_TIME=-1 (allows disabling timeout when using joystick)
2600
f) TradHeli attitude control parameter description fixes (does not affect flight)
2601
g) cygwin compiler fix (affects developers only)
2602
2) Minor enhancements:
2603
a) GCS failsafe warning lights and tones
2604
b) Circle mode pitch control direction swapped
2605
------------------------------------------------------------------
2606
Copter 4.0.1 25-Jan-2020 / 4.0.1-rc3 19-Jan-2020
2607
Changes from 4.0.1-rc2
2608
1) Bug Fixes:
2609
a) Semaphore fixes for Logging, Filesystem and UAVCAN Dyanmic Node Allocation
2610
b) RangeFinder parameter fix (4th rangefinder was using 1st rangefinder's params)
2611
c) TradHeli STB_COL_x parameter description fixed
2612
2) Minor Enhancements:
2613
a) Autorotate flight mode renamed to Heli_Autorotate
2614
b) Solo default parameters updated
2615
c) "Prepared log system" initialisation message removed
2616
------------------------------------------------------------------
2617
Copter 4.0.1-rc2 10-Jan-2020
2618
Changes from 4.0.1-rc1
2619
1) FrSky telemetry status text handling fix (Critical Fix)
2620
------------------------------------------------------------------
2621
Copter 4.0.1-rc1 10-Jan-2020
2622
Changes from 4.0.0
2623
1) Circle mode allows pilot control of radius and rotation speed
2624
2) CAN servo feedback logged
2625
3) Magnetic declination tables updated
2626
4) Serial0 protocol forced to MAVLink (avoids accidental disabling of USB port)
2627
5) Bug Fixes:
2628
a) TradHeli RSC RC passthrough fixed
2629
b) CubeOrange and Durandal I2C timing fixed (was running slow)
2630
c) Compass calibration auto orientation skips "pitch 7" which could cause cal to fail
2631
d) Durandal's fourth I2C port fixed
2632
e) Linux boards with CAN support fixed
2633
f) Neopixel added to SERVOx_FUNCTION param description
2634
g) NMEA Output fixed (was sending an extra CR)
2635
h) Optflow messages sent even if EKF has no height estimate
2636
i) SkyViper build fixed
2637
j) Spektrum/DSM 22ms RC input fixed
2638
k) "UC Node Down" message removed (was unnecessarily scary)
2639
------------------------------------------------------------------
2640
Copter 4.0.0 29-Dec-2019 / 4.0.0-rc6 28-Dec-2019
2641
Changes from 4.0.0-rc5
2642
1) Compiler updated to gcc 6.3.1 (2nd attempt)
2643
------------------------------------------------------------------
2644
Copter 4.0.0-rc5 23-Dec-2019
2645
Changes from 4.0.0-rc4
2646
1) RM3100 compass enabled on all boards
2647
2) GCS failsafe disabled by default (see FS_GCS_ENABLE parameter)
2648
3) Bug Fixes
2649
a) Bootloader fix for H7 boards (could brick CubeOrange, CUAV V5 Nano, etc)
2650
b) OmnibusF4pro GPS fix
2651
c) MatekF405-Wing missing serial ports restored
2652
d) MatekF765-Wing RTSCTS parameter defaults set correctly
2653
e) CUAV V5 Nano battery monitor param defaults improved
2654
------------------------------------------------------------------
2655
Copter 4.0.0-rc4 20-Dec-2019
2656
Changes from 4.0.0-rc3
2657
1) Compiler updated to gcc 6.3.1
2658
2) Solo default parameters updated
2659
3) Bug Fix to RCMAP channel number sanity check
2660
------------------------------------------------------------------
2661
Copter 4.0.0-rc3 16-Dec-2019
2662
Changes from 4.0.0-rc2
2663
1) Flight mode and control improvements:
2664
a) Auto mode Takeoff getting stuck fixed (very rare)
2665
b) AutoTune protection against ESC sync loss at beginning of a twitch
2666
c) SystemID mode parameters hidden by default (set SID_AXIS to non-zero to see all)
2667
d) Takeoff from slanted surfaces improved by reducing I-term build-up in attitude controllers
2668
2) Lua Script related enhancements:
2669
a) MAV FTP support to ease uploading and downloading Lua scripts
2670
b) NeoPixel/WS2812 LED control from Lua scripts
2671
c) Pre-arm check that Lua scripting feature has enough memory
2672
3) TradHeli enhancements:
2673
a) Autonomous autorotation (compile time option, not available in stable firmware)
2674
b) CCW Direct Drive Fixed Pitch tail support (see H_TAIL_TYPE parameter)
2675
c) Parameter description improvements
2676
d) STAB_COL_1/2/3 param range changed to 0 to 100 (was 0 to 1000)
2677
4) Lightware SF40c driver for latest sensors with "streaming" protocol
2678
5) Board/Frame specfic fixes:
2679
a) Hex CubeOrange IMU heater control gain tuning improvement
2680
b) Holybro Durandal IMUs ordering fix so EKx_IMU_MASK bits are intuitive
2681
c) Holybro Pixhawk4 B/E LED fix (was flickering)
2682
d) MatekF765 PWM outputs 5 and 6 now functional
2683
e) MatekF765, MatekF405 time wrap CRITICAL fix for vehicles flying more than 72min
2684
f) MatekF765 LED fixes
2685
g) mRobotics ControlZeroF7 I2C bus numbering fix
2686
h) Solo default params updated for 4.0.0
2687
i) Bootloaders for boards using STM32H7 CPUs
2688
j) Bootloader protection against line noise that could cause the board to get stuck during bootup
2689
k) LED timing fix for FMUv5 boards with LEDs on one of first four auxiliary PWM outputs
2690
6) Minor Enhancements and Bug Fixes
2691
a) I2C storm High level protection
2692
b) Internal errors (like I2C storms) reported to GCS by setting Heartbeat status to Critical
2693
c) Dataflash Logging CTUN.TAlt and SAlt scaling fixed
2694
d) DO_DIGICAM_CONTROL messages are sent using Mavlink1/2 as specified by SERIALx_PROTOCOL
2695
e) DO_SET_SPEED sanity check fixed to protect against negative speeds
2696
f) FrSky telemetry scheduling improvement (fixes issue in which GPS data would not be sent)
2697
g) GPS auto configuration fix for non-Ublox-F9 (F9 config was interfering with other Ublox GPSs)
2698
h) Landing gear DEPLOY message fix (could be displayed multiple times or when gear not configured)
2699
i) Pre-arm check of position estimate when arming in Loiter even if arming is "forced"
2700
j) Pre-arm check that Terrain database has enough memory
2701
k) RangeFinder parameter conversion fix (some parameters were not upgraded from 3.6.x to 4.0.0)
2702
l) RangeFinder TYPE parameter descriptions clarified for LidarLite and Benewake Lidars
2703
m) Serial parameters hidden if they do not exist on the particular board
2704
n) UAVCAN GPS fix for GPSs that don't provide "Aux" message (like the Here2)
2705
o) NMEA Output bug fix (output was stopping after 90 seconds)
2706
------------------------------------------------------------------
2707
Copter 4.0.0-rc2 04-Nov-2019
2708
Changes from 4.0.0-rc1
2709
1) Failsafe changes:
2710
a) GCS failsafe triggers when telemetry connection is lost (previously only triggered when using joystick)
2711
b) FS_OPTION parameter allows continue-in-auto and continue-in-pilot-modes for RC/Radio and GCS failsafe
2712
2) Dynamic Notch Filter supports filter range based on BLHeli ESC feedback
2713
3) Improved protection against high roll/pitch gains affecting altitude control
2714
4) Bug Fixes:
2715
a) Altitude control param conversion fix (PSC_ACCZ_FILT converted to PSC_ACCZ_FLTE)
2716
b) BLHeli fix to RPM calcs and telemetry (aka 0x8000 error)
2717
c) ChibiOS SPI timeout fix (non-critical)
2718
d) Fence upload is less strict about altitude types (fences don't have altitudes)
2719
e) Motor loss detection bug fix (would sometimes think the wrong motor had failed)
2720
f) Pre-arm message fix to reports AHRS/EKF issue (was blank)
2721
g) Sparky2 autopilot firmware available
2722
h) Startup message "AK09916: Unable to get bus semaphore" removed (was not an error)
2723
i) Yaw control fix for fast descent and after large attitude disturbances
2724
------------------------------------------------------------------
2725
Copter 4.0.0-rc1 25-Oct-2019
2726
Changes from 3.6.11
2727
1) Path Planning for Object Avoidance (aka Bendy Ruler and Dijkstra's) replaces "Dodge" avoidance
2728
2) Complex Fence support (aka stay-out zones)
2729
3) Lua scripting support on the flight controller
2730
4) New flight controllers:
2731
a) Hex Cube Orange
2732
b) Holybro Durandal
2733
5) Attitude Control changes:
2734
a) Attitude Control filters on target, Error and D-term (see ATC_RAT_x_FLTT/FLTE/FLTD)
2735
b) Harmonic notch filter
2736
6) Flight mode changes:
2737
a) ZigZag mode (designed for crop spraying)
2738
b) SystemId for "chirping" attitude controllers to determine vehicle response
2739
c) StandBy mode for vehicles with multiple flight controllers
2740
d) SmartRTL provides warnings when buffer is nearly full
2741
e) Follow mode offsets reset to zero when vehicle leaves follow mode
2742
f) Upward facing surface tracking using lidar
2743
g) Circle mode points more accurately towards center
2744
7) Traditional Heli:
2745
a) Removed the parameter H_LAND_COL_MIN and functionality now uses H_COL_MID. CAUTION: ensure H_COL_MID is set to collective blade pitch that produces zero thrust
2746
b) Incorporated a rotor speed governor in rotor speed control (RSC)
2747
c) Moved all RSC parameters to the RSC library
2748
d) Converted throttle curve parameters to percent
2749
e) Converted RSC_CRITICAL, RSC_IDLE, and RSC_SETPOINT to percent
2750
f) Created swashplate library that has presaved swashplate types for use with Heli_Single and Heli_Dual frames
2751
g) Motor interlock with passthrough settable through RC option feature
2752
h) Removed collective too high pre-arm check
2753
i) Added virtual flybar for Acro flight mode
2754
j) Fixed H_SV_MAN minimum and maximum settings for Heli_Dual
2755
8) Frames:
2756
a) BiCopter support
2757
b) OctoV mixing improvements
2758
9) RC input/output changes:
2759
a) Serial protocols supported on any serial port
2760
b) IBUS R/C input support
2761
c) DO_SET_SERVO and manual passthrough can operate on the same channel
2762
10) Battery improvements:
2763
a) Up to 10 batteries can be monitored
2764
b) "Sum" type consolidates monitoring across batteries
2765
c) Fuel flow battery (for use with gas tanks)
2766
11) Sensor/Accessory changes:
2767
a) Robotis servo support
2768
b) KDECAN ESCs
2769
c) ToshibaCAN ESCs
2770
d) BenewakeTF03 lidar
2771
e) SD Card reliability improvements (if card removed, logging restarts)
2772
f) Yaw from some GPS (including uBlox RTK GPS with moving baseline)
2773
g) WS2812 LEDs (aka NeoPixel LEDs)
2774
h) NTF_BUZZ_VOLUME allows controlling buzzer volume
2775
12) Landing Gear:
2776
a) Retracts automatically after Takeoff in Auto completes
2777
b) Deployed automatically using SRTM database or Lidar
2778
13) UAVCAN improvements:
2779
a) dynamic node allocation
2780
b) SLCAN pass-through
2781
c) support for UAVCAN rangefinders, buzzers, safety switch, safety LED
2782
14) Serial and Telemetry:
2783
a) MAVLink Message-Interval allows reducing telemetry bandwidth requirements
2784
b) SERIALn_OPTIONS for inversion, half-duplex and swap
2785
15) Safety Improvements:
2786
a) Vibration failsafe (switches to vibration resistant estimation and control)
2787
b) Independent WatchDog gets improved logging
2788
c) EKF failsafe triggers slightly more quickly
2789
------------------------------------------------------------------
2790
Copter 3.6.12 13-Dec-2019 / 3.6.12-rc1 06-Dec-2019
2791
Changes from 3.6.11
2792
1) More ChibiOS fixes for I2C storm
2793
2) COMPASS_SCALE param to allow manual correction of compass scaling
2794
------------------------------------------------------------------
2795
Copter 3.6.11 01-Oct-2019 / 3.6.11-rc1 16-Sep-2019
2796
Changes from 3.6.10
2797
1) EKF and IMU improvements:
2798
a) IMU3 enabled by default if present
2799
b) IMU3 fast sampling enabled by default on Cube autopilots
2800
c) EKF protection against large baro spikes causing attitude error
2801
d) EKF origin fixes (consistent across cores, set externally only when not using GPS)
2802
e) EKF logging of 3rd core
2803
2) Minor enhancements:
2804
a) Land mode supports heading requests (ie. ROI)
2805
b) Support Hexa-H frame
2806
c) MatekF405-STD binaries created
2807
d) Benewake TFminiPlus lidar support
2808
3) Bug Fixes
2809
a) Barometer health checks include sanity check of temperature
2810
b) Lightware serial driver handles invalid distances
2811
c) IO firmware fix involving delayed writes to serial ports (ChibiOS only)
2812
d) CAN Compass fis to for unintialised device IDs
2813
e) mRo x2.1-777 USB ID fix
2814
f) ChibiOS fix for I2C storm
2815
------------------------------------------------------------------
2816
Copter 3.6.10 29-Jul-2019 / 3.6.10-rc2 2-Jul-2019
2817
Changes from 3.6.10-rc1
2818
1) mRobotics ControlZeroF7 board support
2819
2) Motor Test fixed by removing delay that triggered CPU Watch Dog
2820
------------------------------------------------------------------
2821
Copter 3.6.10-rc1 08-Jul-2019
2822
Changes from 3.6.9
2823
1) EKF improvements:
2824
a) learns biases even for inactive IMUs
2825
b) EKF uses earth magnetic field model to reduce in-flight compass errors
2826
c) EKF switches to first healthy IMU when disarmed
2827
d) IMU fix for dropped samples during high CPU usage
2828
e) Optical flow fusion start fix when some gyros disabled
2829
2) Ublox F9 GPS support
2830
3) Integrated CPU Watch Dog for STM boards including logging of reset reason
2831
4) ChibiOS I/O firmware for ChibiOS builds to support Spektrum binding
2832
5) Auxiliary switch changes always logged
2833
6) CUAVv5 Nano LED fix
2834
7) Solo Gimbal fix when some gyros disabled
2835
------------------------------------------------------------------
2836
Copter 3.6.9 27-May-2019 / 3.6.9-rc1/rc2 30-Apr-2019
2837
Changes from 3.6.8
2838
1) CX-OF flow sensor enabled on all boards
2839
2) CUAVv5 Nano board support added
2840
3) RangeFinders supported on all I2C ports
2841
4) Compass maximum acceptable offsets increased
2842
5) Septentrio GPS driver loses logging of camera feedback which could cause lag
2843
6) Bug Fixes:
2844
a) Acro mode leveling fix for when ACRO_TRAINER was 1
2845
b) Tradheli collective position pre-arm check removed
2846
c) Fallback to microSD for storage fixed
2847
d) GPS blending memory access fix that could lead to unhealthy GPS
2848
e) fixed POWR flags for 2nd power module on fmuv3 boards
2849
7) bootloader binary update for many boards
2850
------------------------------------------------------------------
2851
Copter 3.6.8 26-Apr-2019 / 3.6.8-rc1 24-Apr-2019
2852
Changes from 3.6.7
2853
1) Safety fixes
2854
a) Prevent loss of active IMU from causing loss of attitude control
2855
b) Added startup check for Hex CubeBlack sensor failure
2856
c) don't reset INS_ENABLE_MASK based on found IMUs
2857
------------------------------------------------------------------
2858
Copter 3.6.7 06-Mar-2019 / 3.6.7-rc1 28-Feb-2019
2859
Changes from 3.6.6
2860
1) Bug fixes and minor enhancements
2861
a) Matek405-Wing compass fix (thread initialisation fix)
2862
b) Landing flips reduced by reducing I-term build-up
2863
c) Land mission command slows down less aggressively
2864
d) Lightware LW20 lidar more reliably switches to serial mode
2865
------------------------------------------------------------------
2866
Copter 3.6.6 15-Feb-2019 / Copter 3.6.6-rc2 09-Feb-2019
2867
Changes from 3.6.6-rc1
2868
1) Bug fixes
2869
a) EKF compass switching fix for vehicles with 3 compasses
2870
b) CAN fixed on Pixhawk4 and PH4-mini
2871
c) Mini-pix uart telem1 and telem2 reversed
2872
d) Divide-by-zero protection if _FILT_HZ params set to zero
2873
e) Guided_NoGPS skips GPS pre-arm check
2874
------------------------------------------------------------------
2875
Copter 3.6.6-rc1 02-Feb-2019
2876
Changes from 3.6.5
2877
1) AP_RSSI fixes and minor enhancements
2878
a) RSSI pwm input driver for ChibiOS
2879
b) add V5 Nano to RSSI_ANA_PIN parameter description
2880
2) Bug fixes and minor enhancements
2881
a) TradHeli roll trim ramp time fix
2882
b) First Spline waypoint no longer skipped
2883
c) RC override (from GCS Joystick) disable fix (command to disable overrides could be interpreted as real input)
2884
------------------------------------------------------------------
2885
Copter 3.6.5 24-Jan-2019 / 3.6.5-rc3 21-Jan-2019
2886
Changes from 3.6.5-rc2
2887
1) Bug fixes:
2888
a) Pixhawk4 SBUS input and Serial6 pin mapping conflict resolved
2889
------------------------------------------------------------------
2890
Copter 3.6.5-rc2 15-Jan-2019
2891
Changes from 3.6.5-rc1
2892
1) Bug fixes and minor enhancements
2893
a) RC DSM sync bug fix (channel 8 could temporarily become zero, ChibiOS only)
2894
b) Pixhawk board LED fix (ChibiOS only)
2895
------------------------------------------------------------------
2896
Copter 3.6.5-rc1 11-Jan-2019
2897
Changes from 3.6.4
2898
1) Bug fixes and minor enhancements
2899
a) SD Card reliability improvement (BRD_SD_SLOWDOWN param) and allow re-inserting card after boot
2900
b) Mode and Auxiliary switch range check to protect during FrSky SBUS failsafe recovery
2901
c) Follow mode reports target distance and heading to ground station
2902
d) Pixhawk4-mini safety switch and LED fix
2903
e) Bebop2 build fix
2904
2) RC protocol decoding for SRXL, SUMD and ST24 extended to all boards including pixracer and ChibiOS-only boards
2905
3) DrotekP3 Pro support
2906
4) Cube Purple support
2907
------------------------------------------------------------------
2908
Copter 3.6.4 27-Dec-2018 / 3.6.4-rc1 20-Dec-2018
2909
Changes from 3.6.3
2910
1) Bug fixes and minor enhancements
2911
a) Detect and clear stuck I2C bus when using ChibiOS
2912
b) Pixhawk4 fix for battery monitor voltage scaling
2913
c) TradHeli Dual (aka Chinook) fix for scaling of second swashplate movement
2914
d) Omnibus F7 IMU orientation fix
2915
e) Gimbal fix to avoid extreme movement if pilot's transmitter is off at startup
2916
f) Follow mode fix to obey FOLL_SYSID parameter (controls which vehicle to follow)
2917
2) Cheerson CX-OF optical flow sensor support
2918
------------------------------------------------------------------
2919
Copter 3.6.3 04-Dec-2018 / 3.6.3-rc1 01-Dec-2018
2920
Changes from 3.6.2
2921
1) Bug fixes and minor enhancements
2922
a) Pixhawk4 RC input fix
2923
b) TradHeli parameter default fixes for Loiter and PosHold
2924
c) Onboard OSD fix for MatekSys 405
2925
d) Solo power off button delay time increased
2926
------------------------------------------------------------------
2927
Copter 3.6.2 24-Nov-2018 / 3.6.2-rc4 22-Nov-2018
2928
Changes from 3.6.2-rc3
2929
1) Bug fixes and minor changes:
2930
a) Benewake TFmini short range scaling fix
2931
b) Fix alt drop after quick switch from RTL to stabilize to RTL
2932
c) Winch removed from build by default
2933
------------------------------------------------------------------
2934
Copter 3.6.2-rc3 19-Nov-2018
2935
Changes from 3.6.2-rc2
2936
1) Bug fixes:
2937
a) Benewake TFmini and TF02 driver reliability fix
2938
b) Spektrum RC parsing fix when more than 7 channels
2939
2) remove bootloader from px4-v2 builds (reduces firmware size)
2940
------------------------------------------------------------------
2941
Copter 3.6.2-rc1/rc2 15-Nov-2018
2942
Changes from 3.6.1
2943
1) Bug fixes:
2944
a) Benewake TFmini and TF02 driver checksum fix (was missing many sensor readings)
2945
b) Range finders report healthy to GCS when out-of-range
2946
c) RPM sensor reliability fix by initialising analog input pin
2947
------------------------------------------------------------------
2948
Copter 3.6.1 10-Nov-2018 / 3.6.1-rc1 06-Nov-2018
2949
Changes from 3.6.0
2950
1) Garmin LidarLite V3HP support
2951
2) VFR HUD messages send relative altitude if DEV_OPTIONS = 2. Useful for older OSDs and GCSs
2952
3) Bug fixes:
2953
a) Battery failsafe voltage parameter conversion fix
2954
b) Safety switch startup fix (was occasionally not initialised properly)
2955
c) Benewake TFmini and TF02 driver discards distances over 327m (avoids reporting 655m when can't read distance)
2956
d) Dataflash erase only availabled when disarmed (avoids crash if user attempted to erase logs while flying)
2957
4) ChibiOS fixes and enhancements:
2958
a) Pixracer LEDs colours fixed
2959
b) Terrain support fixed on Pixracer, MindPx-v2, Radiolink mini-pix
2960
c) RC input processing fix to avoid memory corruption in some rare cases
2961
d) FuriousFPV F-35 Lightning board support
2962
e) SpeedyBee F4 board support
2963
f) Bootloaders for OmnibusF4v6, mRoX2.1-777, Radiolink mini-pix
2964
g) Revo-mini support for external barometer
2965
h) Pins numbers made consistent across boards (setup of some features now more consistent across boards)
2966
i) enable safety switch on Pixhawk family f7 boards
2967
------------------------------------------------------------------
2968
Copter 3.6.0 26-Oct-2018
2969
Changes from 3.6.0-rc12
2970
1) Bug Fixes:
2971
a) Object avoidance fix when using 360 Lidar (mini fence was not including first distance)
2972
b) Flowhold mode descending fix
2973
2) ChibiOS related fixes:
2974
a) Kakutef7 support pin mapping fixes
2975
b) PixRacer LED fix
2976
c) I2C Lidar driver fix to avoid freeze at startup if sensor not connected
2977
------------------------------------------------------------------
2978
Copter 3.6.0-rc12 05-Oct-2018
2979
Changes from 3.6.0-rc11
2980
1) Bug Fixes:
2981
a) DSHot ESC driver race condition fix (could result in board freezing up)
2982
b) EKF fix to rounding off home altitude (could result in slightly inaccurate home altitude)
2983
c) Pixracer safety switch fix (BRD_SAFETYOPTION parameter was handled incorrectly)
2984
------------------------------------------------------------------
2985
Copter 3.6.0-rc11 01-Oct-2018
2986
Changes from 3.6.0-rc10
2987
1) Bug Fixes:
2988
a) PosHold fix to initialise desired accelerations
2989
b) Automatic compass orientation fix to account for equivalent rotations
2990
c) ChibiOS fix to RSSI voltage reading
2991
------------------------------------------------------------------
2992
Copter 3.6.0-rc10 15-Sep-2018
2993
Changes from 3.6.0-rc9
2994
1) Arming/disarming from transmitter can be disabled with ARMING_RUDDER parameter
2995
2) ChibiOS fixes:
2996
a) UART baud rate rounding fix (allow 921600 baud to work)
2997
b) ADC fix to allow more simultaneous channels
2998
3) Bug Fixes:
2999
a) Lean angle limit (to maintain altitude) always allows at least 10deg of lean
3000
b) Attitude Control and PID initialisation fix to reduce twitches when switching modes
3001
------------------------------------------------------------------
3002
Copter 3.6.0-rc9 08-Sep-2018
3003
Changes from 3.6.0-rc8
3004
1) Landing gear can be operated using AIRFRAME_CONFIGURATION mavlink messages
3005
2) Support playing tunes received via MAVLink (i.e. from GCS)
3006
3) Bug Fixes:
3007
a) Twitch reduced when entering Loiter at high speed
3008
b) Safety switch state fix when Pixhawk/Cube I/O board reset in flight
3009
c) External display fix to allow plugging into either I2C port
3010
------------------------------------------------------------------
3011
Copter 3.6.0-rc8 28-Aug-2018
3012
Changes from 3.6.0-rc7
3013
1) TeraRanger Tower EVO lidar support added
3014
2) PCA9685 and NCA5623 LED support added (replacements for Toshiba LED that is becoming end-of-life)
3015
3) Missions can start with DO_ commands (first NAV command must still be takeoff)
3016
4) ChibiOS fixes:
3017
a) DShot and BLHeli stability improvements
3018
b) added OmnibusNanoV6 bootloader
3019
5) Bug fixes:
3020
a) AP_Stat only saves values to eeprom if they change (reduces CPU impact)
3021
b) boost throttle respects safety switch
3022
c) TradHeli reduce chance of tip-over when landed in Loiter
3023
------------------------------------------------------------------
3024
Copter 3.6.0-rc7 01-Aug-2018
3025
Changes from 3.6.0-rc6
3026
1) Compass rotation detection during calibration (see COMPASS_AUTO_ROT param)
3027
2) Tone alarm system consistent on all boards and support for playing tones from GCS
3028
3) OnBoard OSD improvements including showing dir to home (ChibiOS only)
3029
4) External compass support and microSD improvements for many ChibiOS-only boards including Kakute F4, Mateksys F405-Wing, Airbot F4, Crazyflie2, MindPXv2, Mini-PIX, Omnibus F7
3030
5) Bug fixes:
3031
a) Battery monitor parameter fix to support BLHeli ESCs
3032
b) Ch12 auxiliary function fixed
3033
c) compassmot fix
3034
d) Pixracer external compass fix
3035
e) Pre-arm failure regarding RCx_TRIM removed for non critical channels
3036
f) SBUS failsafe fix when receiver configured to "hold"
3037
g) UART flow control fixes (ChibiOS only)
3038
h) VL53L0X lidar fix
3039
6) Minor enhancements:
3040
a) Compass device IDs (i.e. COMPASS_DEVID) set to zero if no compass detected
3041
b) Fence action "Always Land" option added
3042
c) Motor test maximum time extended to 10min
3043
d) Receiver RSSI pwm input on AUX5,6
3044
e) USB Serial port protocol default set to Mavlink2
3045
7) TradHeli fixes:
3046
a) "Channel already assigned" message fixed
3047
b) External gyro output method PWM based
3048
c) Swash servo output properly accounts for servo trim
3049
------------------------------------------------------------------
3050
Copter 3.6.0-rc6 16-Jul-2018
3051
Changes from 3.6.0-rc5
3052
1) ChibiOS small enhancement and fixes:
3053
a) KakuteF4 UART order fix
3054
b) mRobotics bootloader and autobuild of binaries for AUAV2.1 and Pixracer
3055
c) Mateksys F405-Wing uart reorder to better match labels on board
3056
2) Improve telemetry/GPS detection by only clearing UART when baud rate changes
3057
------------------------------------------------------------------
3058
Copter 3.6.0-rc5 07-Jul-2018
3059
Changes from 3.6.0-rc4
3060
1) Support new boards CubeBlack and HolyBro Pixhawk4-mini
3061
2) ChibiOS small enhancement and fixes:
3062
a) make board serial number match NuttX
3063
b) relay fix for Pixhawk boards by defaulting BRD_PWM_COUNT to 4 (same as NuttX)
3064
c) MatekF405-Wing default compass orientation fix
3065
d) Pixhawk4 default compass orientation fix
3066
e) Omnibus F4 Pro I2C fix
3067
3) Bug fixes:
3068
a) Telemetry baud rate fix
3069
b) RC failsafe fix to RTL in all modes except Auto when FS_THR_ENABLE is continue-with-mission
3070
c) waypoint navigation related safety check that PSC_POS_XY_P is non-zero
3071
d) aerofc-v1 update bootloader utility fix
3072
------------------------------------------------------------------
3073
Copter 3.6.0-rc4 05-Jul-2018
3074
Changes from 3.6.0-rc3
3075
1) add support for Cube Black and Cube Orange
3076
2) Built-in OSD improvements including home direction fix, altitude fix
3077
3) Bug fixes:
3078
a) ESC Telemetry current scaling fix
3079
b) LED pre-arm GPS colour fix if glitch occurs
3080
------------------------------------------------------------------
3081
Copter 3.6.0-rc3 02-Jul-2018
3082
Changes from 3.6.0-rc2
3083
1) ChibiOS:
3084
a) airbotf4, matekF405, matekF405-wing, omnibusf4pro, mini-pix, omnibusf7v2, revo-mini, sparky2 binaries built on firmware.ardupilot.org
3085
b) STM32F7 support including the CUAV v5 Autopilot and the PixHawk 4 (aka fmuv5)
3086
c) fixed dataflash logfile dates
3087
d) bootloader included in firmware for easier uploading
3088
e) additional UART added to fmuv4 and fmuv5 (STM32 F7 boards)
3089
f) ChibiOS version written to dataflash log files
3090
2) TradHeli
3091
a) fix collective jump on rotor shutdown in AltHold and Loiter
3092
b) fix interlock pre-arm check
3093
3) Follow uses relative altitudes (FOLL_ALT_TYPE param allows specifying relative or absolute alts)
3094
4) Auxiliary switch de-bounced to avoid false positives
3095
5) Bug fixes and minor enhancements:
3096
a) ESC calibration fix
3097
b) ESC_TELEMETRY messages sent to ground station
3098
------------------------------------------------------------------
3099
Copter 3.6.0-rc2 01-Jun-2018
3100
Changes from 3.6.0-rc1
3101
1) ChibiOS support for Holybro Kakute F4
3102
2) Range finders:
3103
a) Benewake TFmini and TF02 support
3104
b) WASP200 laser range finder support
3105
3) D-Shot and ESC telemetry support
3106
4) Vision-position-estimate support for use with ROS
3107
5) Bug fixes and minor enhancements:
3108
a) TradHeli swash plate servo trim fixes
3109
b) SmartRTL gives pilot yaw control
3110
c) marvelmind reliability improvements
3111
d) CoaxCopter and SingleCopter output fixes
3112
e) Maxbotics I2C sonar health fix
3113
6) Safety fixes/improvements:
3114
a) GPS/EKF failsafe disabled in Acro/Stabilize modes
3115
b) interlock switch arming check fixed
3116
c) Auxiliary switch de-bouncing
3117
d) pre-arm check for GPS/AHRS difference changed to 2D (to avoid false positives)
3118
e) startup crash fixed when VL53L0X lidar configured but not connected
3119
------------------------------------------------------------------
3120
Copter 3.6.0-rc1 19-Apr-2018
3121
Changes from 3.5.5
3122
1) ChibiOS support including F4BY, OpenPilot Revo Mini, TauLabs Sparky2 boards
3123
2) Flight mode changes:
3124
a) New Loiter with faster roll and pitch response, braking
3125
b) SmartRTL (returns home using outgoing path)
3126
c) Follow mode (allows following without relying on ground station commands)
3127
d) FlowHold (position hold with optical flow without lidar)
3128
3) Battery failsafe allows two stages of actions and monitoring of multiple batteries
3129
4) New sensors/drivers:
3130
a) Marvelmind for Non-GPS navigation
3131
b) RPLidarA2/A3 for object avoidance
3132
c) Winch for lowering packages without landing
3133
d) Septentrio GPS driver robustness improved
3134
5) New frames:
3135
a) dodeca-hexa copter (12 motors on 6 arms)
3136
b) Variable pitch quadcopter support (aka HeliQuad)
3137
c) multicopters with vertical boosting motor (see MOT_BOOST_SCALE parameter)
3138
6) Miscellaneous changes and enhancements:
3139
a) Auxiliary switch to enable/disable RC overrides from ground station joystick
3140
b) Barometer temperature calibration learning (see TCAL_ENABLED parameter)
3141
c) Camera triggering by distance only in Auto mode if CAM_AUTO_ONLY set to 1
3142
d) Compass noise rejection using COMPASS_FLTR_RNG parameter
3143
e) Compass interference compensation for up to 4 motors (see COMPASS_PMOT parameters)
3144
f) Command Line Interface (aka CLI) removed to reduce firmware size
3145
g) Flight mode channel can be changed using FLTMODE_CH parameter
3146
h) IMU notch filter to ignore specific frequencies (use INS_NOTCH_ENABLE parameter)
3147
i) LAND_ALT_LOW parameter allows setting altitude at which vehicle slows to LAND_SPEED in Land and RTL modes
3148
j) Mission cleared automatically on each reboot if MIS_OPTIONS parameter set to 1
3149
k) Object avoidance configurable to "stick" to barriers (previously would always slide past)
3150
l) PILOT_SPEED_UP, PILOT_SPEED_DN allow different max climb and descent rates in AltHold, Loiter, PosHold
3151
m) Safety switch configurable (i.e. only allow arming but not disarming via switch)
3152
n) Servo output rate configurable (see SERVO_RATE parameter)
3153
o) Vehicle rotation rate limits (see ATC_RATE_P/R/Y_MAX parameters)
3154
p) SI units in parameters, mavlink messages and dataflash logs
3155
7) TradHeli improvements:
3156
a) H3-135/140 swashplate support
3157
b) Reversed collective option for leading/trailing edge control
3158
c) AltHold angle limiter fix
3159
d) Five point spline-smoothed throttle curve
3160
8) parameter and log message name changes:
3161
a) ACCEL_Z_ renamed to PSC_ACCZ_
3162
b) ACC_ parameters renamed to PSC_ACC
3163
c) POS_ parameters renamed to PSC_POS
3164
d) VEL_ parameters renamed to PSC_VEL
3165
e) FS_BATT_ renamed to BATT_FS_
3166
f) BATT_AMP_PERVOLT renamed to BATT_AMP_PERVLT
3167
g) PILOT_VELZ_MAX to PILOT_SPEED_UP (and PILOT_SPEED_DN)
3168
h) RC_FEEL_RP replaced with ATC_INPUT_TC (functionality is same, scaling is different)
3169
i) WPNAV_LOIT_ params renamed to LOIT_
3170
j) NTUN dataflash message renamed to PSC
3171
------------------------------------------------------------------
3172
Copter 3.5.7 17-Jul-2018 / 3.5.7-rc1 12-Jul-2018
3173
Changes from 3.5.6
3174
1) Bug fix to ESC calibration safety switch issue
3175
------------------------------------------------------------------
3176
Copter 3.5.6 11-Jul-2018 / 3.5.6-rc1 07-Jul-2018
3177
Changes from 3.5.5
3178
1) Safety switch fix to refuse presses once armed (BRD_SAFETYOPTION controls behaviour)
3179
------------------------------------------------------------------
3180
Copter 3.5.5 31-Jan-2018 / 3.5.5-rc1 24-Jan-2018
3181
Changes from 3.5.4
3182
1) ICM20948 compass orientation fix
3183
2) LIS3MDL compass support on Pixracer
3184
3) support for easy embedding of defaults in firmware binary
3185
4) do-mount-control control command sets copter yaw when using 2-axis gimbal
3186
5) TradHeli fix for direct drive variable pitch tail rotors
3187
------------------------------------------------------------------
3188
Copter 3.5.4 23-Nov-2017 / 3.5.4-rc2 17-Nov-2017
3189
Changes from 3.5.3
3190
1) Compass improvements / bug fixes:
3191
a) probe for LIS3MDL on I2C address 0x1e
3192
b) bug fix pixracer compass detection
3193
------------------------------------------------------------------
3194
Copter 3.5.4-rc1 08-Nov-2017
3195
Changes from 3.5.3
3196
1) Compass improvements:
3197
a) support added for QMC5883L, LIS3MDL, IST8310
3198
b) COMPASS_TYPEMASK parameter allows enabling/disabling individual compass drivers
3199
2) LightWare and MaxBotix range finders supported on both I2C buses
3200
3) Serial port 5 can be used for telemetry or sensors (previously was only for NuttX console)
3201
4) px4pro flight controller supported
3202
5) TradHeli fixes:
3203
a) motor runup check applies to all flight modes (previously only loiter, poshold, althold)
3204
b) swashplate behaviour changes when on ground in acro, stabilize and althold
3205
c) servo test function fixed
3206
d) direct drive fixed pitch tail fix
3207
e) Z-axis Accel P gain default lowered to 0.3
3208
6) EKF origin set using SET_GPS_GLOBAL_ORIGIN mavlink message instead of SET_HOME_POSITION
3209
7) Intel Aero supports 921600 baud rate between main flight controller and companion computer
3210
8) Bug fix to I2C race condition on Pixhawk that could occasionally cause I2C device to not be detected
3211
------------------------------------------------------------------
3212
Copter 3.5.3 21-Sep-2017 / Copter 3.5.3-rc1 12-Sep-2017
3213
Changes from 3.5.2
3214
1) Guided mode support yaw and yaw-rate fields from set-position-target message
3215
2) Optical Flow startup retries 10 times
3216
3) Bug fixes:
3217
a) Septentrio RTK GPS driver robustness improvements for long messages
3218
b) dataflash not-logging checks if not initialised
3219
c) fix reporting of relative-position-NE-to-home (most users will not notice this difference)
3220
------------------------------------------------------------------
3221
Copter 3.5.2 14-Aug-2017 / Copter 3.5.2-rc1 05-Aug-2017
3222
Changes from 3.5.1
3223
1) GPS glitch arming check and notification (flashing blue-yellow LED, message on HUD)
3224
2) Arming check for minimum voltage (see ARMING_VOLT_MIN parameter)
3225
3) Landing Gear startup behaviour now configurable (see LGR_STARTUP parameter)
3226
4) Solo LED fix when using "boat" mode
3227
5) Intel Aero RTF gets one more I2C bus
3228
6) Bug fixes:
3229
a) resolve barometer floating point exception when ground pressure set to be negative
3230
b) resolve freeze if SERVOx_FUNCTION is set above 80
3231
------------------------------------------------------------------
3232
Copter 3.5.1 31-July-2017 / 3.5.1-rc1 24-July-2017
3233
Changes from 3.5.0
3234
1) fix to RC input corruption when using Spektrum DSMx with Pixracer
3235
------------------------------------------------------------------
3236
Copter 3.5.0 17-July-2017 / 3.5.0-rc11 12-July-2017
3237
Changes from 3.5-rc10
3238
1) GPS fixes:
3239
a) Re-enable auto detection of NMEA GPS (revert change from -rc9)
3240
b) Fix SBF race condition on start (this should resolve SBF GPS detection issues for some users)
3241
2) SF40c driver fix to ignore zero distances
3242
------------------------------------------------------------------
3243
Copter 3.5.0-rc10 08-July-2017
3244
Changes from 3.5-rc9
3245
1) Intel Aero build and default parameter updates
3246
2) EKF final yaw reset lowered from 5m to 2.5m to speed up bad compass detection after takeoff
3247
------------------------------------------------------------------
3248
Copter 3.5.0-rc9 03-July-2017
3249
Changes from 3.5-rc8
3250
1) AutoTune improvement when using position hold (twitches in body-frame instead of earth-frame)
3251
2) GPS fixes:
3252
a) RTK GPS fix when large RTK correction messages are sent
3253
b) auto-detection for NMEA disabled (NMEA users must explicitly set GPS_TYPE to 5)
3254
3) EKF bug fixes:
3255
a) fix bug preventing use of optical flow for terrain height estimation
3256
b) fix bug affecting accuracy of optical flow estimated height during climb/descent
3257
c) fix range beacon fusion bugs
3258
4) return accel filter (INS_ACCEL_FILT) to 20hz (some users were seeing oscillations at 10hz)
3259
------------------------------------------------------------------
3260
Copter 3.5.0-rc8 15-Jun-2017
3261
Changes from 3.5-rc7
3262
1) Solo on Master:
3263
a) add/fix tones and LED support
3264
b) resolve dataflash health reporting issue
3265
2) Allow flight controller to boot even if critical sensors fail (previously stopped at startup and displayed message people could rarely see)
3266
3) Minor enhancements:
3267
a) Landing Gear retracts/deploys only when pilot first moves switch (previously would always deploy on startup)
3268
b) BeagleBoneBlue supports external compass, OLED display
3269
4) Bug fixes:
3270
a) increase pilot stick dead zones for roll, pitch and yaw (still slightly more narrow than AC3.4)
3271
b) increase default roll, pitch and yaw rate IMAX values to 0.5, reduce default yaw rate filter to 2.5hz
3272
c) reduce accel filter from 20hz to 10hz (smoothes throttle in AltHold)
3273
d) fix EKF declination fusion
3274
e) object avoidance fix to ignore old distance measurements and out-of-range distances from range finder
3275
f) fix poxyz west-east processing (it was backwards)
3276
------------------------------------------------------------------
3277
Copter 3.5-rc7 25-May-2017
3278
Changes from 3.5-rc6
3279
1) Bug fixes and minor enhancements:
3280
a) fix OneShot ESC calibration and compass-mot calibration
3281
b) fix Navio2 and ErleBrain crashes caused by insufficient memory allocated to scheduler
3282
c) AutoTune with position hold only resets target position when roll and/or pitch sticks moved
3283
d) fix Acro, Sport trainer mode to stop attitude targets going beyond angle limits
3284
e) sanity check WPNAV_RADIUS is non-zero
3285
f) MarvelMind driver fixes (still a work-in-progress)
3286
g) Sanity check command when resuming mission in Auto
3287
------------------------------------------------------------------
3288
Copter 3.5-rc6 15-May-2017
3289
Changes from 3.5-rc5
3290
1) Bug fixes and minor enhancements:
3291
a) ESC calibration fix when not using safety switch (was waiting for safety switch to be pushed)
3292
b) Parameter loading improvements (responds sooner after startup, counts parameters in separate thread)
3293
c) Pilot radio passthrough fix for tradheli, single copter, coax copter
3294
------------------------------------------------------------------
3295
Copter 3.5-rc5 03-May-2017
3296
Changes from 3.5-rc4
3297
1) Intel Aero RTF support
3298
2) Smart battery fetches serial number, temperature and individual cell voltages
3299
3) Vehicle heads towards target point instead of next waypoint during straight line waypoint mission commands in AUTO
3300
4) Visual Odometry supported using VISION_POSITION_DELTA mavlink message
3301
5) Do-Set-Home sets EKF origin allowing user to specify vehicle starting position without GPS
3302
6) Object avoidance parameter (AVOID_MARGIN) allows configuring distance to maintain from objects
3303
7) Motor output can be duplicated to multiple channels
3304
8) IRLock can be connected to any I2C bus
3305
9) Piksi "Multi" GPS support
3306
10) Performance Improvements:
3307
a) inter-EKF scheduling cooperation (improves load balancing when using multiple EKFs)
3308
b) parameter requests from GCS processed asynchronously (resolves bad flight behaviour when fetching params in-flight)
3309
c) display performance improvements
3310
1) Bug fixes including:
3311
a) LSM303D (Pixhawk's backup IMU) timing fixes
3312
b) auxiliary PWM outputs update even when RC input stops
3313
c) dataflash log over mavlink fixes
3314
d) EKF recovery from severe errors
3315
e) reduce twitch when transitioning from spline to straight line waypoints in AUTO
3316
f) enable motors after initialisation completes (resolves some BLHeli ESC initialisation and calibration issues)
3317
------------------------------------------------------------------
3318
Copter 3.5-rc4 08-Apr-2017
3319
Changes from 3.5-rc3
3320
1) Bug fixes including:
3321
a) Baro based altitude estimate fixes including limiting ground temperature to reasonable value
3322
b) Fix 0.6ms lag reduction
3323
c) Fix Invensense IMU driver temperature reading
3324
d) Fix semaphore take during interrupts that may have caused very occasional main loop rate issues
3325
e) Return Home if GCS asks for first (i.e. zero-ith) mission command (required for Solo)
3326
------------------------------------------------------------------
3327
Copter 3.5-rc3 24-Mar-2017
3328
Changes from 3.5-rc2
3329
1) OLED Display fixes:
3330
a) can be connected to either I2C bus
3331
b) last character on line correctly cleared
3332
2) bug fix to detect SBUS failsafe on Pixracer
3333
3) bug fix to Gimbal servo reversing
3334
4) ensure WPNAV_LOIT_SPEED is non-zero to avoid divide-by-zero
3335
5) Fence pre-arm check failure messages clarified
3336
------------------------------------------------------------------
3337
Copter 3.5-rc2 13-Mar-2017
3338
Changes from 3.5-rc1
3339
1) Improved dual GPS support including blending (set GPS_TYPE2=1, GPS_AUTO_SWITCH=2)
3340
2) AutoTune with position hold (enter AutoTune from Loiter or PosHold modes to enable light position hold)
3341
3) New boards/drivers:
3342
a) PixhawkMini support
3343
b) AUAV2.1 board support (for AUAV2.1 set BRD_TYPE to 20 to distinguish from PixhawkMini)
3344
c) Garmin LidarLiteV3 support
3345
d) Maxell Smart Battery support
3346
e) Invensense ICM-20602 IMU and ST L3GD20H gyro drivers added
3347
4) IMU to Motor lag reduced by 0.6ms
3348
5) Object Avoidance:
3349
a) support TeraRanger Tower sensor
3350
b) support using normal (1-dimensional lidar/sonar)
3351
6) Minor changes/enhancements:
3352
a) add MOT_SPOOL_TIME parameter to allow users to control spool-up time of motors
3353
b) remove Solo gimbal from -v2 because of 1MB Flash limit on many Pixhawk1s
3354
c) altitude check for Guided mode takeoff (must be at least 1m)
3355
d) auxiliary switch to arm/disarm vehicle (set CH7_OPT to 41)
3356
e) change battery alarm tone to reduce impact on IMU
3357
f) add battery monitor health reporting
3358
g) support DO-FENCE-ENABLE mission command to enable/disable fence during missions
3359
7) Bug Fixes:
3360
a) OLED Display clears messages after 10seconds
3361
b) Servo Gimbal output range fix (could attempt to push servos beyond their limits)
3362
c) fix do-set-servo
3363
d) fix dataflash log time (was always appearing as 1970)
3364
------------------------------------------------------------------
3365
Copter 3.5-rc1 28-Jan-2017
3366
Changes from 3.4.4
3367
1) Multicopter firmware consolidated into single binary, users must set FRAME_CLASS parameter (1:Quad, 2:Hexa, 3:Octa, 4:OctaQuad, 5:Y6, 7:Tri)
3368
2) PixRacer specific items:
3369
a) board LEDs supported
3370
b) ESC calibration start problem resolved (was sometimes not detecting high throttle from pilot)
3371
3) Relaxed compass calibration and compass consistency checks
3372
4) Sensor and Optional Hardware Improvements:
3373
a) IMU sampling rate for MPU9250, ICM20608 IMUs to 8kHz for improved vibration resistance (Pixracer, Pixhawk2)
3374
b) Onboard Display (http://ardupilot.org/copter/docs/common-display-onboard.html)
3375
c) Here+ RTK GPS (UBlox M8P RTK) support
3376
d) LightWare I2C drivers usable on Copter (thanks to in-tree drivers below)
3377
e) MaxBotix sonar with serial interface now supported
3378
f) Bebop optical flow (but sonar not yet operational making this feature currently impossible to use)
3379
5) Precision Loiter using IRLock sensor (set CH7_OPT to 39)
3380
6) Delivery improvements:
3381
a) Servo gripper (http://ardupilot.org/copter/docs/common-gripper-servo.html)
3382
b) Package_Place mission command (drops package without vehicle landing)
3383
7) Pozyx support for Non-GPS flight (http://ardupilot.org/copter/docs/common-pozyx.html)
3384
8) EKF improvements:
3385
a) improved blending of optical flow and GPS
3386
b) EKF3 added in ride-along. Enable by setting EK3_ENABLE=1
3387
c) improvements when using range finder as primary height reference
3388
9) Object Avoidance improvements (http://ardupilot.org/dev/docs/code-overview-object-avoidance.html):
3389
a) uses mini-fence
3390
b) accepts MAVLink distance-sensor messages
3391
c) simple avoidance in AltHold mode
3392
10) Other improvements:
3393
a) pre-arm check that logging is working
3394
b) better reporting of battery failsafe to ground stations
3395
c) reduced minimum waypoint speed to 20cm/s
3396
d) Flight time recorder (http://ardupilot.org/copter/docs/common-flight-time-recorder.html)
3397
e) UBlox GPS baud rate fix (was occasionally selecting wrong rate)
3398
11) Technical improvements (users may not see a functional change):
3399
a) in-tree drivers lead to improved sharing of drivers with Linux boards
3400
b) copter arming checks consolidated with other vehicles
3401
------------------------------------------------------------------
3402
Copter 3.4.6 15-Mar-2017
3403
Changes from 3.4.5
3404
1) ensure WPNAV_LOIT_SPEED is non-zero to avoid divide-by-zero
3405
------------------------------------------------------------------
3406
Copter 3.4.5 11-Feb-2017
3407
Changes from 3.4.4
3408
1) Bug fix to Guided mode that could lead to crash after take-off completes if MOT_THST_HOVER too high
3409
------------------------------------------------------------------
3410
Copter 3.4.4 06-Jan-2017 / Copter 3.4.4-rc1 21-Dec-2016
3411
Changes from 3.4.3
3412
1) Bug Fixes / Minor Enhancements:
3413
a) prevent unwanted EKF core switching at startup
3414
b) helicopter prevented from taking off in position hold mode before rotors at full speed
3415
c) battery resistance calculations fixed
3416
d) avoid unnecessary parameter change notifications to ground station
3417
e) default power module definitions for Navio boards
3418
f) on-board compass calibration capability bit added (tells ground stations that onboard calibration is supported)
3419
------------------------------------------------------------------
3420
Copter 3.4.3 08-Dec-2016 / Copter 3.4.3-rc1 01-Dec-2016
3421
Changes from 3.4.2
3422
1) Bug Fixes:
3423
a) reduce unnecessary EKF core switching and fix position reset
3424
b) attitude control does not limit rate if ATC_ACCEL_MAX is zero
3425
c) ignore arm command from GCS if already armed
3426
d) set land-complete to false during auto takeoff
3427
e) onboard compass calibration memory init fix that could lead to failure to complete
3428
2) Minor Improvements:
3429
a) LeddarOne driver robustness improvements
3430
b) allow MOT_THR_MIX_MAX to be as high as 2.0
3431
c) uavcan bus settle time increased to 2sec
3432
d) helicopters do not hold position during auto takeoff until rotor is at full speed
3433
------------------------------------------------------------------
3434
Copter 3.4.2 16-Nov-2016 / Copter 3.4.2-rc1/rc2 07-Nov-2016
3435
Changes from 3.4.1
3436
1) Minor Improvements:
3437
a) ACRO_Y_EXPO applies to all flight modes (but is defaulted to zero)
3438
b) Autotune timeout increased (helps with large copters)
3439
c) AltHold filter applied to P (was previously only for D)
3440
d) arming check for compass health (was previously only a pre-arm check)
3441
2) Bug Fixes:
3442
a) compass calibration (onboard) fix to return completion status
3443
b) LeddarOne driver busy-wait fix
3444
c) SBF GPS altitude and accuracy reporting fix
3445
d) MAV GPS uses existing configured baud rate instead of auto detecting
3446
------------------------------------------------------------------
3447
Copter 3.4.1 01-Nov-2016
3448
Changes from 3.4.0
3449
1) Pixracer PPM RC input fix
3450
------------------------------------------------------------------
3451
Copter 3.4.0 31-Oct-2016
3452
Changes from 3.4.0-rc7
3453
1) Disabled LeddarOne driver (will be fixed in AC3.4.1 within a couple of weeks)
3454
------------------------------------------------------------------
3455
Copter 3.4.0-rc7 25-Oct-2016
3456
Changes from 3.4.0-rc6
3457
1) Bug fixes, minor improvements:
3458
a) more DSM binding fixes for pixracer
3459
b) allow non-motor channels to move before safety switch is pressed
3460
c) fix Bebop motor order
3461
d) fix MAVLink system id for first few messages
3462
e) fix throw mode throttle while rotating to level
3463
------------------------------------------------------------------
3464
Copter 3.4.0-rc6 15-Oct-2016
3465
Changes from 3.4.0-rc5
3466
1) Object Avoidance with SF40c 360 lidar
3467
2) ACRO_Y_EXPO parameter allows exponential yaw in ACRO mode (slow yaw at mid stick but fast response at full stick)
3468
3) ACRO_THR_MID parameter allows custom mid throttle for ACRO mode
3469
4) Precision Landing reliability and accuracy improvements using mini EKF and adding IRLock lens distortion correction
3470
5) Bug fixes, minor improvements:
3471
a) fix DSM binding on Pixracer
3472
b) resolved position jump caused by EKF core change (also added logging and reporting to GCS)
3473
c) EKF failsafe while in LAND triggers non-GPS LAND
3474
d) small throttle jump removed when switching between AltHold, Loiter
3475
6) Safety:
3476
a) EKF falls back to optical flow if GPS fails
3477
b) pre-arm check that GPS configuration has completed
3478
------------------------------------------------------------------
3479
Copter 3.4.0-rc5 14-Sep-2016
3480
Changes from 3.4.0-rc4
3481
1) Sprayer enabled by default
3482
2) Bug fixes, minor improvements:
3483
a) EKF fix for yaw angle reset fix when switching between cores (AC3.4 runs multiple EKFs simultaneously)
3484
b) EKF fixes when fusing range finder into height estimate
3485
c) pixracer clone board IMU hardware issue work around
3486
d) dataflash time-going-backwards fix
3487
e) fix rate PID conversion (AC3.3->AC3.4) for single, coax and tricopters
3488
------------------------------------------------------------------
3489
Copter 3.4.0-rc4 06-Sep-2016
3490
Changes from 3.4.0-rc3
3491
1) Intel Aero flight controller support (not Intel Aero RTF, that was done in a later release)
3492
2) Bug fixes, minor improvements:
3493
a) resolve unlikely endless-climb in AltHold, Loiter by ensuring Z-axis accelerometer IMAX can always overpower hover throttle
3494
b) fix auto build issue that could lead to parameter corruption
3495
c) fix EKF2 gyro estimation error when switching between IMUs
3496
d) sanity check MOT_THST_MIX_MIN, MAX parameters
3497
e) increase likelihood that parachute will release by reducing counter instead of resetting counter if vehicle becomes temporarily upright
3498
------------------------------------------------------------------
3499
Copter 3.4.0-rc3 31-Aug-2016
3500
Changes from 3.4.0-rc2
3501
1) Landing detector improvements:
3502
a) checks that descent rate is less than 1m/s (avoids disarms when vehicle is obviously still descending)
3503
b) tradheli fix for landing detector
3504
2) WP_NAVALT_MIN parameter limits maximum lean angle when vehicle is below the specified alt while taking off or landing. Only applies in LAND mode, final stage of RTL and during take-off in AUTO mode
3505
3) GND_EFFECT_COMP parameter allows turning on EKF compensation for ground effect during take-off and landing
3506
4) Advanced Failsafe for use in OutBack challenge (see http://ardupilot.org/plane/docs/advanced-failsafe-configuration.html)
3507
5) AutoTune minor improvement to reduce step size on vehicles with very low hover throttle (i.e. high power-to-weight ratio)
3508
6) Bug fixes, minor improvement:
3509
a) OneShot ESC calibration fix
3510
b) LAND_SPEED_HIGH allows specifying vertical descent speed separate from WPNAV_SPEED_DN during the initial descent in LAND mode (and final stage of RTL)
3511
c) improved USB driver reliability for windows users (NuttX change)
3512
d) report dataflash logging health to ground station
3513
e) Guided mode accepts yaw rate from SET_ATTITUDE_TARGET message
3514
------------------------------------------------------------------
3515
Copter 3.4.0-rc2 08-Aug-2016
3516
Changes from 3.4.0-rc1
3517
1) ADSB based avoidance of manned aircraft
3518
2) Polygon fence (works seamlessly with circular and altitude fences)
3519
3) Throttle related changes:
3520
a) motors speed feedback to pilot while landed - motors only spin up to minimum throttle as throttle stick is brought to mid (previously spun up to 25%)
3521
b) MOT_HOVER_LEARN allows MOT_THST_HOVER to be learned in flight
3522
c) THR_MIN becomes MOT_SPIN_MIN
3523
d) THR_MID becomes MOT_THST_HOVER
3524
4) Precision landing:
3525
a) control improved by reducing lag from sensor and correcting math errors
3526
b) descent rate slows to allow time to correct horizontal position error
3527
5) Guided mode:
3528
a) velocity controller accelerates/decelerates smoothly to target
3529
b) Guided_NoGPS flight mode added to allow companion computer control in non-GPS environments
3530
c) stop at fence if using velocity controller, reject points outside fence if using position controller
3531
6) Throw Mode:
3532
a) THROW_NEXTMODE parameter allows copter to switch to Auto, Guided, RTL, Land or Brake after throw is complete
3533
b) Throw mode fixes so motors reliably start
3534
7) Attitude controller:
3535
a) use Quaternions instead of Euler angles
3536
b) ATC_ANG_LIM_TC allows controlling rate at which lean angles are limited to preserve altitude in AltHold, Loiter
3537
8) EKF can use range finder as primary height source if EKF2_RNG_USE_HGT parameter is set to 70
3538
9) Bug fixes
3539
a) AutoTune fix so that gains don't fall too low
3540
b) Rally points with altitudes no longer cause vehicle to climb above fence during RTL
3541
c) various EKF fixes including bug in initialisation of declination co-variances
3542
d) SingleCopter, CoaxCopter flag gains
3543
10) Small enhancements:
3544
a) Rally points outside fence are ignored
3545
b) AP_Button support added to allow ground station to see if user has pushed a button on the flight controller
3546
c) support for PLAY_TUNE and LED_CONTROL mavlink messages to cause vehicle to play tune or change colour of LED
3547
d) support for GPS_INPUT mavlink message to allow supplying vehicle position data from other sources
3548
e) NAV_DELAY mission command to delay start of mission (or individual command) until a specified absolute time
3549
e) TKOFF_NAV_ALT param allows take-off with no horizontal position hold until vehicle reaches specified altitude (intended mostly for helicopters)
3550
f) SCHED_LOOP_RATE param allows slowing main loop rate from default of 400 (intended for developers only)
3551
11) Safety (in addition to Fence improvements above):
3552
a) Motors begin spinning 2 seconds after arming (previously motors spun immediately)
3553
------------------------------------------------------------------
3554
Copter 3.4.0-rc1 28-May-2016
3555
Changes from 3.3.3
3556
1) EKF2 allows "boat mode" (attitude initialisation without gyro calibration)
3557
2) Throw mode
3558
3) Terrain following:
3559
a) support terrain altitudes during missions using GCS's map data or rangefinder (i.e. Lidar)
3560
b) LightWare range finder driver fixes (I2C works)
3561
c) Bebop sonar support
3562
4) Precision Landing using IRLock sensor
3563
5) Attitude controller re-organisation (all parameter changes automatically moved and scales adjusted)
3564
a) RATE_ parameters become ATC_RAT_ (i.e. RATE_RLL_P becomes ATC_RAT_RLL_P)
3565
b) Rate Roll, Pitch, Yaw P, D are reduced by 10% for X, V, H frames, increased by 27% for all other frames
3566
c) STB_ parameters becomes ATC_ANG_ (i.e. STB_RLL_P becomes ATC_ANG_RLL_P)
3567
6) Motors library improvements:
3568
a) support OneShot ESCs (set MOT_PWM_TYPE to 0 for Normal, 1 for OneShot or 2 for OneShot125)
3569
b) TriCopter compensates for tail servo angle
3570
c) SingleCopter, CoaxCopter adjust control surfaces based on throttle output
3571
d) MOT_PWM_MIN, MAX allow specifying output ranges to ESCs which are difference from throttle input channel (i.e. RC3)
3572
e) TradHeli servo objects moved into heli class (HSV_ parameters become H_SV_)
3573
7) uAvionix Ping sensor support (ADS-B vehicles appear on GCS, avoidance will come in future release)
3574
8) Safety:
3575
a) warning if GPS update rate is slow (under 5hz, does not stop arming)
3576
------------------------------------------------------------------
3577
Copter 3.3.3 24-Feb-2016 / 3.3.3-rc2 27-Jan-2016
3578
Changes from 3.3.3-rc1
3579
1) bug fix to Guided mode's velocity controller to run at 400hz
3580
2) bug fix to MAVLink routing to allow camera messages to reach MAVLink enabled cameras and gimbals (including SToRM32)
3581
------------------------------------------------------------------
3582
Copter 3.3.3-rc1 4-Jan-2016
3583
Changes from 3.3.2
3584
1) Restrict mode changes in helicopter when rotor is not at speed
3585
2) add ATC_ANGLE_BOOST param to allow disabling angle boost for all flight modes
3586
3) add LightWare range finder support
3587
------------------------------------------------------------------
3588
Copter 3.3.2 01-Dec-2015 / 3.3.2-rc2 18-Nov-2015
3589
Changes from 3.3.2-rc1
3590
1) Bug fix for desired climb rate initialisation that could lead to drop when entering AltHold, Loiter, PosHold
3591
2) Fix to hard landings when WPNAV_SPEED_DN set high in RTL, Auto (resolved by using non-feedforward alt hold)
3592
3) Reduce Bad AHRS by filtering innovations
3593
4) Allow arming without GPS if using Optical Flow
3594
5) Smoother throttle output in Guided mode's velocity control (z-axis now 400hz)
3595
------------------------------------------------------------------
3596
Copter 3.3.2-rc1 4-Nov-2015
3597
Changes from 3.3.1
3598
1) Helicopter Improvements:
3599
a) Fix Arming race condition
3600
b) Fix servos to move after arming in Stabilize and Acro
3601
c) Implement Pirouette Compensation
3602
d) Add Rate I-Leak-Min functionality
3603
e) Add new Stab Collective and Acro Expo Col functions
3604
f) Add circular swashplate limits (Cyclic Ring)
3605
g) Add new H_SV_Man functions
3606
h) Add Hover Roll Trim function
3607
i) Add Engine Run Enable Aux Channel function
3608
j) Add servo boot test function
3609
h) Add Disarm Delay parameter
3610
------------------------------------------------------------------
3611
Copter 3.3.1 26-Oct-2015 / 3.3.1-rc1 20-Oct-2015
3612
Changes from 3.3
3613
1) Bug fix to prevent potential crash if Follow-Me is used after an aborted takeoff
3614
2) compiler upgraded to 4.9.3 (runs slightly faster than 4.7.2 which was used previously)
3615
------------------------------------------------------------------
3616
Copter 3.3 29-Sep-2015 / 3.3-rc12 22-Sep-2015
3617
Changes from 3.3-rc11
3618
1) EKF recovers from pre-arm "Compass variance" failure if compasses are consistent
3619
------------------------------------------------------------------
3620
Copter 3.3-rc11 10-Sep-2015
3621
Changes from 3.3-rc10
3622
1) PreArm "Need 3D Fix" message replaced with detailed reason from EKF
3623
------------------------------------------------------------------
3624
Copter 3.3-rc10 28-Aug-2015
3625
Changes from 3.3-rc9
3626
1) EKF improvements:
3627
a) simpler optical flow takeoff check
3628
2) Bug Fixes/Minor enhancements:
3629
a) fix INS3_USE parameter eeprom location
3630
b) fix SToRM32 serial protocol driver to work with recent versions
3631
c) increase motor pwm->thrust conversion (aka MOT_THST_EXPO) to 0.65 (was 0.50)
3632
d) Firmware version sent to GCS in AUTOPILOT_VERSION message
3633
3) Safety:
3634
a) pre-arm check of compass variance if arming in Loiter, PosHold, Guided
3635
b) always check GPS before arming in Loiter (previously could be disabled if ARMING_CHECK=0)
3636
c) sanity check locations received from GCS for follow-me, do-set-home, do-set-ROI
3637
d) fix optical flow failsafe (was not always triggering LAND when optical flow failed)
3638
e) failsafe RTL vs LAND decision based on hardcoded 5m from home check (previously used WPNAV_RADIUS parameter)
3639
------------------------------------------------------------------
3640
Copter 3.3-rc9 19-Aug-2015
3641
Changes from 3.3-rc8
3642
1) EKF improvements:
3643
a) IMU weighting based on vibration levels (previously used accel clipping)
3644
b) fix blended acceleration (used for altitude control) in cases where first IMU fails
3645
c) ensure unhealthy barometer values are never consumed
3646
2) TradHeli: remove acceleration feed forward
3647
3) Safety:
3648
a) check accel, gyro and baro are healthy when arming (previously was only checked pre-arm)
3649
b) Guided mode velocity controller timeout (vehicle stops) after 3 seconds with no update from GCS
3650
4) Minor enhancements:
3651
a) fix for AUAV board's usb-connected detection
3652
b) add Lidar-Lite-V2 support
3653
c) MOT_THR_MIN_MAX param added to control prioritisation of throttle vs attitude during dynamic flight
3654
d) RALLY_INCL_HOME param allows always including home when using rally points
3655
e) DO_FLIGHT_TERMINATION message from GCS acts as kill switch
3656
5) Bug Fixes:
3657
a) fix to ensure motors start slowly on 2nd spin-up
3658
b) fix RTL_CLIMB_MIN feature (vehicle climbed too high above home)
3659
------------------------------------------------------------------
3660
Copter 3.3-rc8 25-Jul-2015
3661
Changes from 3.3-rc7
3662
1) EKF improvements:
3663
a) de-weight accelerometers that are clipping to improve resistance to high vibration
3664
b) fix EKF to use primary compass instead of first compass (normally the same)
3665
2) UBlox "HDOP" corrected to actually be hdop (was pdop) which leads to 40% lower value reported
3666
3) TradHeli:
3667
a) Motors library split into "Multicopter" and "TradHeli" so TradHeli does not see multicopter parameters
3668
b) Heading target reset during landing to reduce vehicle fighting to rotate while on the ground
3669
4) Minor enhancements:
3670
a) SToRM32 gimbal can be connected to any serial port
3671
b) log when baro, compass become unhealthy
3672
c) ESC_CALIBRATION parameter can be set to "9" to disable esc calibration startup check
3673
d) Circle rate adjustment with ch6 takes effect immediately
3674
e) log home and origin
3675
f) pre-arm check of battery voltage and fence
3676
g) RTL_CLIMB_MIN parameter forces vehicle to climb at least this many cm when RTL is engaged (default is zero)
3677
5) Bug fixes:
3678
a) fix THR_MIN being incorrectly scaled as pwm value during low-throttle check
3679
b) fence distance calculated from home (was incorrectly calculated from ekf-origin)
3680
c) When flying with joystick and joystick is disconnected, control returns immediately to regular TX
3681
d) dataflash's ATT yaw fixed to report heading as 0 ~ 360
3682
e) fix to mission's first command being run multiple times during mission if it was a do-command
3683
f) ekf-check is enabled only after ekf-origin is set (stops red-yellow flashing led when flying without GPS lock)
3684
g) fix initialisation of mount's mode
3685
h) start-up logging so parameters only logged once, mission always written
3686
6) Linux:
3687
a) bebop support
3688
------------------------------------------------------------------
3689
Copter 3.3-rc7 28-Jun-2015
3690
Changes from 3.3-rc6
3691
1) reduce EKF gyro bias uncertainty that caused attitude estimate errors
3692
2) force 400hz IMU logging on (temporary for release candidate testing)
3693
------------------------------------------------------------------
3694
Copter 3.3-rc6 25-Jun-2015
3695
Changes from 3.3-rc5
3696
1) EKF related changes:
3697
a) reset altitude even when arming without GPS lock
3698
b) fix yaw twitch caused by EKF heading estimate reset
3699
c) fix IMU time scaling bug that caused height estimate to deviate from the baro
3700
2) AutoTune improvements:
3701
a) improved yaw tuning by increasing yaw step magnitude
3702
b) added logging of accelerations
3703
c) improvements to step tests
3704
3) Improved crash check:
3705
a) allow triggering even if pilot doesn't move throttle to zero
3706
b) easier triggering by removing baro check and using angle error instead of absolute tilt angle
3707
4) TradHeli:
3708
a) swash moves while landed in AltHold mode
3709
b) improvements to land detector
3710
c) fixed RSC Runup Time calculation
3711
d) Rate FF Low-pass Filter changed from 5Hz to 10Hz, more responsive
3712
5) support Linux builds for NAVIO+ and Erle-Brain (http://firmware.diydrones.com/Copter/beta/)
3713
6) Other improvements / Bug Fixes:
3714
a) sonar pre-arm checks only enforced if using optical flow
3715
b) fix EKF failsafe bug that would not allow recovery
3716
c) full rate IMU logging for improved vibration analysis (set LOG_BITMASK to All+FullIMU)
3717
d) new VIBE dataflash message records vibration levels
3718
e) default MNT_TYPE to "1" if servo gimbal rc outputs were defined
3719
f) RC_FEEL defaults to medium
3720
g) addition of SToRM32 serial support (supports mount angle feedback to GCS)
3721
h) new tricopter's tail servo parameters (MOT_YAW_SV_MIN, MAX, TRIM, REV)
3722
------------------------------------------------------------------
3723
Copter 3.3-rc5 23-May-2015
3724
Changes from 3.3-rc4
3725
1) Fix AHRS bad gyro health message caused by timing jitter and log IMU health
3726
2) TradHeli:
3727
a) better default rate PIDs
3728
b) Collective pitch output now operates even when disarmed
3729
3) Small changes/fixes:
3730
a) GCS can use MAV_CMD_MISSION_START to start mission in AUTO even without pilot raising throttle
3731
b) GCS can force disarming even in flight by setting param2 to "21196"
3732
c) rc-override timeout reduced from 2 seconds to 1 (applies when using GCS joysticks to control vehicle)
3733
d) do-set-speed fix so it takes effect immediately during missions
3734
e) GCS failsafe disarms vehicle if already landed (previously it could RTL)
3735
------------------------------------------------------------------
3736
Copter 3.3-rc4 17-May-2015
3737
Changes from 3.3-rc3
3738
1) AutoTune:
3739
a) save roll, pitch, yaw rate acceleration limits along with gains
3740
b) more conservative gains
3741
2) Roll, pitch rate control feed-forward now on by default (set ATC_RATE_FF_ENAB to "0" to disable)
3742
3) Serial ports increased to maximum of 4 (set SERIALX_PROTOCOL to 1)
3743
4) MOT_THR_MIX_MIN param to control minimum throttle vs attitude during landing (higher = more attitude control but bumpier landing)
3744
5) EKF fixes/improvements
3745
a) prevent yaw errors during fast spins
3746
b) bug fix preventing external selection of optical flow mode
3747
6) Parachute:
3748
a) servo/relay held open for 2sec when deploying (was 1sec)
3749
b) fix altitude check to be alt-above-home (was alt-above ekf origin which could be slightly different)
3750
7) TradHeli:
3751
a) parameters moved to stop possibility of corruption if board is switched between tradheli and multicopter firmware. Heli users may need to re-setup some heli-specific params.
3752
b) H_COLYAW param can be float
3753
8) Small Improvements / Bug Fixes:
3754
a) reduced spline overshoot after very long track followed by very short track
3755
b) log entire mission to dataflash whenever it's uploaded
3756
c) altitude reported if vehicle takes off before GPS lock
3757
d) high speed logging of IMU
3758
e) STOP flight mode renamed to BRAKE and aux switch option added
3759
------------------------------------------------------------------
3760
Copter 3.3-rc2/rc3 02-May-2015
3761
Changes from 3.3-rc1
3762
1) AutoTune reliability fixes (improved filtering to reduce noise interference)
3763
2) Optical flow improvements:
3764
a) Range Finder pre-arm check - lift vehicle between 50cm ~ 2m before arming. Can be disabled by setting ARMING_CHECK to "Skip Params/Sonar"
3765
b) Vehicle altitude limited to range finder altitude when optical flow is enabled
3766
3) AltHold & Take-off changes:
3767
a) feed-forward controller and jerk limiting should result in slightly snappier performance and smoother take-offs
3768
b) vehicle climbs automatically to PILOT_TKOFF_ALT alt when taking off in Loiter, AltHold, PosHold, Sport (disabled by default, pilot's throttle input overrides takeoff)
3769
c) PILOT_THR_FILT allows enforcing smoother throttle response in manual flight modes (defaults to 0 = off)
3770
d) TX with sprung throttle can set PILOT_THR_BHV to "1" so motor feedback when landed starts from mid-stick instead of bottom of stick
3771
e) GCS can initiate takeoff even in Loiter, AltHold, PosHold and sport by issuing NAV_TAKEOFF mavlink command
3772
4) Stop flight mode - causes vehicle to stop quickly, and does not respond to user input or waypoint movement via MAVLink. Requires GPS, will be renamed to Brake mode.
3773
5) Aux channel features:
3774
a) Emergency Stop - stops all motors immediately and disarms in 5 seconds
3775
b) Motor Interlock - opposite of Emergency Stop, must be on to allow motors to spin motors, must be off to arm
3776
6) Air pressure gain scaling (of roll, pitch, yaw) should mostly remove need to re-tune when flying at very different altitudes
3777
7) landing detector simplified to only check vehicle is not accelerating & motors have hit their lower limit
3778
8) Loiter tuning params to remove "freight train" stops:
3779
raising WPNAV_LOIT_MAXA makes vehicle start and stop faster
3780
raising WPNAV_LOIT_MINA makes vehicle stop more quickly when sticks centered
3781
9) Other items:
3782
a) faster EKF startup
3783
b) Camera control messages sent via MAVLink to smart cameras. Allow control of camera zoom for upcoming IntelEdison/Sony QX1 camera control board
3784
c) Lost Copter Alarm can be triggered by holding throttle down, roll right, pitch back
3785
10) Bug fixes:
3786
a) Home position set to latest arm position (it was being set to previous disarm location or first GPS lock position)
3787
b) bug fix to mission Jump to command zero
3788
------------------------------------------------------------------
3789
Copter 3.3-rc1 11-Apr-2015
3790
Changes from 3.2.1
3791
1) Only support fast CPUs boards (Pixhawk, VRBrain, etc) and drop support for APM1, APM2 (sorry!)
3792
2) AutoTune for yaw
3793
3) Smooth throttle curve which should reduce wobbles during fast climbs and descents
3794
4) ch7/ch8 aux switches expanded to ch9 ~ ch12 (see CH9_OPT ~ CH12_OPT params)
3795
5) PX4Flow support in Loiter mode (still somewhat experimental)
3796
6) Safety features:
3797
a) EKF on by default replacing DCM/InertialNav which should improve robustness
3798
b) increased accelerometer range from 8G to 16G to reduce chance of climb due to high vibrations (requires accel calibration)
3799
7) Landing features:
3800
a) improved landing on slopes
3801
b) retractable landing gear (see LGR_ parameters)
3802
8) Camera Gimbal features:
3803
a) SToRM32 gimbal support (using MAVLink)
3804
b) AlexMos gimbal support (using AlexMos serial interface)
3805
c) do-mount-control commands supported in missions (allows controlling gimbal angle in missions)
3806
9) Battery related features:
3807
a) PID scaling for battery voltage (disabled by default, see MOT_THST_BAT_ parameters)
3808
b) smart battery support
3809
10) Other:
3810
a) support do-set-home command (allows return-to-me and locked home position once GCS enhancements are completed)
3811
b) performance improvements for Pixhawk reduce CPU load from 80% to 15%
3812
c) firmware string name changed from ArduCopter to APM:Copter
3813
------------------------------------------------------------------
3814
ArduCopter 3.2.1 11-Feb-2015 / 3.2.1-rc2 30-Jan-2015
3815
Changes from 3.2.1-rc1
3816
1) Bug Fixes:
3817
a) prevent infinite loop with linked jump commands
3818
b) Pixhawk memory corruption fix when connecting via USB
3819
c) vehicle stops at fence altitude limit in Loiter, AltHold, PosHold
3820
d) protect against multiple arming messages from GCS causing silent gyro calibration failure
3821
------------------------------------------------------------------
3822
ArduCopter 3.2.1-rc1 08-Jan-2015
3823
Changes from 3.2
3824
1) Enhancements:
3825
a) reduced twitch when passing Spline waypoints
3826
b) Faster disarm after landing in Auto, Land, RTL
3827
c) Pixhawk LED turns green before arming only after GPS HDOP falls below 2.3 (only in flight modes requiring GPS)
3828
2) Safety Features:
3829
a) Add desired descent rate check to reduce chance of false-positive on landing check
3830
b) improved MPU6k health monitoring and re-configuration in case of in-flight failure
3831
c) Rally point distance check reduced to 300m (reduces chance of RTL to far away forgotten Rally point)
3832
d) auto-disarm if vehicle is landed for 15seconds even in Auto, Guided, RTL, Circle
3833
e) fence breach while vehicle is landed causes vehicle to disarm (previously did RTL)
3834
3) Bug Fixes:
3835
a) Check flight mode even when arming from GCS (previously it was possible to arm in RTL mode if arming was initiated from GCS)
3836
b) Send vehicle target destination in RTL, Guided (allows GCS to show where vehicle is flying to in these modes)
3837
c) PosHold wind compensation fix
3838
------------------------------------------------------------------
3839
ArduCopter 3.2 07-Nov2014 / 3.2-rc14 31-Oct-2014
3840
Changes from 3.2-rc13
3841
1) Safety Features:
3842
a) fail to arm if second gyro calibration fails (can be disabled with ARMING_CHECK)
3843
2) Bug fixes:
3844
a) DCM-check to require one continuous second of bad heading before triggering LAND
3845
b) I2C bug that could lead to Pixhawk freezing up if I2C bus is noisy
3846
c) reset DCM and EKF gyro bias estimates after gyro calibration (DCM heading could drift after takeoff due to sudden change in gyro values)
3847
d) use primary GPS for LED status (instead of always using first GPS)
3848
------------------------------------------------------------------
3849
ArduCopter 3.2-rc13 23-Oct-2014
3850
Changes from 3.2-rc12
3851
1) DCM check triggers LAND if yaw disagrees with GPS by > 60deg (configure with DCM_CHECK_THRESH param) and in Loiter, PosHold, Auto, etc
3852
2) Safety features:
3853
a) landing detector checks baro climbrate between -1.5 ~ +1.5 m/s
3854
b) sanity check AHRS_RP_P and AHRS_YAW_P are never less than 0.05
3855
c) check set-mode requests from GCS are for this vehicle
3856
3) Bug fixes:
3857
a) fix ch6 tuning of wp-speed (was getting stuck at zero)
3858
b) parachute servo set to off position on startup
3859
c) Auto Takeoff timing bug fix that could cause severe lean on takeoff
3860
d) timer fix for "slow start" of motors on Pixhawk (timer was incorrectly based on 100hz APM2 main loop speed)
3861
4) reduced number of relays from 4 to 2 (saves memory and flash required on APM boards)
3862
5) reduced number of range finders from 2 to 1 (saves memory and flash on APM boards)
3863
6) allow logging from startup when LOG_BITMASK set to "All+DisarmedLogging"
3864
------------------------------------------------------------------
3865
ArduCopter 3.2-rc12 10-Oct-2014
3866
Changes from 3.2-rc11
3867
1) disable sonar on APM1 and TradHeli (APM1 & APM2) to allow code to fit
3868
2) Add pre-arm and health check that gyro calibration succeeded
3869
3) Bug fix to EKF reporting invalid position and velocity when switched on in flight with Ch7/Ch8 switch
3870
------------------------------------------------------------------
3871
ArduCopter 3.2-rc11 06-Oct-2014
3872
Changes from 3.2-rc10
3873
1) reduce lean on take-off in Auto by resetting horizontal position targets
3874
2) TradHeli landing check ignores overall throttle output
3875
3) reduce AHRS bad messages by delaying 20sec after init to allow EKF to settle (Pixhawk only)
3876
4) Bug fixes:
3877
a) fix THR_MIN scaling issue that could cause landing-detector to fail to detect landing when ch3 min~max > 1000 pwm
3878
b) fix Mediatek GPS configuration so update rate is set correctly to 5hz
3879
c) fix to Condition-Yaw mission command to support relative angles
3880
d) EKF bug fixes when recovering from GPS glitches (affects only Pixhawks using EKF)
3881
------------------------------------------------------------------
3882
ArduCopter 3.2-rc10 24-Sep-2014
3883
Changes from 3.2-rc9
3884
1) two-stage land-detector to reduce motor run-up when landing in Loiter, PosHold, RTL, Auto
3885
2) Allow passthrough from input to output of channels 9 ~ 14 (thanks Emile!)
3886
3) Add 4hz filter to vertical velocity error during AltHold
3887
4) Safety Feature:
3888
a) increase Alt Disparity pre-arm check threshold to 2m (was 1m)
3889
b) reset battery failsafe after disarming/arming (thanks AndKe!)
3890
c) EKF only apply centrifugal corrections when GPS has at least 6 satellites (Pixhawk with EKF enabled only)
3891
5) Bug fixes:
3892
a) to default compass devid to zero when no compass connected
3893
b) reduce motor run-up while landing in RTL
3894
------------------------------------------------------------------
3895
ArduCopter 3.2-rc9 11-Sep-2014
3896
Changes from 3.2-rc8
3897
1) FRAM bug fix that could stop Mission or Parameter changes from being saved (Pixhawk, VRBrain only)
3898
------------------------------------------------------------------
3899
ArduCopter 3.2-rc8 11-Sep-2014
3900
Changes from 3.2-rc7
3901
1) EKF reduced ripple to resolve copter motor pulsing
3902
2) Default Param changes:
3903
a) AltHold Rate P reduced from 6 to 5
3904
b) AltHold Accel P reduced from 0.75 to 0.5, I from 1.5 to 1.0
3905
c) EKF check threshold increased from 0.6 to 0.8 to reduce false positives
3906
3) sensor health flags sent to GCS only after initialisation to remove false alerts
3907
4) suppress bad terrain data alerts
3908
5) Bug Fix:
3909
a)PX4 dataflash RAM usage reduced to 8k so it works again
3910
------------------------------------------------------------------
3911
ArduCopter 3.2-rc7 04-Sep-2014
3912
Changes from 3.2-rc6
3913
1) Safety Items:
3914
a) Landing check made more strict (climb rate requirement reduced to 30cm/s, overall throttle < 25%, rotation < 20deg/sec)
3915
b) pre-arm check that accels are consistent (Pixhawk only, must be within 1m/sec/sec of each other)
3916
c) pre-arm check that gyros are consistent (Pixhawk only, must be within 20deg/sec of each other)
3917
d) report health of all accels and gyros (not just primary) to ground station
3918
------------------------------------------------------------------
3919
ArduCopter 3.2-rc6 31-Aug-2014
3920
Changes from 3.2-rc5
3921
1) Spline twitch when passing through a waypoint largely resolved
3922
2) THR_DZ param added to allow user configuration of throttle deadzone during AltHold, Loiter, PosHold
3923
3) Landing check made more strict (climb rate must be -40~40cm/s for 1 full second)
3924
4) LAND_REPOSITION param default set to 1
3925
5) TradHeli with flybar passes through pilot inputs directly to swash when in ACRO mode
3926
6) Safety Items:
3927
a) EKF check disabled when using inertial nav (caused too many false positives)
3928
b) pre-arm check of internal vs external compass direction (must be within 45deg of each other)
3929
7) Bug Fixes:
3930
a) resolve NaN in angle targets when vehicle hits gimbal lock in ACRO mode
3931
b) resolve GPS driver buffer overflow that could lead to missed GPS messages on Pixhawk/PX4 boards
3932
c) resolve false "compass not calibrated" warnings on Pixhawk/PX4 caused by missing device id initialisation
3933
------------------------------------------------------------------
3934
ArduCopter 3.2-rc5 15-Aug-2014
3935
Changes from 3.2-rc4
3936
1) Pixhawk's max num waypoints increased to 718
3937
2) Smoother take-off in AltHold, Loiter, PosHold (including removing initial 20cm jump when taking off)
3938
3) ACRO mode roll, pitch, yaw EXPO added for faster rotation when sticks are at extremes (see ACRO_EXPO parameter)
3939
4) ch7/ch8 relay option replaces ch6 option (ch6 is reserved for tuning not switching things on/off)
3940
5) Safety Items:
3941
a) Baro glitch check relaxed to 5m distance, 15m/s/s max acceleration
3942
b) EKF/INav check relaxed to 80cm/s/s acceleration correct (default remains as 0.6 but this now means 80cm/s/s)
3943
c) When GPS or Baro glitch clears, the inertial nav velocities are *not* reset reducing chance of sudden vehicle lean
3944
d) Baro altitude calculation checked for divide-by-zero and infinity
3945
6) Bug Fixes:
3946
a) AltHold jump bug fixed (altitude target reset when landed)
3947
b) Rally point bug fix so it does not climb excessively before flying to rally point
3948
c) body-frame rate controller z-axis bug fix (fast rotation in z-axis would cause wobble in roll, pitch)
3949
------------------------------------------------------------------
3950
ArduCopter 3.2-rc4 01-Aug-2014
3951
Changes from 3.2-rc3
3952
1) Pre-takeoff throttle feedback in AltHold, Loiter, PosHold
3953
2) Terrain altitude retrieval from ground station (informational purposes only so far, Pixhawk only)
3954
3) Safety Items:
3955
a) "EKF check" will switch to LAND mode if EKF's compass or velocity variance over 0.6 (configurable with EKFCHECK_THRESH param)
3956
When EKF is not used inertial nav's accelerometer corrections are used as a substitute
3957
b) Barometer glitch protection added. BAROGLTCH_DIST and BAROGLTCH_ACCEL parameters control sensitivity similar to GPSGLITCH protection
3958
When glitching occurs barometer values are temporarily ignored
3959
c) Throttle/radio and battery failsafes now disarm vehicle when landed regardless of pilot's throttle position
3960
d) auto-disarm extended to Drift, Sport and OF_Loiter flight modes
3961
e) APM2 buzzer notification added for arming failure
3962
f) APM2 arming buzz made longer (now matches Pixhawk)
3963
g) do-set-servo commands cannot interfere with motor output
3964
4) Bug Fixes:
3965
a) Drift slow yaw response fixed
3966
b) AC3.2-rc3 failsafe bug resolved. In -rc3 the throttle failsafe could be triggered even when disabled or motors armed (although vehicle would not takeoff)
3967
------------------------------------------------------------------
3968
ArduCopter 3.2-rc3 16-Jul-2014
3969
Changes from 3.2-rc2
3970
1) Hybrid renamed to PosHold
3971
2) Sonar (analog, i2c) and PulsedLight Range Finders enabled on Pixhawk (Allyson, Tridge)
3972
3) Landing changes:
3973
a) disable pilot repositioning while landing in RTL, Auto (set LAND_REPOSITION to 1 to re-enable) (JonathanC)
3974
b) delay 4 seconds before landing due to failsafe (JonathanC)
3975
4) Secondary compass calibration enabled, pre-arm check that offsets match current devices (Randy, Tridge, MichaelO)
3976
5) Control improvements:
3977
a) use bias adjusted gyro rates - helps in cases of severe gyro drift (Jonathan)
3978
b) bug-fixes when feed-forward turned off (Leonard)
3979
6) TradHeli improvements (RobL):
3980
a) bug fix to use full collective range in stabilize and acro flight modes
3981
b) filter added to main rotor input (ch8) to ensure momentary blip doesn't affect main rotor speed
3982
7) Safety items:
3983
a) increased default circular Fence radius to 300m to reduce chance of breach when GPS lock first acquired
3984
b) radio failsafe timeout for late frames reduced to 0.5sec for normal receivers or 2.0sec when flying with joystick (Craig)
3985
c) accelerometer pre-arm check for all active accelerometers (previously only checked the primary accelerometer)
3986
8) Other features:
3987
a) ch7/ch8 option to retract mount (svefro)
3988
b) Do-Set-ROI supported in Guided, RTL mode
3989
c) Condition-Yaw accepted in Guided, RTL modes (MoussSS)
3990
d) CAMERA dataflash message includes relative and absolute altitude (Craig)
3991
9) Red Balloon Popper support (Randy, Leonard):
3992
a) Velocity controller added to Guided mode
3993
b) NAV_GUIDED mission command added
3994
10) Bug fixes:
3995
a) bug fix to flip on take-off in stabilize mode when landing flag cleared slowly (JonathanC)
3996
b) allow disarming in AutoTune (JonathanC)
3997
c) bug fix to unpredictable behaviour when two spline points placed directly ontop of each other
3998
------------------------------------------------------------------
3999
ArduCopter 3.2-rc2 27-May-2014
4000
Changes from 3.2-rc1
4001
1) Hybrid mode initialisation bug fix
4002
2) Throttle pulsing bug fix on Pixhawk
4003
3) Parachute enabled on Pixhawk
4004
4) Rally Points enabled on Pixhawk
4005
------------------------------------------------------------------
4006
ArduCopter 3.2-rc1 9-May-2014
4007
Changes from 3.1.4
4008
1) Hybrid mode - position hold mode but with direct response to pilot input during repositioning (JulienD, SandroT)
4009
2) Spline waypoints (created by David Dewey, modified and integrated by Leonard, Randy)
4010
3) Drift mode uses "throttle assist" for altitude control (Jason)
4011
4) Extended Kalman Filter for potentially more reliable attitude and position control (Pixhawk only) (Paul Riseborough). Set AHRS_EKF_USE to 1 to enable or use Ch7/8 switch to enable/disable in flight.
4012
5) Manual flight smoothness:
4013
a) Smoother roll, pitch response using RC_FEEL_RP parameter (100 = crisp, 0 = extremely soft)
4014
b) Adjustable max rotation rate (ATC_RATE_RP_MAX, ATC_RATE_Y_MAX) and acceleration (ATC_ACCEL_RP_MAX, ATC_ACCEL_Y_MAX)
4015
6) Autopilot smoothness:
4016
a) Vertical acceleration in AltHold, Loiter, Hybrid modes can be configured with PILOT_ACCEL_Z parameter (higher = faster acceleration)
4017
b) Maximum roll and pitch angle acceleration in Loiter mode can be configured with WPNAV_LOIT_JERK (higher = more responsive but potentially jerky)
4018
c) Yaw speed can be adjusted with ATC_SLEW_YAW parameter (higher = faster)
4019
d) smoother takeoff with configurable acceleration using WPNAV_ACCEL_Z parameter
4020
e) Twitches removed during guided mode or when entering Loiter or RTL from high speeds
4021
7) Mission improvements:
4022
a) mission will be resumed from last active command when pilot switches out and then back into Auto mode (prev behaviour can be restored by setting MIS_RESTART param to 1)
4023
b) DO_SET_ROI persistent across waypoints. All-zero DO_SET_ROI command restores default yaw behaviour
4024
c) do-jump fixed
4025
d) conditional_distance fixed
4026
e) conditional_delay fixed
4027
f) do-change-speed command takes effect immediately during mission
4028
g) vehicle faces directly at next waypoint (previously it could be about 10deg off)
4029
h) loiter turns fix to ensure it will circle around lat/lon point specified in mission command (previously it could be off by CIRCLE_RADIUS)
4030
8) Safety improvements:
4031
a) After a fence breach, if the pilot re-takes control he/she will be given a minimum of 10 seconds and 20m to recover before the autopilot will invoke RTL or LAND
4032
b) Parachute support including automatic deployment during mechanical failures
4033
9) Other enhancements:
4034
a) V-tail quad support
4035
b) Dual GPS support (secondary GPS output is simply logged, not actually used yet)
4036
c) Electro Permanent Magnet (aka Gripper) support
4037
d) Servo pass through for channels 6 ~ 8 (set RC6_FUNCTION to 1)
4038
e) Remove 80m limit on RTL's return altitude but never let it be above fence's max altitude
4039
10) Other bug fixes:
4040
a) Bug fix for LAND sometimes getting stuck at 10m
4041
b) During missions, vehicle will maintain altitude even if WPNAV_SPEED is set above the vehicle's capabilities
4042
c) when autopilot controls throttle (i.e. Loiter, Auto, etc) vehicle will reach speeds specified in PILOT_VELZ_MAX and WPNAV_SPEED_UP, WPNAV_SPEED_DN parameters
4043
11) CLI removed from APM1/2 to save flash space, critical functions moved to MAVLink:
4044
a) Individual motor tests (see MP's Initial Setup > Optional Hardware > Motor Test)
4045
b) compassmot (see MP's Initial Setup > Optional Hardware > Compass/Motor Calib)
4046
c) parameter reset to factory defautls (see MP's Config/Tuning > Full Parameter List > Reset to Default)
4047
------------------------------------------------------------------
4048
ArduCopter 3.1.5 27-May-2014 / 3.1.5-rc2 20-May-2014
4049
Changes from 3.1.5-rc1
4050
1) Bug Fix to broken loiter (pixhawk only)
4051
2) Workaround to read from FRAM in 128byte chunks to resolve a few users boot issues (Pixhawk only)
4052
------------------------------------------------------------------
4053
ArduCopter 3.1.5-rc1 14-May-2014
4054
Changes from 3.1.4
4055
1) Bug Fix to ignore roll and pitch inputs to loiter controller when in radio failsafe
4056
2) Bug Fix to allow compassmot to work on Pixhawk
4057
------------------------------------------------------------------
4058
ArduCopter 3.1.4 8-May-2014 / 3.1.4-rc1 2-May-2014
4059
Changes from 3.1.3
4060
1) Bug Fix for Pixhawk/PX4 NuttX I2C memory corruption when errors are found on I2C bus
4061
------------------------------------------------------------------
4062
ArduCopter 3.1.3 7-Apr-2014
4063
Changes from 3.1.2
4064
1) Stability patch fix which could cause motors to go to min at full throttle and with large roll/pitch inputs
4065
------------------------------------------------------------------
4066
ArduCopter 3.1.2 13-Feb-2014 / ArduCopter 3.1.2-rc2 12-Feb-2014
4067
Changes from 3.1.2-rc1
4068
1) GPS Glitch detection disabled when connected via USB
4069
2) RC_FEEL_RP param added for adjusting responsiveness to pilot roll/pitch input in Stabilize, Drift, AltHold modes
4070
------------------------------------------------------------------
4071
ArduCopter 3.1.2-rc1 30-Jan-2014
4072
Changes from 3.1.1
4073
1) Pixhawk baro bug fix to SPI communication which could cause large altitude estimate jumps at high temperatures
4074
------------------------------------------------------------------
4075
ArduCopter 3.1.1 26-Jan-2014 / ArduCopter 3.1.1-rc2 21-Jan-2014
4076
Changes from 3.1.1-rc1
4077
1) Pixhawk improvements (available for APM2 when AC3.2 is released):
4078
a) Faster arming
4079
b) AHRS_TRIM fix - reduces movement in loiter when yawing
4080
c) AUX Out 5 & 6 turned into general purpose I/O pins
4081
d) Three more relays added (relays are pins that can be set to 0V or 5V)
4082
e) do-set-servo fix to allow servos to be controlled from ground station
4083
f) Motorsync CLI test
4084
g) PX4 parameters moved from SD card to eeprom
4085
h) additional pre-arm checks for baro & inertial nav altitude and lean angle
4086
------------------------------------------------------------------
4087
ArduCopter 3.1.1-rc1 14-Jan-2014
4088
Changes from 3.1
4089
1) Pixhawk improvements:
4090
a) Telemetry port 2 enabled (for MinimOSD)
4091
b) SD card reliability improvements
4092
c) parameters moved to FRAM
4093
d) faster parameter loading via USB
4094
e) Futaba SBUS receiver support
4095
2) Bug fixes:
4096
a) Loiter initialisation fix (Loiter would act like AltHold until flight mode switch changed position)
4097
b) ROI commands were not returning Lat, Lon, Alt to mission planner when mission was loaded from APM
4098
3) TradHeli only fixes:
4099
a) Drift now uses same (reduced) collective range as stabilize mode
4100
b) AutoTune disabled (for tradheli only)
4101
c) Landing collective (smaller than normal collective) used whenever copter is not moving
4102
------------------------------------------------------------------
4103
ArduCopter 3.1 14-Dec-2013
4104
Changes from 3.1-rc8
4105
1) Pixhawk improvements:
4106
a) switch to use MPU6k as main accel/gyro
4107
b) auto loading of IO-board firmware on startup
4108
2) RTL fixes:
4109
a) initialise waypoint leash length (first RTL stop would be more aggressive than 2nd)
4110
b) reduce projected stopping distance for higher speed stops
4111
------------------------------------------------------------------
4112
ArduCopter 3.1-rc8 9-Dec-2013
4113
Changes from 3.1-rc7
4114
1) add Y6 motor mapping with all top props CW, bottom pros CCW (set FRAME = 10)
4115
2) Safety Changes:
4116
a) ignore yaw input during radio failsafe (previously the copter could return home spinning if yaw was full over at time of failsafe)
4117
b) Reduce GPSGLITCH_RADIUS to 2m (was 5m) to catch glitches faster
4118
3) Bug fixes:
4119
a) Optical flow SPI bus rates
4120
b) TradHeli main rotor ramp up speed fix
4121
------------------------------------------------------------------
4122
ArduCopter 3.1-rc7 22-Nov-2013
4123
Changes from 3.1-rc6
4124
1) MOT_SPIN_ARMED default to 70
4125
2) Smoother inertial nav response to missed GPS messages
4126
3) Safety related changes
4127
a) radio and battery failsafe disarm copter if landed in Loiter or AltHold (previously they would RTL)
4128
b) Pre-Arm check failure warning output to ground station every 30 seconds until they pass
4129
c) INS and inertial nav errors logged to dataflash's PM message
4130
d) pre-arm check for ACRO_BAL_ROLL, ACRO_BAL_PITCH
4131
------------------------------------------------------------------
4132
ArduCopter 3.1-rc6 16-Nov-2013
4133
Improvements over 3.1-rc5
4134
1) Heli improvements:
4135
a) support for direct drive tails (uses TAIL_TYPE and TAIL_SPEED parameters)
4136
b) smooth main rotor ramp-up for those without external govenor (RSC_RAMP_TIME)
4137
c) internal estimate of rotor speed configurable with RSC_RUNUP_TIME parameter to ensure rotor at top speed before starting missions
4138
d) LAND_COL_MIN collective position used when landed (reduces chance copter will push too hard into the ground when landing or before starting missions)
4139
e) reduced collective while in stabilize mode (STAB_COL_MIN, STAB_COL_MAX) for more precise throttle control
4140
f) external gyro parameter range changed from 1000~2000 to 0~1000 (more consistent with other parameters)
4141
g) dynamic flight detector switches on/off leaky-i term depending on copter speed
4142
2) SingleCopter airframe support (contribution from Bill King)
4143
3) Drift mode replaces TOY
4144
4) MPU6k SPI bus speed decreased to 500khz after 4 errors
4145
5) Safety related changes:
4146
a) crash detector cuts motors if copter upside down for more than 2 seconds
4147
b) INS (accel and gyro) health check in pre-arm checks
4148
c) ARMING_CHECK allows turning on/off individual checks for baro, GPS, compass, parameters, board voltage, radio
4149
d) detect Ublox GPS running at less than 5hz and resend configuration
4150
e) GPSGlitch acceptable radius reduced to 5m (stricter detection of glitches)
4151
f) range check roll, pitch input to ensure crazy radio values don't get through to stabilize controller
4152
g) GPS failsafe options to trigger AltHold instead of LAND or to trigger LAND even if in flight mode that does not require GPS
4153
h) Battery failsafe option to trigger RTL instead of LAND
4154
i) MOT_SPIN_ARMED set to zero by default
4155
6) Bug fixes:
4156
a) missing throttle controller initialisation would mean Stabilize mode's throttle could be non-tilt-compensated
4157
b) inertial nav baro and gps delay compensation fix (contribution from Neurocopter)
4158
c) GPS failsafe was invoking LAND mode which still used GPS for horizontal control
4159
------------------------------------------------------------------
4160
ArduCopter 3.1-rc5 22-Oct-2013
4161
Improvements over 3.1-rc4
4162
1) Pixhawk USB reliability improvements
4163
2) AutoTune changes:
4164
a) enabled by default
4165
b) status output to GCS
4166
c) use 2 pos switch only
4167
3) ch7/ch8 LAND
4168
4) Tricopter stability patch improvements [thanks to texlan]
4169
5) safety improvements:
4170
a) slower speed up of motors after arming
4171
b) pre-arm check that copter is moving less than 50cm/s if arming in Loiter or fence enabled
4172
------------------------------------------------------------------
4173
ArduCopter 3.1-rc4 13-Oct-2013
4174
Improvements over 3.1-rc3
4175
1) Performance improvements to resolve APM alt hold issues for Octacopters:
4176
a) SPI bus speed increased from 500khz to 8Mhz
4177
b) Telemetry buffer increased to 512bytes
4178
c) broke up medium and slow loops into individual scheduled tasks and increased priority of alt hold tasks
4179
2) Bug fix for Pixhawk USB connection
4180
3) GPS Glitch improvements:
4181
a) added GPS glitch check to arming check
4182
b) parameters for vehicle max acceleration (GPSGLITCH_ACCEL) and always-ok radius (GPSGLICH_RADIUS)
4183
------------------------------------------------------------------
4184
ArduCopter 3.1-rc3 09-Oct-2013
4185
Improvements over 3.1-rc2
4186
1) GPS Glitch protection - gps positions are compared with the previous gps position. Position accepted if within 10m or copter could have reached the position with max accel of 10m/s/s.
4187
2) Bug fix for pixhawk SPI bus contention that could lead to corrupted accelerometer values on pixhawk resolved
4188
3) Auto Tuning (compile time option only add "#define AUTOTUNE ENABLED" to APM_Config.h and set CH7_Opt or CH8_Opt parameter to 17)
4189
4) CPU Performance improvement when reading from MPU6k for APM
4190
5) SUPER_SIMPLE parameter changed to a bit map to allow some flight modes to use super simpler while others use regular simple (MP release to allow easier selection will go out with AC3.1 official release)
4191
6) Safety changes:
4192
a) safety button must be pushed before arming on pixhawk
4193
b) RGB LED (aka toshiba led) changed so that disarmed flashes, armed is either blue (if no gps lock) or green (if gps lock)
4194
c) sensor health bitmask sent to groundstations
4195
------------------------------------------------------------------
4196
ArduCopter 3.1-rc2 18-Sep-2013
4197
Improvements over 3.1-rc1
4198
1) bug fix for MOT_SPIN_ARMED to allow it to be higher than 127
4199
2) PX4/pixhawk auto-detect internal/external compass so COMPASS_ORIENT should be set to ORIENTATION_NONE if using GPS+compass module
4200
------------------------------------------------------------------
4201
ArduCopter 3.1-rc1 9-Sep-2013
4202
Improvements over 3.0.1
4203
1) Support for Pixhawks board
4204
2) Arm, Disarm, Land and Takeoff in Loiter and AltHold
4205
3) Improved Acro
4206
a) ACRO_RP_P, ACRO_YAW_P parameters added to control speed of rotation
4207
b) ACRO_BAL_ROLL, ACRO_BAL_PITCH controls speed at which copter returns to level
4208
c) ACRO_TRAINER can be set to 0:disable trainer, 1:auto leveling when sticks released, 2:auto leveling and lean angle limited to ANGLE_MAX
4209
d) Ch7 & Ch8 switch to set ACRO_TRAINER options in-flight
4210
4) SPORT mode - equivalent of earth frame Acro with support for simple mode
4211
5) Sonar ground tracking improvements and bug fixes that reduce reaction to bad sonar data
4212
6) Safety improvements
4213
a) motors always spin when armed (speed can be controlled with MOT_SPIN_ARMED, set to 0 to disable)
4214
b) vehicle's maximum lean angle can be reduced (or increased) with the ANGLE_MAX parameter
4215
c) arming check that GPS hdop is > 2.0 (disable by setting GPS_HDOP parameter to 900)
4216
d) slow take-off in AUTO, LOITER, ALTHOLD to reduce chance of motor/esc burn-out on large copters
4217
7) Bug fixes:
4218
a) Optical flow sensor initialisation fix
4219
b) altitude control fix for Loiter_turns mission command (i.e. mission version of CIRCLE mode)
4220
c) DO_SET_ROI fix (do not use "ROI")
4221
8) Distribute Loiter & Navigation calcs over 4 cycles to reduce impact on a single 100hz loop
4222
9) RCMAP_ parameters allow remapping input channels 1 ~ 4
4223
------------------------------------------------------------------
4224
ArduCopter 3.0.1-rc2 / 3.0.1 11-Jul-2013
4225
Improvements over 3.0.1-rc1
4226
1) Rate Roll, Pitch and Yaw I fix when we hit motor limits
4227
2) pre-arm check changes:
4228
a) double flash arming light when pre-arm checks fail
4229
b) relax mag field checks to 35% min, 165% max of expected field
4230
3) loiter and auto changes:
4231
a) reduced Loiter speed to 5 m/s
4232
b) reduced WP_ACCEL to 1 m/s/s (was 2.5 m/s/s)
4233
c) rounding error fix in loiter controller
4234
d) bug fix to stopping point calculation for RTL and loiter during missions
4235
4) Stability Patch fix which was freezing Rate Taw I term and allowing uncommanded Yaw
4236
------------------------------------------------------------------
4237
ArduCopter 3.0.1-rc1 26-Jun-2013
4238
Improvements over 3.0.0
4239
1) bug fix to Fence checking position after GPS lock was lost
4240
2) bug fix to LAND so that it does not attempt to maintain horizontal position without GPS lock
4241
------------------------------------------------------------------
4242
ArduCopter 3.0.0 / 3.0.0-rc6 16-Jun-2013
4243
Improvements over 3.0.0-rc5
4244
1) bug fix to Circle mode's start position (was moving to last loiter target)
4245
2) WP_ACCEL parameter added to allow user to adjust acceleration during missions
4246
3) loiter acceleration set to half of LOIT_SPEED parameter value (was hard-coded)
4247
4) reduce AltHold P to 1.0 (was 2.0)
4248
------------------------------------------------------------------
4249
ArduCopter 3.0.0-rc5 04-Jun-2013
4250
Improvements over 3.0.0-rc4
4251
1) bug fix to LAND flight mode in which it could try to fly to mission's next waypoint location
4252
2) bug fix to Circle mode to allow counter-clockwise rotation
4253
3) bug fix to heading change in Loiter, RTL, Missions when pilot's throttle is zero
4254
4) bug fix for mission sticking at take-off command when pilot's throttle is zero
4255
5) bug fix for parameters not saving when new value is same as default value
4256
6) reduce pre-arm board min voltage check to 4.3V (was 4.5V)
4257
7) remove throttle controller's ability to limit lean angle in loiter, rtl, auto
4258
------------------------------------------------------------------
4259
ArduCopter 3.0.0-rc4 02-Jun-2013
4260
Improvements over 3.0.0-rc3
4261
1) loiter improvements:
4262
i) repositioning enhanced with feed forward
4263
ii) use tan to convert desired accel to lean angle
4264
2) stability patch improvements for high powered copters or those with roll-pitch rate gains set too high
4265
3) auto mode vertical speed fix (it was not reaching the desired speeds)
4266
4) alt hold smoothed by filtering feed forward input
4267
5) circle mode fix to initial position and smoother initialisation
4268
6) RTL returns to initial yaw heading before descending
4269
7) safe features:
4270
i) check for gps lock when entering failsafe
4271
ii) pre-arm check for mag field length
4272
iii) pre-arm check for board voltage between 4.5v ~ 5.8V
4273
iv) beep twice during arming
4274
v) GPS failsafe enabled by default (will LAND if loses GPS in Loiter, AUTO, Guided modes)
4275
vi) bug fix for alt-hold mode spinning motors before pilot has raised throttle
4276
8) bug fixes:
4277
i) fixed position mode so it responding to pilot input
4278
ii) baro cli test
4279
iii) moved cli motor test to test sub menu and minor change to throttle output
4280
iv) guided mode yaw control fix
4281
------------------------------------------------------------------
4282
ArduCopter 3.0.0-rc3 22-May-2013
4283
Improvements over 3.0.0-rc2
4284
1) bug fix for dataflash erasing unnecessarily
4285
2) smoother transition to waypoints, loiter:
4286
intermediate point's speed initialised from copter's current speed
4287
3) Ch8 auxiliary function switch (same features as Ch7)
4288
4) safety checks:
4289
Warning to GCS of reason for pre-arm check failure
4290
ARMING_CHECK parameter added to allow disabling pre-arm checks
4291
Added compass health and offset check to pre-arm check
4292
compassmot procedure displays interference as percentage of total mag field
4293
5) WPNAV dataflash message combined into NTUN message
4294
6) allow TriCopters to use ESC calibration
4295
------------------------------------------------------------------
4296
ArduCopter 3.0.0-rc2 13-May-2013
4297
Improvements over 3.0.0-rc1:
4298
1) smoother transition to waypoints, loiter:
4299
reduced loiter max acceleration to smooth waypoints
4300
bug fix to uninitialised roll/pitch when entering RTL, AUTO, LOITER
4301
2) fast waypoints - copter does not stop at waypoints unless delay is specified
4302
3) WPNAV_LOIT_SPEED added to allow faster/slower loiter repositioning
4303
4) removed speed limits on auto missions
4304
5) enhance LAND mission command takes lat/lon coordinates
4305
6) bug fix for RTL not pointing home sometimes
4306
7) centrifugal correction disabled when copter is disarmed to stop HUD moving
4307
8) centrifugal correction disabled when sat count less than 6 (AHRS_GPS_MINSATS)
4308
9) compass calibration reliability improvements when run from mission planner
4309
10) bug fix to allow compassmot to be run from mission planner terminal screen
4310
11) add support for H-quad frame
4311
12) add COMPASS_ORIENT parameter to support external compass in any orientation
4312
------------------------------------------------------------------
4313
ArduCopter 3.0.0-rc1 01-May-2013
4314
Improvements over 2.9.1b:
4315
1) Inertial navigation for X & Y axis (Randy/Leonard/Jonathan)
4316
2) 3D waypoint navigation library (Leonard/Randy)
4317
WPNAV_SPEED, WPNAV_SPEED_UP, WPNAV_SPEED_DN control target speeds during missions and RTL
4318
WP_YAW_BEHAVIOR to allow disabling yaw during missions and RTL
4319
3) PX4 support (some features still not available) (Tridge/Pat/PX4Dev Team)
4320
4) Safety improvements:
4321
Tin-can shaped fence (set FENCE_ENABLED to 1 and copter will RTL if alt > 150m or horizontal distance from home > 300m) (Randy/Tridge/Leonard)
4322
GCS failsafe (set FS_GCS_ENABLED to 1 and if you are using a tablet to fly your copter it will RTL and return control to the radio 3 seconds after losing telemetry) (Randy)
4323
pre-arm checks to ensure accelerometer and radio calibration has been performed before arming (Randy)
4324
5) motor interference compensation for compass (Jonathan/Randy)
4325
6) Circle mode improvements:
4326
set CIRCLE_RADIUS to zero to do panorama shots in circle mode (copter does not move in a circle but instead slowly rotates)
4327
CIRCLE_RATE parameter allows controlling direction and speed of rotation in CIRCLE mode and LOITER_TURNS (can also be adjusted in flight from CH6 knob)
4328
7) SONAR_GAIN parameter add to allow reducing the response to objects sensed by sonar (Randy)
4329
8) support for trapezoidal quads (aka V shaped or FPV quads) (Leonard/Craig)
4330
9) performance improvements to dataflash logging (Tridge)
4331
10) bug-fix to analog read which could cause bad sonar reads when using voltage or current monitor (Tridge)
4332
11) bug-fix to motors going to minimum when throttle is low while switching into Loiter, AUTO, RTL, ALT_HOLD (Jason/Randy)
4333
12) bug-fix for auto disarm sometimes disarming shortly after arming (Jason/SirAlex)
4334
------------------------------------------------------------------
4335
ArduCopter 2.9.1b 30-Feb-2013
4336
Improvements over 2.9.1:
4337
1) reduce INS_MPU6K_FILTER to 20hz
4338
2) reduce InertialNav Z-axis time constant to 5 (was 7)
4339
3) increased max InertialNav accel correction to 3 m/s (was 1m/s)
4340
4) bug fix for alt_hold being passed as int16_t to get_throttle_althold_with_slew
4341
5) bug fix for throttle after acro flip (was being kept at min throttle if pilot switched out of ACRO mode while inverted)
4342
6) reduce yaw_rate P default to 0.20 (was 0.25)
4343
------------------------------------------------------------------
4344
ArduCopter 2.9.1 & 2.9.1-rc2 01-Feb-2013
4345
Improvements over 2.9.1-rc1:
4346
1) small corretion to use of THR_MID to scale lower end of manual throttle between THR_MIN and 500 instead of 0 and 500
4347
2) bug fix for longitude scaling being incorrectly calculated using Next Waypoint instead of home which could lead to scaling being 1
4348
3) ESC calibration change to set update rate to ESCs to 50hz to allow simonk ESC to be calibrated
4349
------------------------------------------------------------------
4350
ArduCopter 2.9.1-rc1 31-Jan-2013
4351
Improvements over 2.9:
4352
1) THR_MID parameter added to allow users to adjust the manual throttle so that vehicle hovers at about mid stick
4353
2) bug fix for autotrim - roll axis was backwards
4354
3) bug fix to set sonar_alt_health to zero when sonar is disabled
4355
4) capture level roll and pitch trims as part of accel calibration
4356
5) bug fix to ppm encoder false positives
4357
------------------------------------------------------------------
4358
ArduCopter 2.9 & 2.9-rc5 14-Jan-2013
4359
Improvements over 2.9-rc4:
4360
1) add constraint to loiter commanded roll and pitch angles
4361
2) relax altitude requirement for take-off command to complete
4362
------------------------------------------------------------------
4363
ArduCopter 2.9-rc4 12-Jan-2013
4364
Improvements over 2.9-rc3:
4365
1) Smoother transition between manual and auto flight modes (Leonard)
4366
2) bug fix for LAND not actually landing when initiated from failsafe (Randy/Craig)
4367
------------------------------------------------------------------
4368
ArduCopter 2.9-rc3 11-Jan-2013
4369
Improvements over 2.9-rc2:
4370
1) alt hold with sonar improvements - now on by default (Leonard/Randy)
4371
2) performance and memory usage improvements (Tridge/Randy)
4372
3) increase APM1 baro pressure read from 5hz to 8.3hz to improve alt hold (Randy)
4373
4) bug fix: altitude error reported to GCS (Randy)
4374
5) limit inertial nav's max accel offset correction to 100cm/s/s to speed up recovery after hard impacts (Randy)_
4375
6) moved rate controllers to run after ins read (Tridge/Randy)
4376
------------------------------------------------------------------
4377
ArduCopter 2.9-rc2 31-Dec-2012
4378
Improvements over 2.9-rc1:
4379
1) increased throttle rate gains from 1.0 to 6.0
4380
2) APM1 fix so it works with inertial nav (5hz update rate of baro was beyond the tolerance set in the inav library)
4381
------------------------------------------------------------------
4382
ArduCopter 2.9-rc1 23-Dec-2012
4383
Improvements over 2.8.1:
4384
1) altitude hold improvements:
4385
a)inertial navigation for vertical axis [Randy/Jonathan/Leonard/Jason]
4386
b)accel based throttle controller [Leonard/Randy]
4387
c)accelerometer calibration routine updated to use gauss-newton method [Randy/Tridge/Rolfe Schmidt]
4388
d)parameters to control climb rate:
4389
AUTO_VELZ_MIN, AUTO_VELZ_MAX - allows you to control the maximum climb and descent rates of the autopilot (in cm/s)
4390
PILOT_VELZ_MAX - allows you to control the maximum climb/descent rate when in alt hold or loiter (in cm/s)
4391
2) landing improvements [Leonard/Randy]
4392
LAND_SPEED - allows you to set the landing speed in cm/s
4393
3) camera related improvements:
4394
a) AP_Relay enabled for APM2 and integrated with AP_Camera [Sandro Benigno]
4395
b) camera trigger with channel 7 switch or DO_DIGICAM_CONTROL mission command [Randy]
4396
c) allow yaw override by pilot or with CONDITIONAL_YAW command during missions [Randy]
4397
YAW_OVR_BEHAVE - Controls when autopilot takes back normal control of yaw after pilot overrides (0=after next wp, 1=never)
4398
4) trad heli improvements [Rob]
4399
a) code tested and brought back into the fold (2.8.1 was never released for trad helis)
4400
b) enabled rate controller (previously only used angle controllers)
4401
c) fix to rotor speed controllers - now operates by switching off channel 8
4402
d) allow wider collective pitch range in acro and alt hold modes vs stabilize mode
4403
e) removed angle boost function because it created more problems than it solved
4404
f) bug fix to allow collective pitch to use the entire range of servos
4405
5) mediatek gps driver improvements [Craig]
4406
a) added support for 1.9 firmware
4407
b) bug fix to start-up routine so sbas can be enabled
4408
6) failsafe improvements (both throttle and battery) [Randy/Craig/John Arne Birkeland]
4409
a) RTL will not trigger if your throttle is zero - reduces risk of accidentally invoking RTL if you switch off your receiver before disarming
4410
b) failsafe triggered in unlikely case of a PPM encoder failure
4411
c) bug fix to resolve motors momentarily reducing to zero after failsafe is triggered
4412
7) mpu6k filtering made configurable and default changed to 42hz for copters [Leonard/Tridge]
4413
8) support ppm sum for transmitters with as few as 5 channels [Randy/John Arne Birkeland]
4414
9) acro trainer - copter will return to be generally upright if you release the sticks in acro mode [Leonard]
4415
ACRO_BAL_ROLL, ACRO_BAL_PITCH - controls rate at which roll returns to level
4416
ACRO_TRAINER - 1 to enable the auto-bring-upright feature
4417
10) other changes and bug fixes:
4418
a) allow >45 degrees when in stabilize mode by adding lines like below to APM_Config (compile time option only) [Jason]
4419
#define MAX_INPUT_ROLL_ANGLE 6000 // 60 degrees
4420
#define MAX_INPUT_PITCH_ANGLE 6000 // 60 degrees
4421
b) bug fix to stop RTL from ever climbing to an unreasonable height (i.e. >80m) [Jason]
4422
c) event and state logging [Jason]
4423
d) allow cli to be used over telemetry link [Tridge]
4424
e) bug fix to allow compass accumulate to run when we have spare cpu cycles [Randy]
4425
f) bug fix so do_set_servo command works [Randy]
4426
g) bug fix to PID controller's so they don't calculate crazy D term on the first call [Tridge]
4427
h) bug fix to initialise navigation parameter to resolve twitch when entering some navigation modes [Jason]
4428
i) performance improvement to copter leds - use DigitalFastWrite and DigitalFastRead instead of native arduino functions [Randy]
4429
j) removed unused stab_d from roll and pitch controller [Jason]
4430
k) bug fix for guided mode not reaching target altitude if it reaches horizontal target first [Randy]
4431
l) code clean-up, parameter documentation improvements [Randy/Jason/Rob/others]
4432
4433
------------------------------------------------------------------
4434
ArduCopter 2.8.1 22-Oct-2012
4435
Improvements over 2.8:
4436
- 430 bytes of RAM freed up to resolve APM1 level issue and reduce chance of memory corruption on both APM1 and APM2
4437
4438
Improvements over 2.7.3:
4439
- Improved ACRO mode (Leonard Hall)
4440
- Improved stability patch to reduce "climb-on-yaw" problem (Leonard, Rob Lefebvre, Randy)
4441
- Rate controller targets moved to body frames (yaw control now works properly when copter is inverted) (Leonard/Randy)
4442
- Less bouncy Stabilize yaw control (Leonard)
4443
- OpticalFlow sensor support for APM2.5 (Randy)
4444
- DMP works again by adding "#define DMP_ENABLED ENABLED" to APM_Config.h You can also log DMP vs DCM to the dataflash by adding "#define SECONDARY_DMP_ENABLED ENABLED" (Randy)
4445
- Watch dog added to shutdown motors if main loop feezes for 2 seconds (Randy)
4446
- Thrust curve added to linearize pwm->thrust. Removes deadzone found above 90% throttle in most ESC/motors (Randy)
4447
- More timing improvements (main loop is now tied to MPU6000s interrupt) (Randy)
4448
- GPS NMEA bug fix (Alexey Kozin)
4449
- Logging improvements (log I terms, dump all settings at head of dataflash log) (Jason)
4450
4451
Bug Fixes / Parameter changes:
4452
- fixed skipping of last waypoint (Jason)
4453
- resolved twitching when no GPS attached (Tridge)
4454
- fixed loss of altitude if alt hold is engaged before first GPS lock (Randy/Jason)
4455
- moved Roll-Pitch I terms from Stabilize controllers to Rate controllers
4456
- TILT_COMPENSATION param tuned for TradHeli (Rob)
4457
4458
Code Cleanup:
4459
- HAL changes for platform portability (Pat Hickey)
4460
- Removed INSTANT_PWM (Randy)
4461
------------------------------------------------------------------
4462
4463