2 * This file is part of Cleanflight and Betaflight.
4 * Cleanflight and Betaflight are free software. You can redistribute
5 * this software and/or modify this software under the terms of the
6 * GNU General Public License as published by the Free Software
7 * Foundation, either version 3 of the License, or (at your option)
10 * Cleanflight and Betaflight are distributed in the hope that they
11 * will be useful, but WITHOUT ANY WARRANTY; without even the implied
12 * warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.
13 * See the GNU General Public License for more details.
15 * You should have received a copy of the GNU General Public License
16 * along with this software.
18 * If not, see <http://www.gnu.org/licenses/>.
28 #include "build/debug.h"
30 #include "common/filter.h"
31 #include "common/maths.h"
32 #include "common/utils.h"
34 #include "config/config.h"
35 #include "config/feature.h"
37 #include "drivers/adc.h"
39 #include "fc/runtime_config.h"
40 #include "fc/rc_controls.h"
42 #include "flight/mixer.h"
44 #include "io/beeper.h"
47 #include "pg/pg_ids.h"
49 #include "scheduler/scheduler.h"
50 #ifdef USE_BATTERY_CONTINUE
54 #include "sensors/battery.h"
57 * terminology: meter vs sensors
59 * voltage and current sensors are used to collect data.
60 * - e.g. voltage at an MCU ADC input pin, value from an ESC sensor.
61 * sensors require very specific configuration, such as resistor values.
62 * voltage and current meters are used to process and expose data collected from sensors to the rest of the system.
63 * - e.g. a meter exposes normalized, and often filtered, values from a sensor.
64 * meters require different or little configuration.
65 * meters also have different precision concerns, and may use different units to the sensors.
69 #define VBAT_STABLE_MAX_DELTA 20
70 #define LVC_AFFECT_TIME 10000000 //10 secs for the LVC to slowly kick in
72 // Battery monitoring stuff
73 static uint8_t batteryCellCount
; // Note: this can be 0 when no battery is detected or when the battery voltage sensor is missing or disabled.
74 static uint16_t batteryWarningVoltage
;
75 static uint16_t batteryCriticalVoltage
;
76 static uint16_t batteryWarningHysteresisVoltage
;
77 static uint16_t batteryCriticalHysteresisVoltage
;
78 static lowVoltageCutoff_t lowVoltageCutoff
;
80 static currentMeter_t currentMeter
;
81 static voltageMeter_t voltageMeter
;
83 static batteryState_e batteryState
;
84 static batteryState_e voltageState
;
85 static batteryState_e consumptionState
;
86 static float wattHoursDrawn
;
88 #ifndef DEFAULT_CURRENT_METER_SOURCE
89 #ifdef USE_VIRTUAL_CURRENT_METER
90 #define DEFAULT_CURRENT_METER_SOURCE CURRENT_METER_VIRTUAL
92 #ifdef USE_MSP_CURRENT_METER
93 #define DEFAULT_CURRENT_METER_SOURCE CURRENT_METER_MSP
95 #define DEFAULT_CURRENT_METER_SOURCE CURRENT_METER_NONE
100 #ifndef DEFAULT_VOLTAGE_METER_SOURCE
101 #define DEFAULT_VOLTAGE_METER_SOURCE VOLTAGE_METER_NONE
104 PG_REGISTER_WITH_RESET_TEMPLATE(batteryConfig_t
, batteryConfig
, PG_BATTERY_CONFIG
, 3);
106 PG_RESET_TEMPLATE(batteryConfig_t
, batteryConfig
,
108 .vbatmaxcellvoltage
= VBAT_CELL_VOLTAGE_DEFAULT_MAX
,
109 .vbatmincellvoltage
= VBAT_CELL_VOLTAGE_DEFAULT_MIN
,
110 .vbatwarningcellvoltage
= 350,
111 .vbatnotpresentcellvoltage
= 300, //A cell below 3 will be ignored
112 .voltageMeterSource
= DEFAULT_VOLTAGE_METER_SOURCE
,
113 .lvcPercentage
= 100, //Off by default at 100%
116 .batteryCapacity
= 0,
117 .currentMeterSource
= DEFAULT_CURRENT_METER_SOURCE
,
120 .forceBatteryCellCount
= 0, //0 will be ignored
123 .useVBatAlerts
= true,
124 .useConsumptionAlerts
= false,
125 .consumptionWarningPercentage
= 10,
126 .vbathysteresis
= 1, // 0.01V
128 .vbatfullcellvoltage
= 410,
130 .vbatDisplayLpfPeriod
= 30,
131 .vbatSagLpfPeriod
= 2,
133 .vbatDurationForWarning
= 0,
134 .vbatDurationForCritical
= 0,
137 void batteryUpdateVoltage(timeUs_t currentTimeUs
)
139 UNUSED(currentTimeUs
);
141 switch (batteryConfig()->voltageMeterSource
) {
142 #ifdef USE_ESC_SENSOR
143 case VOLTAGE_METER_ESC
:
144 if (featureIsEnabled(FEATURE_ESC_SENSOR
)) {
145 voltageMeterESCRefresh();
146 voltageMeterESCReadCombined(&voltageMeter
);
150 case VOLTAGE_METER_ADC
:
151 voltageMeterADCRefresh();
152 voltageMeterADCRead(VOLTAGE_SENSOR_ADC_VBAT
, &voltageMeter
);
156 case VOLTAGE_METER_NONE
:
157 voltageMeterReset(&voltageMeter
);
161 DEBUG_SET(DEBUG_BATTERY
, 0, voltageMeter
.unfiltered
);
162 DEBUG_SET(DEBUG_BATTERY
, 1, voltageMeter
.displayFiltered
);
165 static void updateBatteryBeeperAlert(void)
167 switch (getBatteryState()) {
168 case BATTERY_WARNING
:
169 beeper(BEEPER_BAT_LOW
);
172 case BATTERY_CRITICAL
:
173 beeper(BEEPER_BAT_CRIT_LOW
);
177 case BATTERY_NOT_PRESENT
:
183 //TODO: make all of these independent of voltage filtering for display
185 static bool isVoltageStable(void)
187 return abs(voltageMeter
.displayFiltered
- voltageMeter
.unfiltered
) <= VBAT_STABLE_MAX_DELTA
;
190 static bool isVoltageFromBat(void)
192 // We want to disable battery getting detected around USB voltage or 0V
194 return (voltageMeter
.displayFiltered
>= batteryConfig()->vbatnotpresentcellvoltage
// Above ~0V
195 && voltageMeter
.displayFiltered
<= batteryConfig()->vbatmaxcellvoltage
) // 1s max cell voltage check
196 || voltageMeter
.displayFiltered
> batteryConfig()->vbatnotpresentcellvoltage
* 2; // USB voltage - 2s or more check
199 void batteryUpdatePresence(void)
202 if ((voltageState
== BATTERY_NOT_PRESENT
|| voltageState
== BATTERY_INIT
) && isVoltageFromBat() && isVoltageStable()) {
203 // Battery has just been connected - calculate cells, warning voltages and reset state
205 consumptionState
= voltageState
= BATTERY_OK
;
206 if (batteryConfig()->forceBatteryCellCount
!= 0) {
207 batteryCellCount
= batteryConfig()->forceBatteryCellCount
;
209 unsigned cells
= (voltageMeter
.displayFiltered
/ batteryConfig()->vbatmaxcellvoltage
) + 1;
210 if (cells
> MAX_AUTO_DETECT_CELL_COUNT
) {
211 // something is wrong, we expect MAX_CELL_COUNT cells maximum (and autodetection will be problematic at 6+ cells)
212 cells
= MAX_AUTO_DETECT_CELL_COUNT
;
214 batteryCellCount
= cells
;
216 if (!ARMING_FLAG(ARMED
)) {
217 changePidProfileFromCellCount(batteryCellCount
);
220 batteryWarningVoltage
= batteryCellCount
* batteryConfig()->vbatwarningcellvoltage
;
221 batteryCriticalVoltage
= batteryCellCount
* batteryConfig()->vbatmincellvoltage
;
222 batteryWarningHysteresisVoltage
= (batteryWarningVoltage
> batteryConfig()->vbathysteresis
) ? batteryWarningVoltage
- batteryConfig()->vbathysteresis
: 0;
223 batteryCriticalHysteresisVoltage
= (batteryCriticalVoltage
> batteryConfig()->vbathysteresis
) ? batteryCriticalVoltage
- batteryConfig()->vbathysteresis
: 0;
224 lowVoltageCutoff
.percentage
= 100;
225 lowVoltageCutoff
.startTime
= 0;
226 } else if (voltageState
!= BATTERY_NOT_PRESENT
&& isVoltageStable() && !isVoltageFromBat()) {
227 /* battery has been disconnected - can take a while for filter cap to disharge so we use a threshold of batteryConfig()->vbatnotpresentcellvoltage */
229 consumptionState
= voltageState
= BATTERY_NOT_PRESENT
;
231 batteryCellCount
= 0;
232 batteryWarningVoltage
= 0;
233 batteryCriticalVoltage
= 0;
234 batteryWarningHysteresisVoltage
= 0;
235 batteryCriticalHysteresisVoltage
= 0;
236 wattHoursDrawn
= 0.0;
240 void batteryUpdateWhDrawn(void)
242 static int32_t mAhDrawnPrev
= 0;
243 const int32_t mAhDrawnCurrent
= getMAhDrawn();
244 wattHoursDrawn
+= voltageMeter
.displayFiltered
* (mAhDrawnCurrent
- mAhDrawnPrev
) / 100000.0f
;
245 mAhDrawnPrev
= mAhDrawnCurrent
;
248 static void batteryUpdateVoltageState(void)
250 // alerts are currently used by beeper, osd and other subsystems
251 static uint32_t lastVoltageChangeMs
;
252 switch (voltageState
) {
254 if (voltageMeter
.displayFiltered
<= batteryWarningHysteresisVoltage
) {
255 if (cmp32(millis(), lastVoltageChangeMs
) >= batteryConfig()->vbatDurationForWarning
* 100) {
256 voltageState
= BATTERY_WARNING
;
259 lastVoltageChangeMs
= millis();
263 case BATTERY_WARNING
:
264 if (voltageMeter
.displayFiltered
<= batteryCriticalHysteresisVoltage
) {
265 if (cmp32(millis(), lastVoltageChangeMs
) >= batteryConfig()->vbatDurationForCritical
* 100) {
266 voltageState
= BATTERY_CRITICAL
;
269 if (voltageMeter
.displayFiltered
> batteryWarningVoltage
) {
270 voltageState
= BATTERY_OK
;
272 lastVoltageChangeMs
= millis();
276 case BATTERY_CRITICAL
:
277 if (voltageMeter
.displayFiltered
> batteryCriticalVoltage
) {
278 voltageState
= BATTERY_WARNING
;
279 lastVoltageChangeMs
= millis();
289 static void batteryUpdateLVC(timeUs_t currentTimeUs
)
291 if (batteryConfig()->lvcPercentage
< 100) {
292 if (voltageState
== BATTERY_CRITICAL
&& !lowVoltageCutoff
.enabled
) {
293 lowVoltageCutoff
.enabled
= true;
294 lowVoltageCutoff
.startTime
= currentTimeUs
;
295 lowVoltageCutoff
.percentage
= 100;
297 if (lowVoltageCutoff
.enabled
) {
298 if (cmp32(currentTimeUs
,lowVoltageCutoff
.startTime
) < LVC_AFFECT_TIME
) {
299 lowVoltageCutoff
.percentage
= 100 - (cmp32(currentTimeUs
,lowVoltageCutoff
.startTime
) * (100 - batteryConfig()->lvcPercentage
) / LVC_AFFECT_TIME
);
302 lowVoltageCutoff
.percentage
= batteryConfig()->lvcPercentage
;
309 static void batteryUpdateConsumptionState(void)
311 if (batteryConfig()->useConsumptionAlerts
&& batteryConfig()->batteryCapacity
> 0 && batteryCellCount
> 0) {
312 uint8_t batteryPercentageRemaining
= calculateBatteryPercentageRemaining();
314 if (batteryPercentageRemaining
== 0) {
315 consumptionState
= BATTERY_CRITICAL
;
316 } else if (batteryPercentageRemaining
<= batteryConfig()->consumptionWarningPercentage
) {
317 consumptionState
= BATTERY_WARNING
;
319 consumptionState
= BATTERY_OK
;
324 void batteryUpdateStates(timeUs_t currentTimeUs
)
326 batteryUpdateVoltageState();
327 batteryUpdateConsumptionState();
328 batteryUpdateLVC(currentTimeUs
);
329 batteryState
= MAX(voltageState
, consumptionState
);
330 batteryUpdateWhDrawn();
333 const lowVoltageCutoff_t
*getLowVoltageCutoff(void)
335 return &lowVoltageCutoff
;
338 batteryState_e
getBatteryState(void)
343 batteryState_e
getVoltageState(void)
348 batteryState_e
getConsumptionState(void)
350 return consumptionState
;
353 const char * const batteryStateStrings
[] = {"OK", "WARNING", "CRITICAL", "NOT PRESENT", "INIT"};
355 const char * getBatteryStateString(void)
357 return batteryStateStrings
[getBatteryState()];
360 void batteryInit(void)
365 batteryState
= BATTERY_INIT
;
366 batteryCellCount
= 0;
376 voltageState
= BATTERY_INIT
;
377 batteryWarningVoltage
= 0;
378 batteryCriticalVoltage
= 0;
379 batteryWarningHysteresisVoltage
= 0;
380 batteryCriticalHysteresisVoltage
= 0;
381 lowVoltageCutoff
.enabled
= false;
382 lowVoltageCutoff
.percentage
= 100;
383 lowVoltageCutoff
.startTime
= 0;
385 voltageMeterReset(&voltageMeter
);
387 voltageMeterGenericInit();
388 switch (batteryConfig()->voltageMeterSource
) {
389 case VOLTAGE_METER_ESC
:
390 #ifdef USE_ESC_SENSOR
391 voltageMeterESCInit();
395 case VOLTAGE_METER_ADC
:
396 voltageMeterADCInit();
406 consumptionState
= BATTERY_OK
;
407 currentMeterReset(¤tMeter
);
408 switch (batteryConfig()->currentMeterSource
) {
409 case CURRENT_METER_ADC
:
410 currentMeterADCInit();
413 case CURRENT_METER_VIRTUAL
:
414 #ifdef USE_VIRTUAL_CURRENT_METER
415 currentMeterVirtualInit();
419 case CURRENT_METER_ESC
:
421 currentMeterESCInit();
424 case CURRENT_METER_MSP
:
425 #ifdef USE_MSP_CURRENT_METER
426 currentMeterMSPInit();
435 void batteryUpdateCurrentMeter(timeUs_t currentTimeUs
)
437 if (batteryCellCount
== 0) {
438 currentMeterReset(¤tMeter
);
442 static uint32_t ibatLastServiced
= 0;
443 const int32_t lastUpdateAt
= cmp32(currentTimeUs
, ibatLastServiced
);
444 ibatLastServiced
= currentTimeUs
;
446 switch (batteryConfig()->currentMeterSource
) {
447 case CURRENT_METER_ADC
:
448 currentMeterADCRefresh(lastUpdateAt
);
449 currentMeterADCRead(¤tMeter
);
452 case CURRENT_METER_VIRTUAL
: {
453 #ifdef USE_VIRTUAL_CURRENT_METER
454 throttleStatus_e throttleStatus
= calculateThrottleStatus();
455 bool throttleLowAndMotorStop
= (throttleStatus
== THROTTLE_LOW
&& featureIsEnabled(FEATURE_MOTOR_STOP
));
456 const int32_t throttleOffset
= lrintf(mixerGetThrottle() * 1000);
458 currentMeterVirtualRefresh(lastUpdateAt
, ARMING_FLAG(ARMED
), throttleLowAndMotorStop
, throttleOffset
);
459 currentMeterVirtualRead(¤tMeter
);
464 case CURRENT_METER_ESC
:
465 #ifdef USE_ESC_SENSOR
466 if (featureIsEnabled(FEATURE_ESC_SENSOR
)) {
467 currentMeterESCRefresh(lastUpdateAt
);
468 currentMeterESCReadCombined(¤tMeter
);
472 case CURRENT_METER_MSP
:
473 #ifdef USE_MSP_CURRENT_METER
474 currentMeterMSPRefresh(currentTimeUs
);
475 currentMeterMSPRead(¤tMeter
);
480 case CURRENT_METER_NONE
:
481 currentMeterReset(¤tMeter
);
486 uint8_t calculateBatteryPercentageRemaining(void)
488 uint8_t batteryPercentage
= 0;
489 if (batteryCellCount
> 0) {
490 uint16_t batteryCapacity
= batteryConfig()->batteryCapacity
;
492 if (batteryCapacity
> 0) {
493 batteryPercentage
= constrain(((float)batteryCapacity
- currentMeter
.mAhDrawn
) * 100 / batteryCapacity
, 0, 100);
495 batteryPercentage
= constrain((((uint32_t)voltageMeter
.displayFiltered
- (batteryConfig()->vbatmincellvoltage
* batteryCellCount
)) * 100) / ((batteryConfig()->vbatmaxcellvoltage
- batteryConfig()->vbatmincellvoltage
) * batteryCellCount
), 0, 100);
499 return batteryPercentage
;
502 void batteryUpdateAlarms(void)
504 // use the state to trigger beeper alerts
505 if (batteryConfig()->useVBatAlerts
) {
506 updateBatteryBeeperAlert();
510 bool isBatteryVoltageConfigured(void)
512 return batteryConfig()->voltageMeterSource
!= VOLTAGE_METER_NONE
;
515 uint16_t getBatteryVoltage(void)
517 return voltageMeter
.displayFiltered
;
520 uint16_t getLegacyBatteryVoltage(void)
522 return (voltageMeter
.displayFiltered
+ 5) / 10;
525 uint16_t getBatteryVoltageLatest(void)
527 return voltageMeter
.unfiltered
;
530 uint8_t getBatteryCellCount(void)
532 return batteryCellCount
;
535 uint16_t getBatteryAverageCellVoltage(void)
537 return (batteryCellCount
? voltageMeter
.displayFiltered
/ batteryCellCount
: 0);
540 #if defined(USE_BATTERY_VOLTAGE_SAG_COMPENSATION)
541 uint16_t getBatterySagCellVoltage(void)
543 return (batteryCellCount
? voltageMeter
.sagFiltered
/ batteryCellCount
: 0);
547 bool isAmperageConfigured(void)
549 return batteryConfig()->currentMeterSource
!= CURRENT_METER_NONE
;
552 int32_t getAmperage(void)
554 return currentMeter
.amperage
;
557 int32_t getAmperageLatest(void)
559 return currentMeter
.amperageLatest
;
562 int32_t getMAhDrawn(void)
564 #ifdef USE_BATTERY_CONTINUE
565 return currentMeter
.mAhDrawn
+ currentMeter
.mAhDrawnOffset
;
567 return currentMeter
.mAhDrawn
;
571 #ifdef USE_BATTERY_CONTINUE
572 bool hasUsedMAh(void)
574 return batteryConfig()->isBatteryContinueEnabled
575 && !(ARMING_FLAG(ARMED
) || ARMING_FLAG(WAS_EVER_ARMED
)) && (getBatteryState() == BATTERY_OK
)
576 && getBatteryAverageCellVoltage() < batteryConfig()->vbatfullcellvoltage
577 && statsConfig()->stats_mah_used
> 0;
580 void setMAhDrawn(uint32_t mAhDrawn
)
582 currentMeter
.mAhDrawnOffset
= mAhDrawn
;
586 float getWhDrawn(void)
588 return wattHoursDrawn
;