2014-10-14 01:48:33 -03:00
/*
This program is free software : you can redistribute it and / or modify
it under the terms of the GNU General Public License as published by
the Free Software Foundation , either version 3 of the License , or
( at your option ) any later version .
This program is distributed in the hope that it will be useful ,
but WITHOUT ANY WARRANTY ; without even the implied warranty of
MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE . See the
GNU General Public License for more details .
You should have received a copy of the GNU General Public License
along with this program . If not , see < http : //www.gnu.org/licenses/>.
*/
/*
2014-10-15 23:31:21 -03:00
IMU driver backend class . Each supported gyro / accel sensor type
needs to have an object derived from this class .
Note that drivers can implement just gyros or just accels , and can
also provide multiple gyro / accel instances .
2014-10-14 01:48:33 -03:00
*/
2016-01-19 21:26:31 -04:00
# pragma once
# include <inttypes.h>
# include <AP_Math/AP_Math.h>
2020-12-28 22:29:40 -04:00
# include <AP_ExternalAHRS/AP_ExternalAHRS.h>
2016-01-19 21:26:31 -04:00
# include "AP_InertialSensor.h"
2014-10-14 01:48:33 -03:00
2023-09-20 14:42:17 -03:00
# ifndef HAL_INS_HIGHRES_SAMPLE
# define HAL_INS_HIGHRES_SAMPLE 0
# endif
2015-08-05 13:36:14 -03:00
class AuxiliaryBus ;
2019-01-18 00:23:42 -04:00
class AP_Logger ;
2015-08-05 13:36:14 -03:00
2014-10-14 01:48:33 -03:00
class AP_InertialSensor_Backend
{
public :
2014-10-15 05:54:30 -03:00
AP_InertialSensor_Backend ( AP_InertialSensor & imu ) ;
2015-10-01 20:04:04 -03:00
AP_InertialSensor_Backend ( const AP_InertialSensor_Backend & that ) = delete ;
2014-10-14 01:48:33 -03:00
// we declare a virtual destructor so that drivers can
// override with a custom destructor if need be.
virtual ~ AP_InertialSensor_Backend ( void ) { }
2016-01-19 21:26:31 -04:00
/*
2014-10-14 01:48:33 -03:00
* Update the sensor data . Called by the frontend to transfer
2014-10-15 20:32:40 -03:00
* accumulated sensor readings to the frontend structure via the
2015-02-17 02:50:59 -04:00
* _publish_gyro ( ) and _publish_accel ( ) functions
2014-10-14 01:48:33 -03:00
*/
2021-09-14 17:28:20 -03:00
virtual bool update ( ) = 0 ; /* front end */
2014-10-14 01:48:33 -03:00
2015-11-15 20:38:43 -04:00
/*
* optional function to accumulate more samples . This is needed for drivers that don ' t use a timer to gather samples
2014-10-14 01:48:33 -03:00
*/
2015-11-15 20:38:43 -04:00
virtual void accumulate ( ) { }
2014-10-14 01:48:33 -03:00
2015-08-05 10:01:52 -03:00
/*
* Configure and start all sensors . The empty implementation allows
* subclasses to already start the sensors when it ' s detected
*/
virtual void start ( ) { }
2015-08-05 13:36:14 -03:00
/*
* Return an AuxiliaryBus if backend has another bus it is able to export
*/
2015-10-02 15:02:16 -03:00
virtual AuxiliaryBus * get_auxiliary_bus ( ) { return nullptr ; }
2015-08-05 13:36:14 -03:00
2016-09-03 17:20:19 -03:00
/*
* Return the unique identifier for this backend : it ' s the same for
* several sensors if the backend registers more gyros / accels
*/
2015-08-16 16:16:11 -03:00
int16_t get_id ( ) const { return _id ; }
2019-03-11 09:56:40 -03:00
//Returns the Clip Limit
float get_clip_limit ( ) const { return _clip_limit ; }
2020-05-21 15:29:28 -03:00
// get a startup banner to output to the GCS
virtual bool get_output_banner ( char * banner , uint8_t banner_len ) { return false ; }
2020-12-28 22:29:40 -04:00
# if HAL_EXTERNAL_AHRS_ENABLED
virtual void handle_external ( const AP_ExternalAHRS : : ins_data_message_t & pkt ) { }
# endif
2016-11-04 21:11:00 -03:00
/*
device driver IDs . These are used to fill in the devtype field
of the device ID , which shows up as INS * ID * parameters to
users . The values are chosen for compatibility with existing PX4
drivers .
If a change is made to a driver that would make existing
calibration values invalid then this number must be changed .
*/
enum DevTypes {
DEVTYPE_BMI160 = 0x09 ,
DEVTYPE_L3G4200D = 0x10 ,
DEVTYPE_ACC_LSM303D = 0x11 ,
DEVTYPE_ACC_BMA180 = 0x12 ,
DEVTYPE_ACC_MPU6000 = 0x13 ,
DEVTYPE_ACC_MPU9250 = 0x16 ,
2017-10-30 06:03:04 -03:00
DEVTYPE_ACC_IIS328DQ = 0x17 ,
2017-10-26 11:31:07 -03:00
DEVTYPE_ACC_LSM9DS1 = 0x18 ,
2016-11-04 21:11:00 -03:00
DEVTYPE_GYR_MPU6000 = 0x21 ,
DEVTYPE_GYR_L3GD20 = 0x22 ,
2017-10-30 06:03:04 -03:00
DEVTYPE_GYR_MPU9250 = 0x24 ,
DEVTYPE_GYR_I3G4250D = 0x25 ,
2017-10-26 11:31:07 -03:00
DEVTYPE_GYR_LSM9DS1 = 0x26 ,
2018-04-10 08:08:52 -03:00
DEVTYPE_INS_ICM20789 = 0x27 ,
DEVTYPE_INS_ICM20689 = 0x28 ,
2018-06-07 02:59:18 -03:00
DEVTYPE_INS_BMI055 = 0x29 ,
2018-06-27 00:31:23 -03:00
DEVTYPE_SITL = 0x2A ,
2019-01-31 03:00:34 -04:00
DEVTYPE_INS_BMI088 = 0x2B ,
2019-02-15 08:12:45 -04:00
DEVTYPE_INS_ICM20948 = 0x2C ,
DEVTYPE_INS_ICM20648 = 0x2D ,
2019-03-10 21:15:37 -03:00
DEVTYPE_INS_ICM20649 = 0x2E ,
DEVTYPE_INS_ICM20602 = 0x2F ,
2019-03-25 15:25:33 -03:00
DEVTYPE_INS_ICM20601 = 0x30 ,
2020-04-05 04:19:00 -03:00
DEVTYPE_INS_ADIS1647X = 0x31 ,
2020-12-28 22:29:40 -04:00
DEVTYPE_SERIAL = 0x32 ,
2021-01-06 23:34:38 -04:00
DEVTYPE_INS_ICM40609 = 0x33 ,
DEVTYPE_INS_ICM42688 = 0x34 ,
DEVTYPE_INS_ICM42605 = 0x35 ,
2021-12-13 00:43:51 -04:00
DEVTYPE_INS_ICM40605 = 0x36 ,
DEVTYPE_INS_IIM42652 = 0x37 ,
2021-12-28 13:43:48 -04:00
DEVTYPE_BMI270 = 0x38 ,
2022-03-22 06:22:17 -03:00
DEVTYPE_INS_BMI085 = 0x39 ,
2022-07-19 21:45:59 -03:00
DEVTYPE_INS_ICM42670 = 0x3A ,
2022-10-25 21:35:55 -03:00
DEVTYPE_INS_ICM45686 = 0x3B ,
2023-05-08 03:50:37 -03:00
DEVTYPE_INS_SCHA63T = 0x3C ,
2016-11-04 21:11:00 -03:00
} ;
2018-03-18 20:28:33 -03:00
2014-10-14 01:48:33 -03:00
protected :
2014-10-15 20:32:40 -03:00
// access to frontend
AP_InertialSensor & _imu ;
2014-10-14 01:48:33 -03:00
2016-11-03 21:06:19 -03:00
// semaphore for access to shared frontend data
2020-01-18 17:57:26 -04:00
HAL_Semaphore _sem ;
2016-11-03 21:06:19 -03:00
2019-03-11 09:56:40 -03:00
//Default Clip Limit
float _clip_limit = 15.5f * GRAVITY_MSS ;
2024-06-20 17:09:05 -03:00
// instance numbers of accel and gyro data
uint8_t gyro_instance ;
uint8_t accel_instance ;
2021-09-14 17:28:20 -03:00
void _rotate_and_correct_accel ( uint8_t instance , Vector3f & accel ) __RAMFUNC__ ;
void _rotate_and_correct_gyro ( uint8_t instance , Vector3f & gyro ) __RAMFUNC__ ;
2015-02-17 02:54:17 -04:00
2015-02-17 02:50:59 -04:00
// rotate gyro vector, offset and publish
2022-04-01 16:59:10 -03:00
void _publish_gyro ( uint8_t instance , const Vector3f & gyro ) __RAMFUNC__ ; /* front end */
2015-02-17 02:50:59 -04:00
2022-09-22 11:35:48 -03:00
// apply notch and lowpass gyro filters and sample for FFT
2022-02-17 01:43:09 -04:00
void apply_gyro_filters ( const uint8_t instance , const Vector3f & gyro ) ;
2022-09-22 11:35:48 -03:00
void save_gyro_window ( const uint8_t instance , const Vector3f & gyro , uint8_t phase ) ;
2022-02-17 01:43:09 -04:00
2017-04-30 21:53:41 -03:00
// this should be called every time a new gyro raw sample is
// available - be it published or not the sample is raw in the
// sense that it's not filtered yet, but it must be rotated and
// corrected (_rotate_and_correct_gyro)
// The sample_us value must be provided for non-FIFO based
// sensors, and should be set to zero for FIFO based sensors
2021-09-14 17:28:20 -03:00
void _notify_new_gyro_raw_sample ( uint8_t instance , const Vector3f & accel , uint64_t sample_us = 0 ) __RAMFUNC__ ;
2015-09-08 14:05:37 -03:00
2021-12-13 22:44:21 -04:00
// alternative interface using delta-angles. Rotation and correction is handled inside this function
void _notify_new_delta_angle ( uint8_t instance , const Vector3f & dangle ) ;
2015-02-17 02:50:59 -04:00
// rotate accel vector, scale, offset and publish
2022-04-01 16:59:10 -03:00
void _publish_accel ( uint8_t instance , const Vector3f & accel ) __RAMFUNC__ ; /* front end */
2014-10-14 01:48:33 -03:00
2015-08-27 16:05:13 -03:00
// this should be called every time a new accel raw sample is available -
// be it published or not
// the sample is raw in the sense that it's not filtered yet, but it must
// be rotated and corrected (_rotate_and_correct_accel)
2017-04-30 21:53:41 -03:00
// The sample_us value must be provided for non-FIFO based
// sensors, and should be set to zero for FIFO based sensors
2021-09-14 17:28:20 -03:00
void _notify_new_accel_raw_sample ( uint8_t instance , const Vector3f & accel , uint64_t sample_us = 0 , bool fsync_set = false ) __RAMFUNC__ ;
2015-08-27 16:05:13 -03:00
2021-12-13 22:44:21 -04:00
// alternative interface using delta-velocities. Rotation and correction is handled inside this function
void _notify_new_delta_velocity ( uint8_t instance , const Vector3f & dvelocity ) ;
2017-05-01 00:01:43 -03:00
// set the amount of oversamping a accel is doing
void _set_accel_oversampling ( uint8_t instance , uint8_t n ) ;
// set the amount of oversamping a gyro is doing
void _set_gyro_oversampling ( uint8_t instance , uint8_t n ) ;
2018-03-18 20:28:33 -03:00
// indicate the backend is doing sensor-rate sampling for this accel
void _set_accel_sensor_rate_sampling_enabled ( uint8_t instance , bool value ) {
const uint8_t bit = ( 1 < < instance ) ;
if ( value ) {
_imu . _accel_sensor_rate_sampling_enabled | = bit ;
} else {
_imu . _accel_sensor_rate_sampling_enabled & = ~ bit ;
}
}
void _set_gyro_sensor_rate_sampling_enabled ( uint8_t instance , bool value ) {
const uint8_t bit = ( 1 < < instance ) ;
if ( value ) {
_imu . _gyro_sensor_rate_sampling_enabled | = bit ;
} else {
_imu . _gyro_sensor_rate_sampling_enabled & = ~ bit ;
}
}
void _set_raw_sample_accel_multiplier ( uint8_t instance , uint16_t mul ) {
_imu . _accel_raw_sampling_multiplier [ instance ] = mul ;
}
2019-07-23 05:43:18 -03:00
void _set_raw_sample_gyro_multiplier ( uint8_t instance , uint16_t mul ) {
2018-03-18 20:28:33 -03:00
_imu . _gyro_raw_sampling_multiplier [ instance ] = mul ;
}
2017-04-30 21:53:41 -03:00
// update the sensor rate for FIFO sensors
2021-09-14 17:28:20 -03:00
void _update_sensor_rate ( uint16_t & count , uint32_t & start_us , float & rate_hz ) const __RAMFUNC__ ;
2019-06-17 05:44:12 -03:00
2019-08-30 04:33:42 -03:00
// return true if the sensors are still converging and sampling rates could change significantly
2022-04-15 04:38:56 -03:00
bool sensors_converging ( ) const { return AP_HAL : : millis ( ) < HAL_INS_CONVERGANCE_MS ; }
2019-08-30 04:33:42 -03:00
2015-06-09 17:47:16 -03:00
// set accelerometer max absolute offset for calibration
2015-06-29 21:51:43 -03:00
void _set_accel_max_abs_offset ( uint8_t instance , float offset ) ;
2015-06-09 17:47:16 -03:00
2019-04-04 02:00:04 -03:00
// get accelerometer raw sample rate.
float _accel_raw_sample_rate ( uint8_t instance ) const {
AP_InertialSensor: use raw sample rate terminology
In order to avoid confusion between sample rate from sensor and sample rate
from the frontend class (AP_InertialSensor), use "raw sample rate" to refer to
the former.
The changes in the code were basically done with the following commands:
git grep -wl _accel_sample_rates | xargs sed -i "s,\<_accel_sample_rates\>,_accel_raw_sample_rates,g"
git grep -wl _set_accel_sample_rate | xargs sed -i "s,\<_set_accel_sample_rate\>,_set_accel_raw_sample_rate,g"
git grep -wl _accel_sample_rate | xargs sed -i "s,\<_accel_sample_rate\>,_accel_raw_sample_rate,g"
git grep -wl _gyro_sample_rates | xargs sed -i "s,\<_gyro_sample_rates\>,_gyro_raw_sample_rates,g"
git grep -wl _set_gyro_sample_rate | xargs sed -i "s,\<_set_gyro_sample_rate\>,_set_gyro_raw_sample_rate,g"
git grep -wl _gyro_sample_rate | xargs sed -i "s,\<_gyro_sample_rate\>,_gyro_raw_sample_rate,g"
And also with minor changes on indentation and comments.
2015-09-10 09:56:28 -03:00
return _imu . _accel_raw_sample_rates [ instance ] ;
2015-08-03 16:22:41 -03:00
}
2019-04-04 02:00:04 -03:00
// set accelerometer raw sample rate; note that the storage type
// is actually float!
2018-01-17 03:17:33 -04:00
void _set_accel_raw_sample_rate ( uint8_t instance , uint16_t rate_hz ) {
_imu . _accel_raw_sample_rates [ instance ] = rate_hz ;
}
2015-11-15 20:05:20 -04:00
// get gyroscope raw sample rate
2019-04-04 02:00:04 -03:00
float _gyro_raw_sample_rate ( uint8_t instance ) const {
AP_InertialSensor: use raw sample rate terminology
In order to avoid confusion between sample rate from sensor and sample rate
from the frontend class (AP_InertialSensor), use "raw sample rate" to refer to
the former.
The changes in the code were basically done with the following commands:
git grep -wl _accel_sample_rates | xargs sed -i "s,\<_accel_sample_rates\>,_accel_raw_sample_rates,g"
git grep -wl _set_accel_sample_rate | xargs sed -i "s,\<_set_accel_sample_rate\>,_set_accel_raw_sample_rate,g"
git grep -wl _accel_sample_rate | xargs sed -i "s,\<_accel_sample_rate\>,_accel_raw_sample_rate,g"
git grep -wl _gyro_sample_rates | xargs sed -i "s,\<_gyro_sample_rates\>,_gyro_raw_sample_rates,g"
git grep -wl _set_gyro_sample_rate | xargs sed -i "s,\<_set_gyro_sample_rate\>,_set_gyro_raw_sample_rate,g"
git grep -wl _gyro_sample_rate | xargs sed -i "s,\<_gyro_sample_rate\>,_gyro_raw_sample_rate,g"
And also with minor changes on indentation and comments.
2015-09-10 09:56:28 -03:00
return _imu . _gyro_raw_sample_rates [ instance ] ;
2015-09-10 08:56:34 -03:00
}
2019-04-04 02:00:04 -03:00
// set gyro raw sample rate; note that the storage type is
// actually float!
2018-01-17 03:17:33 -04:00
void _set_gyro_raw_sample_rate ( uint8_t instance , uint16_t rate_hz ) {
_imu . _gyro_raw_sample_rates [ instance ] = rate_hz ;
}
2015-03-16 23:32:54 -03:00
// publish a temperature value
2021-09-14 17:28:20 -03:00
void _publish_temperature ( uint8_t instance , float temperature ) ; /* front end */
2015-03-16 23:32:54 -03:00
2016-11-10 02:14:38 -04:00
// increment accelerometer error_count
2021-09-14 17:28:20 -03:00
void _inc_accel_error_count ( uint8_t instance ) __RAMFUNC__ ;
2016-11-10 02:14:38 -04:00
// increment gyro error_count
2021-09-14 17:28:20 -03:00
void _inc_gyro_error_count ( uint8_t instance ) __RAMFUNC__ ;
2016-11-10 02:14:38 -04:00
2015-08-16 16:16:11 -03:00
// backend unique identifier or -1 if backend doesn't identify itself
int16_t _id = - 1 ;
2014-10-16 17:52:21 -03:00
// return the default filter frequency in Hz for the sample rate
2019-05-25 07:59:57 -03:00
uint16_t _accel_filter_cutoff ( void ) const { return _imu . _accel_filter_cutoff ; }
2015-03-11 21:58:36 -03:00
// return the default filter frequency in Hz for the sample rate
2019-05-25 07:59:57 -03:00
uint16_t _gyro_filter_cutoff ( void ) const { return _imu . _gyro_filter_cutoff ; }
2014-10-16 17:52:21 -03:00
2021-09-14 17:28:20 -03:00
// return the requested loop rate at which samples will be made available in Hz
uint16_t get_loop_rate_hz ( void ) const {
// enum can be directly cast to Hz
return ( uint16_t ) _imu . _loop_rate ;
}
2015-03-11 20:02:36 -03:00
2015-11-15 20:05:20 -04:00
// common gyro update function for all backends
2022-04-01 16:59:10 -03:00
void update_gyro ( uint8_t instance ) __RAMFUNC__ ; /* front end */
2015-11-15 20:05:20 -04:00
// common accel update function for all backends
2022-04-01 16:59:10 -03:00
void update_accel ( uint8_t instance ) __RAMFUNC__ ; /* front end */
2016-01-19 21:26:31 -04:00
2015-11-15 20:05:20 -04:00
// support for updating filter at runtime
2019-06-17 05:44:12 -03:00
uint16_t _last_accel_filter_hz ;
uint16_t _last_gyro_filter_hz ;
2016-11-03 06:19:04 -03:00
void set_gyro_orientation ( uint8_t instance , enum Rotation rotation ) {
_imu . _gyro_orientation [ instance ] = rotation ;
}
void set_accel_orientation ( uint8_t instance , enum Rotation rotation ) {
_imu . _accel_orientation [ instance ] = rotation ;
}
2016-11-09 22:39:17 -04:00
2024-06-20 17:09:05 -03:00
uint8_t get_gyro_instance ( ) const {
return gyro_instance ;
}
uint8_t get_accel_instance ( ) const {
return accel_instance ;
}
2016-11-09 22:39:17 -04:00
// increment clipping counted. Used by drivers that do decimation before supplying
// samples to the frontend
void increment_clip_count ( uint8_t instance ) {
_imu . _accel_clip_count [ instance ] + + ;
}
2016-11-15 01:51:18 -04:00
// should fast sampling be enabled on this IMU?
2023-09-20 14:42:17 -03:00
bool enable_fast_sampling ( uint8_t instance ) const {
2016-11-15 01:51:18 -04:00
return ( _imu . _fast_sampling_mask & ( 1U < < instance ) ) ! = 0 ;
}
2017-04-30 21:53:41 -03:00
2023-09-20 14:42:17 -03:00
// should highres sampling be enabled on this IMU?
bool enable_highres_sampling ( uint8_t instance ) const {
return ( HAL_INS_HIGHRES_SAMPLE & ( 1U < < instance ) ) ! = 0 ;
}
2020-05-21 15:29:28 -03:00
// if fast sampling is enabled, the rate to use in kHz
2022-11-07 12:23:36 -04:00
uint8_t get_fast_sampling_rate ( ) const {
2020-05-21 15:29:28 -03:00
return ( 1 < < uint8_t ( _imu . _fast_sampling_rate ) ) ;
}
2018-03-18 20:28:33 -03:00
// called by subclass when data is received from the sensor, thus
// at the 'sensor rate'
2021-09-14 17:28:20 -03:00
void _notify_new_accel_sensor_rate_sample ( uint8_t instance , const Vector3f & accel ) __RAMFUNC__ ;
void _notify_new_gyro_sensor_rate_sample ( uint8_t instance , const Vector3f & gyro ) __RAMFUNC__ ;
2018-03-07 04:09:15 -04:00
2017-04-30 21:53:41 -03:00
/*
notify of a FIFO reset so we don ' t use bad data to update observed sensor rate
*/
2021-09-14 17:28:20 -03:00
void notify_accel_fifo_reset ( uint8_t instance ) __RAMFUNC__ ;
void notify_gyro_fifo_reset ( uint8_t instance ) __RAMFUNC__ ;
2023-07-13 21:58:06 -03:00
2021-02-23 19:32:39 -04:00
// log an unexpected change in a register for an IMU
2021-09-14 17:28:20 -03:00
void log_register_change ( uint32_t bus_id , const AP_HAL : : Device : : checkreg & reg ) __RAMFUNC__ ;
2021-02-23 19:32:39 -04:00
2014-10-15 20:32:40 -03:00
// note that each backend is also expected to have a static detect()
2014-10-14 01:48:33 -03:00
// function which instantiates an instance of the backend sensor
2014-10-15 20:32:40 -03:00
// driver if the sensor is available
2017-09-08 11:42:57 -03:00
private :
2021-09-14 17:28:20 -03:00
bool should_log_imu_raw ( ) const ;
void log_accel_raw ( uint8_t instance , const uint64_t sample_us , const Vector3f & accel ) __RAMFUNC__ ;
2023-09-29 18:26:31 -03:00
void log_gyro_raw ( uint8_t instance , const uint64_t sample_us , const Vector3f & raw_gyro , const Vector3f & filtered_gyro ) __RAMFUNC__ ;
2017-09-08 11:42:57 -03:00
2021-04-30 00:28:37 -03:00
// logging
2021-09-14 17:28:20 -03:00
void Write_ACC ( const uint8_t instance , const uint64_t sample_us , const Vector3f & accel ) const __RAMFUNC__ ; // Write ACC data packet: raw accel data
2023-10-21 18:43:46 -03:00
protected :
void Write_GYR ( const uint8_t instance , const uint64_t sample_us , const Vector3f & gyro , bool use_sample_timestamp = false ) const __RAMFUNC__ ; // Write GYR data packet: raw gyro data
2021-04-30 00:28:37 -03:00
2014-10-14 01:48:33 -03:00
} ;