ardupilot/libraries/AC_AttitudeControl/ControlMonitor.cpp
Peter Barker c1e776fc46 AC_AttitudeControl: stop libraries including AP_Logger.h in .h files
AP_Logger.h is a nexus of includes; while this is being improved over
time, there's no reason for the library headers to include AP_Logger.h
as the logger itself is access by singleton and the structures are in
LogStructure.h

This necessitated moving The PID_Info structure out of AP_Logger's
namespace.  This cleans up a pretty nasty bit - that structure is
definitely not simply used for logging, but also used to pass pid
information around to controllers!

There are a lot of patches in here because AP_Logger.h, acting as a
nexus, was providing transitive header file inclusion in many (some
unlikely!) places.
2022-04-08 19:18:38 +10:00

118 lines
3.8 KiB
C++

#include "AC_AttitudeControl.h"
#include <AP_HAL/AP_HAL.h>
#include <AP_Math/AP_Math.h>
#include <AP_Logger/AP_Logger.h>
/*
code to monitor and report on the rate controllers, allowing for
notification of controller oscillation
*/
/*
update a RMS estimate of controller state
*/
void AC_AttitudeControl::control_monitor_filter_pid(float value, float &rms)
{
const float filter_constant = 0.99f;
// we don't do the sqrt() here as it is quite expensive. That is
// done when reporting a result
rms = filter_constant * rms + (1.0f - filter_constant) * sq(value);
}
/*
update state in _control_monitor
*/
void AC_AttitudeControl::control_monitor_update(void)
{
const AP_PIDInfo &iroll = get_rate_roll_pid().get_pid_info();
control_monitor_filter_pid(iroll.P + iroll.FF, _control_monitor.rms_roll_P);
control_monitor_filter_pid(iroll.D, _control_monitor.rms_roll_D);
const AP_PIDInfo &ipitch = get_rate_pitch_pid().get_pid_info();
control_monitor_filter_pid(ipitch.P + ipitch.FF, _control_monitor.rms_pitch_P);
control_monitor_filter_pid(ipitch.D, _control_monitor.rms_pitch_D);
const AP_PIDInfo &iyaw = get_rate_yaw_pid().get_pid_info();
control_monitor_filter_pid(iyaw.P + iyaw.D + iyaw.FF, _control_monitor.rms_yaw);
}
/*
log a CRTL message
*/
void AC_AttitudeControl::control_monitor_log(void) const
{
// @LoggerMessage: CTRL
// @Description: Attitude Control oscillation monitor diagnostics
// @Field: TimeUS: Time since system startup
// @Field: RMSRollP: LPF Root-Mean-Squared Roll Rate controller P gain
// @Field: RMSRollD: LPF Root-Mean-Squared Roll rate controller D gain
// @Field: RMSPitchP: LPF Root-Mean-Squared Pitch Rate controller P gain
// @Field: RMSPitchD: LPF Root-Mean-Squared Pitch Rate controller D gain
// @Field: RMSYaw: LPF Root-Mean-Squared Yaw Rate controller P+D gain
AP::logger().WriteStreaming("CTRL", "TimeUS,RMSRollP,RMSRollD,RMSPitchP,RMSPitchD,RMSYaw", "Qfffff",
AP_HAL::micros64(),
(double)safe_sqrt(_control_monitor.rms_roll_P),
(double)safe_sqrt(_control_monitor.rms_roll_D),
(double)safe_sqrt(_control_monitor.rms_pitch_P),
(double)safe_sqrt(_control_monitor.rms_pitch_D),
(double)safe_sqrt(_control_monitor.rms_yaw));
}
/*
return current controller RMS filter value for roll
*/
float AC_AttitudeControl::control_monitor_rms_output_roll(void) const
{
return safe_sqrt(_control_monitor.rms_roll_P + _control_monitor.rms_roll_D);
}
/*
return current controller RMS filter value for roll_P
*/
float AC_AttitudeControl::control_monitor_rms_output_roll_P(void) const
{
return safe_sqrt(_control_monitor.rms_roll_P);
}
/*
return current controller RMS filter value for roll_D
*/
float AC_AttitudeControl::control_monitor_rms_output_roll_D(void) const
{
return safe_sqrt(_control_monitor.rms_roll_D);
}
/*
return current controller RMS filter value for pitch
*/
float AC_AttitudeControl::control_monitor_rms_output_pitch(void) const
{
return safe_sqrt(_control_monitor.rms_pitch_P + _control_monitor.rms_pitch_D);
}
/*
return current controller RMS filter value for pitch_P
*/
float AC_AttitudeControl::control_monitor_rms_output_pitch_P(void) const
{
return safe_sqrt(_control_monitor.rms_pitch_P);
}
/*
return current controller RMS filter value for pitch_D
*/
float AC_AttitudeControl::control_monitor_rms_output_pitch_D(void) const
{
return safe_sqrt(_control_monitor.rms_pitch_D);
}
/*
return current controller RMS filter value for yaw
*/
float AC_AttitudeControl::control_monitor_rms_output_yaw(void) const
{
return safe_sqrt(_control_monitor.rms_yaw);
}