ardupilot/libraries/PID/PID.cpp

116 lines
2.8 KiB
C++
Raw Normal View History

// -*- tab-width: 4; Mode: C++; c-basic-offset: 4; indent-tabs-mode: t -*-
/// @file PID.cpp
/// @brief Generic PID algorithm
#include <math.h>
#include "PID.h"
2012-11-30 23:35:01 -04:00
#include <AP_HAL.h>
extern const AP_HAL::HAL& hal;
2012-02-11 07:54:10 -04:00
const AP_Param::GroupInfo PID::var_info[] PROGMEM = {
2012-08-17 03:22:43 -03:00
AP_GROUPINFO("P", 0, PID, _kp, 0),
AP_GROUPINFO("I", 1, PID, _ki, 0),
AP_GROUPINFO("D", 2, PID, _kd, 0),
AP_GROUPINFO("IMAX", 3, PID, _imax, 0),
AP_GROUPEND
2012-02-11 07:54:10 -04:00
};
2012-11-30 23:35:01 -04:00
int32_t PID::get_pid(int32_t error, float scaler)
{
2012-11-30 23:35:01 -04:00
uint32_t tnow = hal.scheduler->millis();
2012-08-17 03:22:43 -03:00
uint32_t dt = tnow - _last_t;
float output = 0;
float delta_time;
if (_last_t == 0 || dt > 1000) {
dt = 0;
// if this PID hasn't been used for a full second then zero
// the intergator term. This prevents I buildup from a
// previous fight mode from causing a massive return before
// the integrator gets a chance to correct itself
reset_I();
2012-08-17 03:22:43 -03:00
}
_last_t = tnow;
delta_time = (float)dt / 1000.0;
// Compute proportional component
output += error * _kp;
// Compute derivative component if time has elapsed
if ((fabs(_kd) > 0) && (dt > 0)) {
float derivative;
if (isnan(_last_derivative)) {
// we've just done a reset, suppress the first derivative
// term as we don't want a sudden change in input to cause
// a large D output change
derivative = 0;
_last_derivative = 0;
} else {
derivative = (error - _last_error) / delta_time;
}
2012-08-17 03:22:43 -03:00
// discrete low pass filter, cuts out the
// high frequency noise that can drive the controller crazy
float RC = 1/(2*M_PI*_fCut);
derivative = _last_derivative +
2012-11-30 23:35:01 -04:00
((delta_time / (RC + delta_time)) *
(derivative - _last_derivative));
2012-08-17 03:22:43 -03:00
// update state
_last_error = error;
_last_derivative = derivative;
// add in derivative component
output += _kd * derivative;
}
// scale the P and D components
output *= scaler;
// Compute integral component if time has elapsed
if ((fabs(_ki) > 0) && (dt > 0)) {
_integrator += (error * _ki) * scaler * delta_time;
if (_integrator < -_imax) {
_integrator = -_imax;
} else if (_integrator > _imax) {
_integrator = _imax;
}
output += _integrator;
}
return output;
}
void
PID::reset_I()
{
2012-08-17 03:22:43 -03:00
_integrator = 0;
// we use NAN (Not A Number) to indicate that the last
// derivative value is not valid
_last_derivative = NAN;
}
void
PID::load_gains()
{
2012-08-17 03:22:43 -03:00
_kp.load();
_ki.load();
_kd.load();
_imax.load();
}
void
PID::save_gains()
{
2012-08-17 03:22:43 -03:00
_kp.save();
_ki.save();
_kd.save();
_imax.save();
}