2014-04-04 20:05:54 -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/>.
|
|
|
|
*/
|
|
|
|
|
|
|
|
//
|
|
|
|
// Swift Navigation SBP GPS driver for ArduPilot.
|
|
|
|
// Code by Niels Joubert
|
|
|
|
//
|
2015-04-22 20:10:46 -03:00
|
|
|
// Swift Binary Protocol format: http://docs.swift-nav.com/
|
|
|
|
//
|
2016-02-17 21:25:23 -04:00
|
|
|
#pragma once
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2015-08-11 03:28:43 -03:00
|
|
|
#include "AP_GPS.h"
|
2016-04-13 14:20:05 -03:00
|
|
|
#include "GPS_Backend.h"
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2022-01-09 19:15:32 -04:00
|
|
|
#if AP_GPS_SBP_ENABLED
|
2014-04-04 20:05:54 -03:00
|
|
|
class AP_GPS_SBP : public AP_GPS_Backend
|
|
|
|
{
|
|
|
|
public:
|
2015-04-22 20:10:46 -03:00
|
|
|
AP_GPS_SBP(AP_GPS &_gps, AP_GPS::GPS_State &_state, AP_HAL::UARTDriver *_port);
|
2014-06-06 18:58:11 -03:00
|
|
|
|
2018-11-07 06:58:08 -04:00
|
|
|
AP_GPS::GPS_Status highest_supported_status(void) override { return AP_GPS::GPS_OK_FIX_3D_RTK_FIXED; }
|
2014-06-06 18:58:11 -03:00
|
|
|
|
2020-08-13 19:09:12 -03:00
|
|
|
bool supports_mavlink_gps_rtk_message() const override { return true; }
|
2017-09-24 18:48:52 -03:00
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
// Methods
|
2018-11-07 06:58:08 -04:00
|
|
|
bool read() override;
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2016-10-04 04:37:52 -03:00
|
|
|
void inject_data(const uint8_t *data, uint16_t len) override;
|
2014-06-06 18:58:11 -03:00
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
static bool _detect(struct SBP_detect_state &state, uint8_t data);
|
2014-06-06 18:58:11 -03:00
|
|
|
|
2016-08-01 08:58:23 -03:00
|
|
|
const char *name() const override { return "SBP"; }
|
|
|
|
|
2014-04-04 20:05:54 -03:00
|
|
|
private:
|
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
// ************************************************************************
|
2014-04-04 20:05:54 -03:00
|
|
|
// Swift Navigation SBP protocol types and definitions
|
|
|
|
// ************************************************************************
|
2017-03-27 22:13:31 -03:00
|
|
|
|
2014-04-04 20:05:54 -03:00
|
|
|
struct sbp_parser_state_t {
|
|
|
|
enum {
|
|
|
|
WAITING = 0,
|
|
|
|
GET_TYPE = 1,
|
|
|
|
GET_SENDER = 2,
|
|
|
|
GET_LEN = 3,
|
|
|
|
GET_MSG = 4,
|
|
|
|
GET_CRC = 5
|
|
|
|
} state:8;
|
|
|
|
uint16_t msg_type;
|
|
|
|
uint16_t sender_id;
|
|
|
|
uint16_t crc;
|
|
|
|
uint8_t msg_len;
|
|
|
|
uint8_t n_read;
|
|
|
|
uint8_t msg_buff[256];
|
|
|
|
} parser_state;
|
|
|
|
|
|
|
|
static const uint8_t SBP_PREAMBLE = 0x55;
|
2017-03-27 22:13:31 -03:00
|
|
|
|
2014-04-04 20:05:54 -03:00
|
|
|
//Message types supported by this driver
|
2017-03-27 22:13:31 -03:00
|
|
|
static const uint16_t SBP_STARTUP_MSGTYPE = 0xFF00;
|
|
|
|
static const uint16_t SBP_HEARTBEAT_MSGTYPE = 0xFFFF;
|
2014-06-06 18:58:11 -03:00
|
|
|
static const uint16_t SBP_GPS_TIME_MSGTYPE = 0x0100;
|
|
|
|
static const uint16_t SBP_DOPS_MSGTYPE = 0x0206;
|
|
|
|
static const uint16_t SBP_POS_ECEF_MSGTYPE = 0x0200;
|
|
|
|
static const uint16_t SBP_POS_LLH_MSGTYPE = 0x0201;
|
|
|
|
static const uint16_t SBP_BASELINE_ECEF_MSGTYPE = 0x0202;
|
|
|
|
static const uint16_t SBP_BASELINE_NED_MSGTYPE = 0x0203;
|
|
|
|
static const uint16_t SBP_VEL_ECEF_MSGTYPE = 0x0204;
|
|
|
|
static const uint16_t SBP_VEL_NED_MSGTYPE = 0x0205;
|
|
|
|
static const uint16_t SBP_TRACKING_STATE_MSGTYPE = 0x0016;
|
|
|
|
static const uint16_t SBP_IAR_STATE_MSGTYPE = 0x0019;
|
2017-03-27 22:13:31 -03:00
|
|
|
|
|
|
|
// Heartbeat
|
|
|
|
// struct sbp_heartbeat_t {
|
|
|
|
// uint32_t flags; //< Status flags (reserved)
|
|
|
|
// }; // 4 bytes
|
|
|
|
struct PACKED sbp_heartbeat_t {
|
|
|
|
bool sys_error : 1;
|
|
|
|
bool io_error : 1;
|
|
|
|
bool nap_error : 1;
|
|
|
|
uint8_t res : 5;
|
|
|
|
uint8_t protocol_minor : 8;
|
|
|
|
uint8_t protocol_major : 8;
|
|
|
|
uint8_t res2 : 7;
|
|
|
|
bool ext_antenna : 1;
|
|
|
|
}; // 4 bytes
|
2015-04-22 20:10:46 -03:00
|
|
|
|
2014-04-04 20:05:54 -03:00
|
|
|
// GPS Time
|
|
|
|
struct PACKED sbp_gps_time_t {
|
|
|
|
uint16_t wn; //< GPS week number (unit: weeks)
|
|
|
|
uint32_t tow; //< GPS Time of Week rounded to the nearest ms (unit: ms)
|
|
|
|
int32_t ns; //< Nanosecond remainder of rounded tow (unit: ns)
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
2015-04-22 20:10:46 -03:00
|
|
|
}; // 11 bytes
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// Dilution of Precision
|
|
|
|
struct PACKED sbp_dops_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week (unit: ms)
|
|
|
|
uint16_t gdop; //< Geometric Dilution of Precision (unit: 0.01)
|
|
|
|
uint16_t pdop; //< Position Dilution of Precision (unit: 0.01)
|
|
|
|
uint16_t tdop; //< Time Dilution of Precision (unit: 0.01)
|
|
|
|
uint16_t hdop; //< Horizontal Dilution of Precision (unit: 0.01)
|
|
|
|
uint16_t vdop; //< Vertical Dilution of Precision (unit: 0.01)
|
2015-04-22 20:10:46 -03:00
|
|
|
}; // 14 bytes
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// Geodetic position solution.
|
|
|
|
struct PACKED sbp_pos_llh_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week (unit: ms)
|
|
|
|
double lat; //< Latitude (unit: degrees)
|
|
|
|
double lon; //< Longitude (unit: degrees)
|
|
|
|
double height; //< Height (unit: meters)
|
|
|
|
uint16_t h_accuracy; //< Horizontal position accuracy estimate (unit: mm)
|
|
|
|
uint16_t v_accuracy; //< Vertical position accuracy estimate (unit: mm)
|
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
|
|
|
uint8_t flags; //< Status flags
|
2015-04-22 20:10:46 -03:00
|
|
|
}; // 34 bytes
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// Velocity in NED Velocity in local North East Down (NED) coordinates.
|
|
|
|
struct PACKED sbp_vel_ned_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week (unit: ms)
|
|
|
|
int32_t n; //< Velocity North coordinate (unit: mm/s)
|
|
|
|
int32_t e; //< Velocity East coordinate (unit: mm/s)
|
|
|
|
int32_t d; //< Velocity Down coordinate (unit: mm/s)
|
|
|
|
uint16_t h_accuracy; //< Horizontal velocity accuracy estimate (unit: mm/s)
|
|
|
|
uint16_t v_accuracy; //< Vertical velocity accuracy estimate (unit: mm/s)
|
2017-03-27 22:13:31 -03:00
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
2014-04-04 20:05:54 -03:00
|
|
|
uint8_t flags; //< Status flags (reserved)
|
2015-04-22 20:10:46 -03:00
|
|
|
}; // 22 bytes
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2014-06-06 18:58:11 -03:00
|
|
|
// Activity and Signal-to-Noise data of a tracking channel on the GPS.
|
|
|
|
struct PACKED sbp_tracking_state_t {
|
|
|
|
uint8_t state; //< 0 if disabled, 1 if running
|
|
|
|
uint8_t prn; //< PRN identifier of tracked satellite
|
|
|
|
float cn0; //< carrier to noise power ratio.
|
|
|
|
};
|
|
|
|
|
|
|
|
// Integer Ambiguity Resolution state - how is the RTK resolution doing?
|
|
|
|
struct PACKED sbp_iar_state_t {
|
|
|
|
uint32_t num_hypotheses;
|
|
|
|
};
|
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
void _sbp_process();
|
|
|
|
void _sbp_process_message();
|
|
|
|
bool _attempt_state_update();
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// ************************************************************************
|
2015-04-22 20:10:46 -03:00
|
|
|
// Internal Received Messages State
|
2014-04-04 20:05:54 -03:00
|
|
|
// ************************************************************************
|
2014-06-06 18:58:11 -03:00
|
|
|
uint32_t last_heatbeat_received_ms;
|
2015-04-22 20:10:46 -03:00
|
|
|
uint32_t last_injected_data_ms;
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
struct sbp_gps_time_t last_gps_time;
|
|
|
|
struct sbp_dops_t last_dops;
|
|
|
|
struct sbp_pos_llh_t last_pos_llh_spp;
|
|
|
|
struct sbp_pos_llh_t last_pos_llh_rtk;
|
|
|
|
struct sbp_vel_ned_t last_vel_ned;
|
|
|
|
uint32_t last_iar_num_hypotheses;
|
2014-04-04 20:05:54 -03:00
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
uint32_t last_full_update_tow;
|
|
|
|
uint32_t last_full_update_cpu_ms;
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// ************************************************************************
|
|
|
|
// Monitoring and Performance Counting
|
|
|
|
// ************************************************************************
|
|
|
|
|
2014-06-06 18:58:11 -03:00
|
|
|
uint32_t crc_error_counter;
|
2014-04-04 20:05:54 -03:00
|
|
|
|
|
|
|
// ************************************************************************
|
2019-01-18 00:23:42 -04:00
|
|
|
// Logging to AP_Logger
|
2014-04-04 20:05:54 -03:00
|
|
|
// ************************************************************************
|
|
|
|
|
2015-04-22 20:10:46 -03:00
|
|
|
void logging_log_full_update();
|
|
|
|
void logging_log_raw_sbp(uint16_t msg_type, uint16_t sender_id, uint8_t msg_len, uint8_t *msg_buff);
|
2017-03-27 22:13:31 -03:00
|
|
|
|
2014-06-06 18:58:11 -03:00
|
|
|
|
2014-04-04 20:05:54 -03:00
|
|
|
};
|
2022-01-09 19:15:32 -04:00
|
|
|
#endif
|