Skip to content

Commit

Permalink
GCS_MAVLink: support HIGHRES_IMU
Browse files Browse the repository at this point in the history
HIGHRES_IMU MAVLink message. Built in to 2MB boards or not by default.
  • Loading branch information
KoehlerT committed Jun 17, 2024
1 parent 7003647 commit b159ecc
Show file tree
Hide file tree
Showing 4 changed files with 95 additions and 1 deletion.
2 changes: 1 addition & 1 deletion libraries/GCS_MAVLink/GCS.h
Original file line number Diff line number Diff line change
Expand Up @@ -354,6 +354,7 @@ class GCS_MAVLINK
void send_rc_channels() const;
void send_rc_channels_raw() const;
void send_raw_imu();
void send_highres_imu();

void send_scaled_pressure_instance(uint8_t instance, void (*send_fn)(mavlink_channel_t chan, uint32_t time_boot_ms, float press_abs, float press_diff, int16_t temperature, int16_t temperature_press_diff));
void send_scaled_pressure();
Expand Down Expand Up @@ -1401,4 +1402,3 @@ enum MAV_SEVERITY
#define AP_HAVE_GCS_SEND_TEXT 0

#endif // HAL_GCS_ENABLED

86 changes: 86 additions & 0 deletions libraries/GCS_MAVLink/GCS_Common.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -1007,6 +1007,9 @@ ap_message GCS_MAVLINK::mavlink_id_to_ap_message_id(const uint32_t mavlink_id) c
{ MAVLINK_MSG_ID_SCALED_IMU, MSG_SCALED_IMU},
{ MAVLINK_MSG_ID_SCALED_IMU2, MSG_SCALED_IMU2},
{ MAVLINK_MSG_ID_SCALED_IMU3, MSG_SCALED_IMU3},
#if AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED
{ MAVLINK_MSG_ID_HIGHRES_IMU, MSG_HIGHRES_IMU},
#endif
{ MAVLINK_MSG_ID_SCALED_PRESSURE, MSG_SCALED_PRESSURE},
{ MAVLINK_MSG_ID_SCALED_PRESSURE2, MSG_SCALED_PRESSURE2},
{ MAVLINK_MSG_ID_SCALED_PRESSURE3, MSG_SCALED_PRESSURE3},
Expand Down Expand Up @@ -2129,6 +2132,83 @@ void GCS_MAVLINK::send_raw_imu()
#endif
}

#if AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED
void GCS_MAVLINK::send_highres_imu()
{
// static const uint16_t HIGHRES_IMU_UPDATED_NONE = 0x00;
static const uint16_t HIGHRES_IMU_UPDATED_XACC = 0x01;
static const uint16_t HIGHRES_IMU_UPDATED_YACC = 0x02;
static const uint16_t HIGHRES_IMU_UPDATED_ZACC = 0x04;
static const uint16_t HIGHRES_IMU_UPDATED_XGYRO = 0x08;
static const uint16_t HIGHRES_IMU_UPDATED_YGYRO = 0x10;
static const uint16_t HIGHRES_IMU_UPDATED_ZGYRO = 0x20;
static const uint16_t HIGHRES_IMU_UPDATED_XMAG = 0x40;
static const uint16_t HIGHRES_IMU_UPDATED_YMAG = 0x80;
static const uint16_t HIGHRES_IMU_UPDATED_ZMAG = 0x100;
static const uint16_t HIGHRES_IMU_UPDATED_ABS_PRESSURE = 0x200;
static const uint16_t HIGHRES_IMU_UPDATED_DIFF_PRESSURE = 0x400;
static const uint16_t HIGHRES_IMU_UPDATED_PRESSURE_ALT = 0x800;
static const uint16_t HIGHRES_IMU_UPDATED_TEMPERATURE = 0x1000;
static const uint16_t HIGHRES_IMU_UPDATED_ALL = 0xFFFF;

const AP_InertialSensor &ins = AP::ins();
const Vector3f& accel = ins.get_accel();
const Vector3f& gyro = ins.get_gyro();

mavlink_highres_imu_t reply = {
.time_usec = AP_HAL::micros64(),
.xacc = accel.x,
.yacc = accel.y,
.zacc = accel.z,
.xgyro = gyro.x,
.ygyro = gyro.y,
.zgyro = gyro.z,
.xmag = 0.0,
.ymag = 0.0,
.zmag = 0.0,
.abs_pressure = 0.0,
.diff_pressure = 0.0,
.pressure_alt = 0.0,
.temperature = 0.0,
.fields_updated = (HIGHRES_IMU_UPDATED_XACC | HIGHRES_IMU_UPDATED_YACC | HIGHRES_IMU_UPDATED_ZACC |
HIGHRES_IMU_UPDATED_XGYRO | HIGHRES_IMU_UPDATED_YGYRO | HIGHRES_IMU_UPDATED_ZGYRO),
.id = ins.get_primary_accel(),
};


#if AP_COMPASS_ENABLED
const Compass &compass = AP::compass();
if (compass.get_count() >= 1) {
const Vector3f field = compass.get_field() * 1000.0f;
reply.xmag = field.x; // convert to gauss
reply.ymag = field.y;
reply.zmag = field.z;
reply.fields_updated |= (HIGHRES_IMU_UPDATED_XMAG | HIGHRES_IMU_UPDATED_YMAG | HIGHRES_IMU_UPDATED_ZMAG);
}
#endif

#if AP_BARO_ENABLED
const AP_Baro &barometer = AP::baro();
reply.abs_pressure = barometer.get_pressure() * 0.01f;
reply.temperature = barometer.get_temperature();
reply.pressure_alt = barometer.get_altitude_AMSL();
reply.diff_pressure = reply.abs_pressure - barometer.get_ground_pressure() * 0.01f;
reply.fields_updated |= (HIGHRES_IMU_UPDATED_ABS_PRESSURE | HIGHRES_IMU_UPDATED_DIFF_PRESSURE |
HIGHRES_IMU_UPDATED_PRESSURE_ALT | HIGHRES_IMU_UPDATED_TEMPERATURE);
#endif
static const uint16_t all_flags = (HIGHRES_IMU_UPDATED_XACC | HIGHRES_IMU_UPDATED_YACC | HIGHRES_IMU_UPDATED_ZACC |
HIGHRES_IMU_UPDATED_XGYRO | HIGHRES_IMU_UPDATED_YGYRO | HIGHRES_IMU_UPDATED_ZGYRO |
HIGHRES_IMU_UPDATED_XMAG | HIGHRES_IMU_UPDATED_YMAG | HIGHRES_IMU_UPDATED_ZMAG |
HIGHRES_IMU_UPDATED_ABS_PRESSURE | HIGHRES_IMU_UPDATED_DIFF_PRESSURE |
HIGHRES_IMU_UPDATED_PRESSURE_ALT | HIGHRES_IMU_UPDATED_TEMPERATURE);
if (reply.fields_updated == all_flags) {
reply.fields_updated |= HIGHRES_IMU_UPDATED_ALL;
}

mavlink_msg_highres_imu_send_struct(chan, &reply);
}
#endif // AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED

void GCS_MAVLINK::send_scaled_imu(uint8_t instance, void (*send_fn)(mavlink_channel_t chan, uint32_t time_ms, int16_t xacc, int16_t yacc, int16_t zacc, int16_t xgyro, int16_t ygyro, int16_t zgyro, int16_t xmag, int16_t ymag, int16_t zmag, int16_t temperature))
{
#if AP_INERTIALSENSOR_ENABLED
Expand Down Expand Up @@ -6150,6 +6230,12 @@ bool GCS_MAVLINK::try_send_message(const enum ap_message id)
CHECK_PAYLOAD_SIZE(SCALED_IMU3);
send_scaled_imu(2, mavlink_msg_scaled_imu3_send);
break;
#if AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED
case MSG_HIGHRES_IMU:
CHECK_PAYLOAD_SIZE(HIGHRES_IMU);
send_highres_imu();
break;
#endif

case MSG_SCALED_PRESSURE:
CHECK_PAYLOAD_SIZE(SCALED_PRESSURE);
Expand Down
5 changes: 5 additions & 0 deletions libraries/GCS_MAVLink/GCS_config.h
Original file line number Diff line number Diff line change
Expand Up @@ -3,6 +3,7 @@
#include <AP_HAL/AP_HAL_Boards.h>
#include <AP_Relay/AP_Relay_config.h>
#include <AP_Mission/AP_Mission_config.h>
#include <AP_InertialSensor/AP_InertialSensor_config.h>

#ifndef HAL_GCS_ENABLED
#define HAL_GCS_ENABLED 1
Expand Down Expand Up @@ -122,3 +123,7 @@
#ifndef AP_MAVLINK_COMMAND_LONG_ENABLED
#define AP_MAVLINK_COMMAND_LONG_ENABLED 1
#endif

#ifndef AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED
#define AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED (BOARD_FLASH_SIZE > 1024) && AP_INERTIALSENSOR_ENABLED
#endif
3 changes: 3 additions & 0 deletions libraries/GCS_MAVLink/ap_message.h
Original file line number Diff line number Diff line change
Expand Up @@ -94,5 +94,8 @@ enum ap_message : uint8_t {
MSG_HYGROMETER,
MSG_AUTOPILOT_STATE_FOR_GIMBAL_DEVICE,
MSG_RELAY_STATUS,
#if AP_MAVLINK_MSG_HIGHRES_IMU_ENABLED
MSG_HIGHRES_IMU,
#endif
MSG_LAST // MSG_LAST must be the last entry in this enum
};

0 comments on commit b159ecc

Please sign in to comment.