| _air_density | EstimatorInterface | protected |
| _airspeed_buffer | EstimatorInterface | protected |
| _airspeed_buffer_fail | EstimatorInterface | protected |
| _airspeed_sample_delayed | EstimatorInterface | protected |
| _auxvel_buffer | EstimatorInterface | protected |
| _auxvel_buffer_fail | EstimatorInterface | protected |
| _auxvel_sample_delayed | EstimatorInterface | protected |
| _baro_buffer | EstimatorInterface | protected |
| _baro_buffer_fail | EstimatorInterface | protected |
| _baro_sample_delayed | EstimatorInterface | protected |
| _beta_test_ratio | EstimatorInterface | protected |
| _control_status | EstimatorInterface | protected |
| _control_status_prev | EstimatorInterface | protected |
| _deadreckon_time_exceeded | EstimatorInterface | protected |
| _delta_ang_prev | EstimatorInterface | protected |
| _delta_vel_prev | EstimatorInterface | protected |
| _drag_buffer | EstimatorInterface | protected |
| _drag_buffer_fail | EstimatorInterface | protected |
| _drag_down_sampled | EstimatorInterface | protected |
| _drag_sample_count | EstimatorInterface | protected |
| _drag_sample_delayed | EstimatorInterface | protected |
| _drag_sample_time_dt | EstimatorInterface | protected |
| _drag_test_ratio | EstimatorInterface | protected |
| _dt_imu_avg | EstimatorInterface | protected |
| _ev_buffer_fail | EstimatorInterface | protected |
| _ev_sample_delayed | EstimatorInterface | protected |
| _ext_vision_buffer | EstimatorInterface | protected |
| _fault_status | EstimatorInterface | protected |
| _flow_buffer | EstimatorInterface | protected |
| _flow_buffer_fail | EstimatorInterface | protected |
| _flow_max_distance | EstimatorInterface | protected |
| _flow_max_rate | EstimatorInterface | protected |
| _flow_min_distance | EstimatorInterface | protected |
| _flow_sample_delayed | EstimatorInterface | protected |
| _gps_alt_prev | EstimatorInterface | protected |
| _gps_buffer | EstimatorInterface | protected |
| _gps_buffer_fail | EstimatorInterface | protected |
| _gps_drift_metrics | EstimatorInterface | protected |
| _gps_drift_updated | EstimatorInterface | protected |
| _gps_origin_eph | EstimatorInterface | protected |
| _gps_origin_epv | EstimatorInterface | protected |
| _gps_sample_delayed | EstimatorInterface | protected |
| _gps_speed_valid | EstimatorInterface | protected |
| _gps_yaw_offset | EstimatorInterface | protected |
| _imu_buffer | EstimatorInterface | protected |
| _imu_buffer_length | EstimatorInterface | protected |
| _imu_sample_delayed | EstimatorInterface | protected |
| _imu_sample_new | EstimatorInterface | protected |
| _imu_updated | EstimatorInterface | protected |
| _initialised | EstimatorInterface | protected |
| _innov_check_fail_status | EstimatorInterface | protected |
| _is_dead_reckoning | EstimatorInterface | protected |
| _is_wind_dead_reckoning | EstimatorInterface | protected |
| _mag_buffer | EstimatorInterface | protected |
| _mag_buffer_fail | EstimatorInterface | protected |
| _mag_declination_gps | EstimatorInterface | protected |
| _mag_inclination_gps | EstimatorInterface | protected |
| _mag_sample_delayed | EstimatorInterface | protected |
| _mag_strength_gps | EstimatorInterface | protected |
| _mag_test_ratio | EstimatorInterface | protected |
| _min_obs_interval_us | EstimatorInterface | protected |
| _NED_origin_initialised | EstimatorInterface | protected |
| _obs_buffer_length | EstimatorInterface | protected |
| _output_buffer | EstimatorInterface | protected |
| _output_new | EstimatorInterface | protected |
| _output_sample_delayed | EstimatorInterface | protected |
| _output_vert_buffer | EstimatorInterface | protected |
| _output_vert_delayed | EstimatorInterface | protected |
| _output_vert_new | EstimatorInterface | protected |
| _params | EstimatorInterface | protected |
| _R_to_earth_now | EstimatorInterface | protected |
| _range_buffer | EstimatorInterface | protected |
| _range_buffer_fail | EstimatorInterface | protected |
| _range_sample_delayed | EstimatorInterface | protected |
| _rng_valid_max_val | EstimatorInterface | protected |
| _rng_valid_min_val | EstimatorInterface | protected |
| _tas_test_ratio | EstimatorInterface | protected |
| _terr_test_ratio | EstimatorInterface | protected |
| _time_last_airspeed | EstimatorInterface | protected |
| _time_last_auxvel | EstimatorInterface | protected |
| _time_last_baro | EstimatorInterface | protected |
| _time_last_ext_vision | EstimatorInterface | protected |
| _time_last_gnd_effect_on | EstimatorInterface | protected |
| _time_last_gps | EstimatorInterface | protected |
| _time_last_imu | EstimatorInterface | protected |
| _time_last_mag | EstimatorInterface | protected |
| _time_last_move_detect_us | EstimatorInterface | protected |
| _time_last_optflow | EstimatorInterface | protected |
| _time_last_range | EstimatorInterface | protected |
| _vehicle_at_rest | EstimatorInterface | protected |
| _vel_deriv_ned | EstimatorInterface | protected |
| _vel_imu_rel_body_ned | EstimatorInterface | protected |
| _vel_pos_test_ratio | EstimatorInterface | protected |
| _vibe_metrics | EstimatorInterface | protected |
| _yaw_test_ratio | EstimatorInterface | protected |
| AlphaFilterVector3f typedef | EstimatorInterface | |
| attitude_valid() | EstimatorInterface | inline |
| collect_gps(const gps_message &gps)=0 | EstimatorInterface | pure virtual |
| collect_imu(const imuSample &imu)=0 | EstimatorInterface | pure virtual |
| copy_timestamp(uint64_t *time_us) | EstimatorInterface | inline |
| cross_product(const Vector3f &vecIn1, const Vector3f &vecIn2) | EstimatorInterface | protected |
| EstimatorInterface()=default | EstimatorInterface | |
| FILTER_UPDATE_PERIOD_MS | EstimatorInterface | static |
| FILTER_UPDATE_PERIOD_S | EstimatorInterface | static |
| get_accel_bias(float bias[3])=0 | EstimatorInterface | pure virtual |
| get_airspeed_innov(float *airspeed_innov)=0 | EstimatorInterface | pure virtual |
| get_airspeed_innov_var(float *get_airspeed_innov_var)=0 | EstimatorInterface | pure virtual |
| get_aux_vel_innov(float aux_vel_innov[2])=0 | EstimatorInterface | pure virtual |
| get_baro_sample_delayed() | EstimatorInterface | inline |
| get_beta_innov(float *beta_innov)=0 | EstimatorInterface | pure virtual |
| get_beta_innov_var(float *get_beta_innov_var)=0 | EstimatorInterface | pure virtual |
| get_control_mode(uint32_t *val) | EstimatorInterface | inline |
| get_drag_innov(float drag_innov[2])=0 | EstimatorInterface | pure virtual |
| get_drag_innov_var(float drag_innov_var[2])=0 | EstimatorInterface | pure virtual |
| get_dt_imu_avg() const | EstimatorInterface | inline |
| get_ekf_ctrl_limits(float *vxy_max, float *vz_max, float *hagl_min, float *hagl_max)=0 | EstimatorInterface | pure virtual |
| get_ekf_gpos_accuracy(float *ekf_eph, float *ekf_epv)=0 | EstimatorInterface | pure virtual |
| get_ekf_lpos_accuracy(float *ekf_eph, float *ekf_epv)=0 | EstimatorInterface | pure virtual |
| get_ekf_origin(uint64_t *origin_time, map_projection_reference_s *origin_pos, float *origin_alt)=0 | EstimatorInterface | pure virtual |
| get_ekf_soln_status(uint16_t *status)=0 | EstimatorInterface | pure virtual |
| get_ekf_vel_accuracy(float *ekf_evh, float *ekf_evv)=0 | EstimatorInterface | pure virtual |
| get_ev2ekf_quaternion(float *quat)=0 | EstimatorInterface | pure virtual |
| get_filter_fault_status(uint16_t *val) | EstimatorInterface | inline |
| get_flow_innov(float flow_innov[2])=0 | EstimatorInterface | pure virtual |
| get_flow_innov_var(float flow_innov_var[2])=0 | EstimatorInterface | pure virtual |
| get_gps_check_status(uint16_t *val)=0 | EstimatorInterface | pure virtual |
| get_gps_drift_metrics(float drift[3], bool *blocked)=0 | EstimatorInterface | pure virtual |
| get_gyro_bias(float bias[3])=0 | EstimatorInterface | pure virtual |
| get_hagl_innov(float *hagl_innov) | EstimatorInterface | inline |
| get_hagl_innov_var(float *hagl_innov_var) | EstimatorInterface | inline |
| get_heading_innov(float *heading_innov)=0 | EstimatorInterface | pure virtual |
| get_heading_innov_var(float *heading_innov_var)=0 | EstimatorInterface | pure virtual |
| get_imu_sample_delayed() | EstimatorInterface | inline |
| get_imu_vibe_metrics(float vibe[3])=0 | EstimatorInterface | pure virtual |
| get_in_air_status() | EstimatorInterface | inline |
| get_innovation_test_status(uint16_t *status, float *mag, float *vel, float *pos, float *hgt, float *tas, float *hagl, float *beta)=0 | EstimatorInterface | pure virtual |
| get_mag_decl_deg(float *val) | EstimatorInterface | inline |
| get_mag_innov(float mag_innov[3])=0 | EstimatorInterface | pure virtual |
| get_mag_innov_var(float mag_innov_var[3])=0 | EstimatorInterface | pure virtual |
| get_output_tracking_error(float error[3])=0 | EstimatorInterface | pure virtual |
| get_pos_d_deriv(float *pos_d_deriv) | EstimatorInterface | inline |
| get_pos_var(Vector3f &pos_var)=0 | EstimatorInterface | pure virtual |
| get_posD_reset(float *delta, uint8_t *counter)=0 | EstimatorInterface | pure virtual |
| get_position(float *pos) | EstimatorInterface | inline |
| get_posNE_reset(float delta[2], uint8_t *counter)=0 | EstimatorInterface | pure virtual |
| get_quat_reset(float delta_quat[4], uint8_t *counter)=0 | EstimatorInterface | pure virtual |
| get_quaternion() const | EstimatorInterface | inline |
| get_state_delayed(float *state)=0 | EstimatorInterface | pure virtual |
| get_terrain_valid() | EstimatorInterface | inline |
| get_terrain_vert_pos(float *ret) | EstimatorInterface | inline |
| get_true_airspeed(float *tas)=0 | EstimatorInterface | pure virtual |
| get_vel_deriv_ned(float *vel_deriv) | EstimatorInterface | inline |
| get_vel_pos_innov(float vel_pos_innov[6])=0 | EstimatorInterface | pure virtual |
| get_vel_pos_innov_var(float vel_pos_innov_var[6])=0 | EstimatorInterface | pure virtual |
| get_vel_var(Vector3f &vel_var)=0 | EstimatorInterface | pure virtual |
| get_velD_reset(float *delta, uint8_t *counter)=0 | EstimatorInterface | pure virtual |
| get_velNE_reset(float delta[2], uint8_t *counter)=0 | EstimatorInterface | pure virtual |
| get_velocity(float *vel) | EstimatorInterface | inline |
| get_wind_status() | EstimatorInterface | inline |
| get_wind_velocity(float *wind)=0 | EstimatorInterface | pure virtual |
| get_wind_velocity_var(float *wind_var)=0 | EstimatorInterface | pure virtual |
| getHaglInnov(float *hagl_innov)=0 | EstimatorInterface | pure virtual |
| getHaglInnovVar(float *hagl_innov_var)=0 | EstimatorInterface | pure virtual |
| getParamHandle() | EstimatorInterface | inline |
| getTerrainVertPos(float *ret)=0 | EstimatorInterface | pure virtual |
| global_position_is_valid()=0 | EstimatorInterface | pure virtual |
| inertial_dead_reckoning() | EstimatorInterface | inline |
| init(uint64_t timestamp)=0 | EstimatorInterface | pure virtual |
| initialise_interface(uint64_t timestamp) | EstimatorInterface | protected |
| isTerrainEstimateValid() const =0 | EstimatorInterface | pure virtual |
| isVehicleAtRest() const | EstimatorInterface | inline |
| local_position_is_valid() | EstimatorInterface | |
| print_status() | EstimatorInterface | |
| quat_to_invrotmat(const Quatf &quat) | EstimatorInterface | protected |
| reset(uint64_t timestamp)=0 | EstimatorInterface | pure virtual |
| reset_imu_bias()=0 | EstimatorInterface | pure virtual |
| resetStates()=0 | EstimatorInterface | pure virtual |
| resetStatesAndCovariances()=0 | EstimatorInterface | pure virtual |
| set_air_density(float air_density) | EstimatorInterface | inline |
| set_fuse_beta_flag(bool fuse_beta) | EstimatorInterface | inline |
| set_gnd_effect_flag(bool gnd_effect) | EstimatorInterface | inline |
| set_in_air_status(bool in_air) | EstimatorInterface | inline |
| set_is_fixed_wing(bool is_fixed_wing) | EstimatorInterface | inline |
| set_optical_flow_limits(float max_flow_rate, float min_distance, float max_distance) | EstimatorInterface | inline |
| set_rangefinder_limits(float min_distance, float max_distance) | EstimatorInterface | inline |
| setAirspeedData(uint64_t time_usec, float true_airspeed, float eas2tas) | EstimatorInterface | |
| setAuxVelData(uint64_t time_usec, float(&data)[2], float(&variance)[2]) | EstimatorInterface | |
| setBaroData(uint64_t time_usec, float data) | EstimatorInterface | |
| setExtVisionData(uint64_t time_usec, ext_vision_message *evdata) | EstimatorInterface | |
| setGpsData(uint64_t time_usec, const gps_message &gps) | EstimatorInterface | |
| setIMUData(const imuSample &imu_sample) | EstimatorInterface | |
| setIMUData(uint64_t time_usec, uint64_t delta_ang_dt, uint64_t delta_vel_dt, float(&delta_ang)[3], float(&delta_vel)[3]) | EstimatorInterface | |
| setMagData(uint64_t time_usec, float(&data)[3]) | EstimatorInterface | |
| setOpticalFlowData(uint64_t time_usec, flow_message *flow) | EstimatorInterface | |
| setRangeData(uint64_t time_usec, float data, int8_t quality) | EstimatorInterface | |
| unallocate_buffers() | EstimatorInterface | protected |
| update()=0 | EstimatorInterface | pure virtual |
| ~EstimatorInterface()=default | EstimatorInterface | virtual |