2012-12-14 21:54:26 -04:00
|
|
|
/*
|
|
|
|
SITL handling
|
|
|
|
|
|
|
|
This simulates a GPS on a serial port
|
|
|
|
|
|
|
|
Andrew Tridgell November 2011
|
|
|
|
*/
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
#include "SIM_GPS.h"
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
#if HAL_SIM_GPS_ENABLED
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2021-10-11 02:08:40 -03:00
|
|
|
#include <time.h>
|
|
|
|
|
2023-05-19 02:09:44 -03:00
|
|
|
#include <assert.h>
|
2021-10-16 00:10:40 -03:00
|
|
|
#include <AP_BoardConfig/AP_BoardConfig.h>
|
|
|
|
#include <AP_HAL/AP_HAL.h>
|
2015-08-15 19:51:46 -03:00
|
|
|
#include <SITL/SITL.h>
|
2023-08-10 07:56:25 -03:00
|
|
|
#include <AP_InternalError/AP_InternalError.h>
|
2021-02-06 02:23:58 -04:00
|
|
|
#include <AP_Common/NMEA.h>
|
2023-05-19 02:09:44 -03:00
|
|
|
#include <AP_HAL/utility/sparse-endian.h>
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
// the number of GPS leap seconds - copied from AP_GPS.h
|
|
|
|
#define GPS_LEAPSECONDS_MILLIS 18000ULL
|
2015-05-04 04:25:58 -03:00
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
extern const AP_HAL::HAL& hal;
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
using namespace SITL;
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
struct GPS_TOW {
|
|
|
|
// Number of weeks since midnight 5-6 January 1980
|
|
|
|
uint16_t week;
|
|
|
|
// Time since start of the GPS week [mS]
|
|
|
|
uint32_t ms;
|
|
|
|
};
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
// ensure the backend we have allocated matches the one that's configured:
|
|
|
|
GPS_Backend::GPS_Backend(GPS &_front, uint8_t _instance)
|
|
|
|
: front{_front},
|
|
|
|
instance{_instance}
|
|
|
|
{
|
2023-11-16 21:57:33 -04:00
|
|
|
_sitl = AP::sitl();
|
2023-08-09 01:36:44 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
ssize_t GPS_Backend::write_to_autopilot(const char *p, size_t size) const
|
|
|
|
{
|
|
|
|
return front.write_to_autopilot(p, size);
|
|
|
|
}
|
|
|
|
|
|
|
|
ssize_t GPS_Backend::read_from_autopilot(char *buffer, size_t size) const
|
|
|
|
{
|
|
|
|
return front.read_from_autopilot(buffer, size);
|
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
GPS::GPS(uint8_t _instance) :
|
2022-11-29 16:59:21 -04:00
|
|
|
SerialDevice(8192, 2048),
|
2021-10-16 00:10:40 -03:00
|
|
|
instance{_instance}
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2013-12-21 07:26:30 -04:00
|
|
|
}
|
|
|
|
|
2022-09-28 07:54:52 -03:00
|
|
|
uint32_t GPS::device_baud() const
|
|
|
|
{
|
2023-08-09 01:36:44 -03:00
|
|
|
if (backend == nullptr) {
|
2023-01-28 01:47:25 -04:00
|
|
|
return 0;
|
|
|
|
}
|
2023-08-09 01:36:44 -03:00
|
|
|
return backend->device_baud();
|
2022-09-28 07:54:52 -03:00
|
|
|
}
|
|
|
|
|
2013-02-16 07:00:16 -04:00
|
|
|
/*
|
|
|
|
write some bytes from the simulated GPS
|
|
|
|
*/
|
2021-10-16 00:10:40 -03:00
|
|
|
ssize_t GPS::write_to_autopilot(const char *p, size_t size) const
|
2013-02-16 07:00:16 -04:00
|
|
|
{
|
2021-10-16 00:10:40 -03:00
|
|
|
// the second GPS instance fails in a different way to the first;
|
|
|
|
// the first will start sending back 3 satellites, the second just
|
|
|
|
// stops responding when disabled. This is not necessarily a good
|
|
|
|
// thing.
|
2020-07-07 20:53:01 -03:00
|
|
|
if (instance == 1 && _sitl->gps_disable[instance]) {
|
2021-10-16 00:10:40 -03:00
|
|
|
return -1;
|
2020-12-28 10:33:56 -04:00
|
|
|
}
|
2021-10-16 00:10:40 -03:00
|
|
|
|
2021-11-04 23:50:16 -03:00
|
|
|
const float byteloss = _sitl->gps_byteloss[instance];
|
|
|
|
|
|
|
|
// shortcut if we're not doing byteloss:
|
|
|
|
if (!is_positive(byteloss)) {
|
|
|
|
return SerialDevice::write_to_autopilot(p, size);
|
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
size_t ret = 0;
|
2015-05-04 21:59:07 -03:00
|
|
|
while (size--) {
|
|
|
|
float r = ((((unsigned)random()) % 1000000)) / 1.0e4;
|
2021-11-04 23:50:16 -03:00
|
|
|
if (r < byteloss) {
|
2015-05-04 21:59:07 -03:00
|
|
|
// lose the byte
|
|
|
|
p++;
|
|
|
|
continue;
|
|
|
|
}
|
2021-11-04 23:50:16 -03:00
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
const ssize_t pret = SerialDevice::write_to_autopilot(p, 1);
|
|
|
|
if (pret == 0) {
|
|
|
|
// no space?
|
|
|
|
return ret;
|
|
|
|
}
|
|
|
|
if (pret != 1) {
|
|
|
|
// error has occured?
|
|
|
|
return pret;
|
2014-03-02 16:07:29 -04:00
|
|
|
}
|
2021-10-16 00:10:40 -03:00
|
|
|
ret++;
|
2013-12-21 07:26:30 -04:00
|
|
|
p++;
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
return ret;
|
2013-02-16 07:00:16 -04:00
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2016-05-03 19:22:55 -03:00
|
|
|
/*
|
|
|
|
get timeval using simulation time
|
|
|
|
*/
|
|
|
|
static void simulation_timeval(struct timeval *tv)
|
|
|
|
{
|
|
|
|
uint64_t now = AP_HAL::micros64();
|
|
|
|
static uint64_t first_usec;
|
|
|
|
static struct timeval first_tv;
|
|
|
|
if (first_usec == 0) {
|
|
|
|
first_usec = now;
|
2020-09-04 19:23:51 -03:00
|
|
|
first_tv.tv_sec = AP::sitl()->start_time_UTC;
|
2016-05-03 19:22:55 -03:00
|
|
|
}
|
|
|
|
*tv = first_tv;
|
|
|
|
tv->tv_sec += now / 1000000ULL;
|
|
|
|
uint64_t new_usec = tv->tv_usec + (now % 1000000ULL);
|
|
|
|
tv->tv_sec += new_usec / 1000000ULL;
|
|
|
|
tv->tv_usec = new_usec % 1000000ULL;
|
|
|
|
}
|
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
/*
|
|
|
|
send a UBLOX GPS message
|
|
|
|
*/
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS_UBlox::send_ubx(uint8_t msgid, uint8_t *buf, uint16_t size)
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2015-05-04 21:59:07 -03:00
|
|
|
const uint8_t PREAMBLE1 = 0xb5;
|
|
|
|
const uint8_t PREAMBLE2 = 0x62;
|
|
|
|
const uint8_t CLASS_NAV = 0x1;
|
|
|
|
uint8_t hdr[6], chk[2];
|
|
|
|
hdr[0] = PREAMBLE1;
|
|
|
|
hdr[1] = PREAMBLE2;
|
|
|
|
hdr[2] = CLASS_NAV;
|
|
|
|
hdr[3] = msgid;
|
|
|
|
hdr[4] = size & 0xFF;
|
|
|
|
hdr[5] = size >> 8;
|
|
|
|
chk[0] = chk[1] = hdr[2];
|
|
|
|
chk[1] += (chk[0] += hdr[3]);
|
|
|
|
chk[1] += (chk[0] += hdr[4]);
|
|
|
|
chk[1] += (chk[0] += hdr[5]);
|
2020-08-05 04:36:56 -03:00
|
|
|
for (uint16_t i=0; i<size; i++) {
|
2015-05-04 21:59:07 -03:00
|
|
|
chk[1] += (chk[0] += buf[i]);
|
|
|
|
}
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((char*)hdr, sizeof(hdr));
|
|
|
|
write_to_autopilot((char*)buf, size);
|
|
|
|
write_to_autopilot((char*)chk, sizeof(chk));
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
2013-02-16 06:36:06 -04:00
|
|
|
/*
|
2023-05-19 02:09:44 -03:00
|
|
|
return GPS time of week
|
2013-02-16 06:36:06 -04:00
|
|
|
*/
|
2023-05-23 01:27:50 -03:00
|
|
|
static GPS_TOW gps_time()
|
2013-02-16 06:36:06 -04:00
|
|
|
{
|
2023-05-23 01:27:50 -03:00
|
|
|
GPS_TOW gps_tow;
|
2013-10-23 04:07:51 -03:00
|
|
|
struct timeval tv;
|
2016-05-03 19:22:55 -03:00
|
|
|
simulation_timeval(&tv);
|
2017-01-10 05:59:02 -04:00
|
|
|
const uint32_t epoch = 86400*(10*365 + (1980-1969)/4 + 1 + 6 - 2) - (GPS_LEAPSECONDS_MILLIS / 1000ULL);
|
2013-10-23 04:07:51 -03:00
|
|
|
uint32_t epoch_seconds = tv.tv_sec - epoch;
|
2023-05-23 01:27:50 -03:00
|
|
|
gps_tow.week = epoch_seconds / AP_SEC_PER_WEEK;
|
2016-02-24 18:36:44 -04:00
|
|
|
uint32_t t_ms = tv.tv_usec / 1000;
|
|
|
|
// round time to nearest 200ms
|
2023-05-23 01:27:50 -03:00
|
|
|
gps_tow.ms = (epoch_seconds % AP_SEC_PER_WEEK) * AP_MSEC_PER_SEC + ((t_ms/200) * 200);
|
|
|
|
return gps_tow;
|
2013-02-16 06:36:06 -04:00
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
|
|
|
/*
|
2013-02-16 05:16:13 -04:00
|
|
|
send a new set of GPS UBLOX packets
|
2012-12-14 21:54:26 -04:00
|
|
|
*/
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_UBlox::publish(const GPS_Data *d)
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2015-05-04 21:59:07 -03:00
|
|
|
struct PACKED ubx_nav_posllh {
|
2017-04-04 21:00:59 -03:00
|
|
|
uint32_t time; // GPS msToW
|
|
|
|
int32_t longitude;
|
|
|
|
int32_t latitude;
|
|
|
|
int32_t altitude_ellipsoid;
|
|
|
|
int32_t altitude_msl;
|
|
|
|
uint32_t horizontal_accuracy;
|
|
|
|
uint32_t vertical_accuracy;
|
2018-01-24 01:38:41 -04:00
|
|
|
} pos {};
|
2015-05-04 21:59:07 -03:00
|
|
|
struct PACKED ubx_nav_status {
|
2017-04-04 21:00:59 -03:00
|
|
|
uint32_t time; // GPS msToW
|
|
|
|
uint8_t fix_type;
|
|
|
|
uint8_t fix_status;
|
|
|
|
uint8_t differential_status;
|
|
|
|
uint8_t res;
|
|
|
|
uint32_t time_to_first_fix;
|
|
|
|
uint32_t uptime; // milliseconds
|
2018-01-24 01:38:41 -04:00
|
|
|
} status {};
|
2015-05-04 21:59:07 -03:00
|
|
|
struct PACKED ubx_nav_velned {
|
2017-04-04 21:00:59 -03:00
|
|
|
uint32_t time; // GPS msToW
|
|
|
|
int32_t ned_north;
|
|
|
|
int32_t ned_east;
|
|
|
|
int32_t ned_down;
|
|
|
|
uint32_t speed_3d;
|
|
|
|
uint32_t speed_2d;
|
|
|
|
int32_t heading_2d;
|
|
|
|
uint32_t speed_accuracy;
|
|
|
|
uint32_t heading_accuracy;
|
2018-01-24 01:38:41 -04:00
|
|
|
} velned {};
|
2015-05-04 21:59:07 -03:00
|
|
|
struct PACKED ubx_nav_solution {
|
|
|
|
uint32_t time;
|
|
|
|
int32_t time_nsec;
|
|
|
|
int16_t week;
|
|
|
|
uint8_t fix_type;
|
|
|
|
uint8_t fix_status;
|
|
|
|
int32_t ecef_x;
|
|
|
|
int32_t ecef_y;
|
|
|
|
int32_t ecef_z;
|
|
|
|
uint32_t position_accuracy_3d;
|
|
|
|
int32_t ecef_x_velocity;
|
|
|
|
int32_t ecef_y_velocity;
|
|
|
|
int32_t ecef_z_velocity;
|
|
|
|
uint32_t speed_accuracy;
|
|
|
|
uint16_t position_DOP;
|
|
|
|
uint8_t res;
|
|
|
|
uint8_t satellites;
|
|
|
|
uint32_t res2;
|
2018-01-24 01:38:41 -04:00
|
|
|
} sol {};
|
2015-08-07 09:42:37 -03:00
|
|
|
struct PACKED ubx_nav_dop {
|
|
|
|
uint32_t time; // GPS msToW
|
|
|
|
uint16_t gDOP;
|
|
|
|
uint16_t pDOP;
|
|
|
|
uint16_t tDOP;
|
|
|
|
uint16_t vDOP;
|
|
|
|
uint16_t hDOP;
|
|
|
|
uint16_t nDOP;
|
|
|
|
uint16_t eDOP;
|
2018-01-24 01:38:41 -04:00
|
|
|
} dop {};
|
2016-07-30 20:38:43 -03:00
|
|
|
struct PACKED ubx_nav_pvt {
|
|
|
|
uint32_t itow;
|
|
|
|
uint16_t year;
|
|
|
|
uint8_t month, day, hour, min, sec;
|
|
|
|
uint8_t valid;
|
|
|
|
uint32_t t_acc;
|
|
|
|
int32_t nano;
|
|
|
|
uint8_t fix_type;
|
|
|
|
uint8_t flags;
|
|
|
|
uint8_t flags2;
|
|
|
|
uint8_t num_sv;
|
|
|
|
int32_t lon, lat;
|
|
|
|
int32_t height, h_msl;
|
|
|
|
uint32_t h_acc, v_acc;
|
|
|
|
int32_t velN, velE, velD, gspeed;
|
|
|
|
int32_t head_mot;
|
|
|
|
uint32_t s_acc;
|
|
|
|
uint32_t head_acc;
|
|
|
|
uint16_t p_dop;
|
|
|
|
uint8_t reserved1[6];
|
|
|
|
uint32_t headVeh;
|
|
|
|
uint8_t reserved2[4];
|
2018-01-24 01:38:41 -04:00
|
|
|
} pvt {};
|
2018-01-10 19:33:25 -04:00
|
|
|
const uint8_t SV_COUNT = 10;
|
|
|
|
struct PACKED ubx_nav_svinfo {
|
|
|
|
uint32_t itow;
|
|
|
|
uint8_t numCh;
|
|
|
|
uint8_t globalFlags;
|
|
|
|
uint8_t reserved1[2];
|
|
|
|
// repeated block
|
|
|
|
struct PACKED svinfo_sv {
|
|
|
|
uint8_t chn;
|
|
|
|
uint8_t svid;
|
|
|
|
uint8_t flags;
|
|
|
|
uint8_t quality;
|
|
|
|
uint8_t cno;
|
|
|
|
int8_t elev;
|
|
|
|
int16_t azim;
|
|
|
|
int32_t prRes;
|
|
|
|
} sv[SV_COUNT];
|
2018-01-24 01:38:41 -04:00
|
|
|
} svinfo {};
|
2020-04-02 08:13:02 -03:00
|
|
|
enum RELPOSNED {
|
|
|
|
gnssFixOK = 1U << 0,
|
|
|
|
diffSoln = 1U << 1,
|
|
|
|
relPosValid = 1U << 2,
|
|
|
|
carrSolnFloat = 1U << 3,
|
|
|
|
|
|
|
|
carrSolnFixed = 1U << 4,
|
|
|
|
isMoving = 1U << 5,
|
|
|
|
refPosMiss = 1U << 6,
|
|
|
|
refObsMiss = 1U << 7,
|
|
|
|
|
|
|
|
relPosHeadingValid = 1U << 8,
|
|
|
|
relPosNormalized = 1U << 9
|
|
|
|
};
|
|
|
|
struct PACKED ubx_nav_relposned {
|
|
|
|
uint8_t version;
|
|
|
|
uint8_t reserved1;
|
|
|
|
uint16_t refStationId;
|
|
|
|
uint32_t iTOW;
|
|
|
|
int32_t relPosN;
|
|
|
|
int32_t relPosE;
|
|
|
|
int32_t relPosD;
|
|
|
|
int32_t relPosLength;
|
|
|
|
int32_t relPosHeading;
|
|
|
|
uint8_t reserved2[4];
|
|
|
|
int8_t relPosHPN;
|
|
|
|
int8_t relPosHPE;
|
|
|
|
int8_t relPosHPD;
|
|
|
|
int8_t relPosHPLength;
|
|
|
|
uint32_t accN;
|
|
|
|
uint32_t accE;
|
|
|
|
uint32_t accD;
|
|
|
|
uint32_t accLength;
|
|
|
|
uint32_t accHeading;
|
|
|
|
uint8_t reserved3[4];
|
|
|
|
uint32_t flags;
|
|
|
|
} relposned {};
|
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
const uint8_t MSG_POSLLH = 0x2;
|
|
|
|
const uint8_t MSG_STATUS = 0x3;
|
2015-08-07 09:42:37 -03:00
|
|
|
const uint8_t MSG_DOP = 0x4;
|
2015-05-04 21:59:07 -03:00
|
|
|
const uint8_t MSG_VELNED = 0x12;
|
2013-10-23 04:07:51 -03:00
|
|
|
const uint8_t MSG_SOL = 0x6;
|
2016-07-30 20:38:43 -03:00
|
|
|
const uint8_t MSG_PVT = 0x7;
|
2018-01-10 19:33:25 -04:00
|
|
|
const uint8_t MSG_SVINFO = 0x30;
|
2020-04-02 08:13:02 -03:00
|
|
|
const uint8_t MSG_RELPOSNED = 0x3c;
|
2018-01-10 19:33:25 -04:00
|
|
|
|
2021-11-04 23:50:42 -03:00
|
|
|
uint32_t _next_nav_sv_info_time = 0;
|
2018-01-10 19:33:25 -04:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
const auto gps_tow = gps_time();
|
2013-10-23 04:07:51 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
pos.time = gps_tow.ms;
|
2017-04-10 07:17:09 -03:00
|
|
|
pos.longitude = d->longitude * 1.0e7;
|
|
|
|
pos.latitude = d->latitude * 1.0e7;
|
|
|
|
pos.altitude_ellipsoid = d->altitude * 1000.0f;
|
|
|
|
pos.altitude_msl = d->altitude * 1000.0f;
|
2020-08-20 07:44:20 -03:00
|
|
|
pos.horizontal_accuracy = _sitl->gps_accuracy[instance]*1000;
|
|
|
|
pos.vertical_accuracy = _sitl->gps_accuracy[instance]*1000;
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
status.time = gps_tow.ms;
|
2015-05-04 21:59:07 -03:00
|
|
|
status.fix_type = d->have_lock?3:0;
|
|
|
|
status.fix_status = d->have_lock?1:0;
|
|
|
|
status.differential_status = 0;
|
|
|
|
status.res = 0;
|
|
|
|
status.time_to_first_fix = 0;
|
2015-11-19 23:11:17 -04:00
|
|
|
status.uptime = AP_HAL::millis();
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
velned.time = gps_tow.ms;
|
2015-05-04 21:59:07 -03:00
|
|
|
velned.ned_north = 100.0f * d->speedN;
|
|
|
|
velned.ned_east = 100.0f * d->speedE;
|
|
|
|
velned.ned_down = 100.0f * d->speedD;
|
2016-04-16 06:58:46 -03:00
|
|
|
velned.speed_2d = norm(d->speedN, d->speedE) * 100;
|
|
|
|
velned.speed_3d = norm(d->speedN, d->speedE, d->speedD) * 100;
|
2015-05-04 21:59:07 -03:00
|
|
|
velned.heading_2d = ToDeg(atan2f(d->speedE, d->speedN)) * 100000.0f;
|
|
|
|
if (velned.heading_2d < 0.0f) {
|
|
|
|
velned.heading_2d += 360.0f * 100000.0f;
|
|
|
|
}
|
|
|
|
velned.speed_accuracy = 40;
|
|
|
|
velned.heading_accuracy = 4;
|
|
|
|
|
|
|
|
memset(&sol, 0, sizeof(sol));
|
|
|
|
sol.fix_type = d->have_lock?3:0;
|
|
|
|
sol.fix_status = 221;
|
2023-05-19 02:09:44 -03:00
|
|
|
sol.satellites = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2023-05-23 01:27:50 -03:00
|
|
|
sol.time = gps_tow.ms;
|
|
|
|
sol.week = gps_tow.week;
|
2013-02-16 05:16:13 -04:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
dop.time = gps_tow.ms;
|
2015-08-07 09:42:37 -03:00
|
|
|
dop.gDOP = 65535;
|
|
|
|
dop.pDOP = 65535;
|
|
|
|
dop.tDOP = 65535;
|
|
|
|
dop.vDOP = 200;
|
|
|
|
dop.hDOP = 121;
|
|
|
|
dop.nDOP = 65535;
|
|
|
|
dop.eDOP = 65535;
|
2016-07-30 20:38:43 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
pvt.itow = gps_tow.ms;
|
2016-07-30 20:38:43 -03:00
|
|
|
pvt.year = 0;
|
|
|
|
pvt.month = 0;
|
|
|
|
pvt.day = 0;
|
|
|
|
pvt.hour = 0;
|
|
|
|
pvt.min = 0;
|
|
|
|
pvt.sec = 0;
|
|
|
|
pvt.valid = 0; // invalid utc date
|
|
|
|
pvt.t_acc = 0;
|
|
|
|
pvt.nano = 0;
|
2017-03-19 22:05:00 -03:00
|
|
|
pvt.fix_type = d->have_lock? 0x3 : 0;
|
2016-07-30 20:38:43 -03:00
|
|
|
pvt.flags = 0b10000011; // carrsoln=fixed, psm = na, diffsoln and fixok
|
|
|
|
pvt.flags2 =0;
|
2023-05-19 02:09:44 -03:00
|
|
|
pvt.num_sv = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2017-04-10 07:17:09 -03:00
|
|
|
pvt.lon = d->longitude * 1.0e7;
|
|
|
|
pvt.lat = d->latitude * 1.0e7;
|
|
|
|
pvt.height = d->altitude * 1000.0f;
|
|
|
|
pvt.h_msl = d->altitude * 1000.0f;
|
2020-08-20 07:44:20 -03:00
|
|
|
pvt.h_acc = _sitl->gps_accuracy[instance] * 1000;
|
|
|
|
pvt.v_acc = _sitl->gps_accuracy[instance] * 1000;
|
2016-07-30 20:38:43 -03:00
|
|
|
pvt.velN = 1000.0f * d->speedN;
|
|
|
|
pvt.velE = 1000.0f * d->speedE;
|
|
|
|
pvt.velD = 1000.0f * d->speedD;
|
|
|
|
pvt.gspeed = norm(d->speedN, d->speedE) * 1000;
|
|
|
|
pvt.head_mot = ToDeg(atan2f(d->speedE, d->speedN)) * 1.0e5;
|
|
|
|
pvt.s_acc = 40;
|
|
|
|
pvt.head_acc = 38 * 1.0e5;
|
|
|
|
pvt.p_dop = 65535;
|
2017-02-04 20:14:51 -04:00
|
|
|
memset(pvt.reserved1, '\0', ARRAY_SIZE(pvt.reserved1));
|
|
|
|
pvt.headVeh = 0;
|
|
|
|
memset(pvt.reserved2, '\0', ARRAY_SIZE(pvt.reserved2));
|
2015-08-07 09:42:37 -03:00
|
|
|
|
2021-07-30 07:13:59 -03:00
|
|
|
if (_sitl->gps_hdg_enabled[instance] > SITL::SIM::GPS_HEADING_NONE) {
|
2020-04-02 08:13:02 -03:00
|
|
|
const Vector3f ant1_pos = _sitl->gps_pos_offset[instance^1].get();
|
|
|
|
const Vector3f ant2_pos = _sitl->gps_pos_offset[instance].get();
|
|
|
|
Vector3f rel_antenna_pos = ant2_pos - ant1_pos;
|
|
|
|
Matrix3f rot;
|
2021-04-14 22:34:14 -03:00
|
|
|
// project attitude back using gyros to get antenna orientation at time of GPS sample
|
|
|
|
Vector3f gyro(radians(_sitl->state.rollRate),
|
|
|
|
radians(_sitl->state.pitchRate),
|
|
|
|
radians(_sitl->state.yawRate));
|
2021-10-23 06:42:04 -03:00
|
|
|
rot.from_euler(radians(_sitl->state.rollDeg), radians(_sitl->state.pitchDeg), radians(d->yaw_deg));
|
2022-01-05 20:32:55 -04:00
|
|
|
const float lag = _sitl->gps_delay_ms[instance] * 0.001;
|
2021-04-14 22:34:14 -03:00
|
|
|
rot.rotate(gyro * (-lag));
|
2020-04-02 08:13:02 -03:00
|
|
|
rel_antenna_pos = rot * rel_antenna_pos;
|
|
|
|
relposned.version = 1;
|
2023-05-23 01:27:50 -03:00
|
|
|
relposned.iTOW = gps_tow.ms;
|
2020-04-02 08:13:02 -03:00
|
|
|
relposned.relPosN = rel_antenna_pos.x * 100;
|
|
|
|
relposned.relPosE = rel_antenna_pos.y * 100;
|
|
|
|
relposned.relPosD = rel_antenna_pos.z * 100;
|
|
|
|
relposned.relPosLength = rel_antenna_pos.length() * 100;
|
|
|
|
relposned.relPosHeading = degrees(Vector2f(rel_antenna_pos.x, rel_antenna_pos.y).angle()) * 1.0e5;
|
|
|
|
relposned.flags = gnssFixOK | diffSoln | carrSolnFixed | isMoving | relPosValid | relPosHeadingValid;
|
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
send_ubx(MSG_POSLLH, (uint8_t*)&pos, sizeof(pos));
|
|
|
|
send_ubx(MSG_STATUS, (uint8_t*)&status, sizeof(status));
|
|
|
|
send_ubx(MSG_VELNED, (uint8_t*)&velned, sizeof(velned));
|
|
|
|
send_ubx(MSG_SOL, (uint8_t*)&sol, sizeof(sol));
|
|
|
|
send_ubx(MSG_DOP, (uint8_t*)&dop, sizeof(dop));
|
|
|
|
send_ubx(MSG_PVT, (uint8_t*)&pvt, sizeof(pvt));
|
2021-07-30 07:13:59 -03:00
|
|
|
if (_sitl->gps_hdg_enabled[instance] > SITL::SIM::GPS_HEADING_NONE) {
|
2021-10-16 00:10:40 -03:00
|
|
|
send_ubx(MSG_RELPOSNED, (uint8_t*)&relposned, sizeof(relposned));
|
2020-04-02 08:13:02 -03:00
|
|
|
}
|
2018-01-10 19:33:25 -04:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
if (gps_tow.ms > _next_nav_sv_info_time) {
|
|
|
|
svinfo.itow = gps_tow.ms;
|
2018-01-10 19:33:25 -04:00
|
|
|
svinfo.numCh = 32;
|
|
|
|
svinfo.globalFlags = 4; // u-blox 8/M8
|
|
|
|
// fill in the SV's with some data even though firmware does not currently use it
|
|
|
|
// note that this is not using num_sats as we aren't dynamically creating this to match
|
|
|
|
for (uint8_t i = 0; i < SV_COUNT; i++) {
|
|
|
|
svinfo.sv[i].chn = i;
|
|
|
|
svinfo.sv[i].svid = i;
|
2020-07-07 20:53:01 -03:00
|
|
|
svinfo.sv[i].flags = (i < _sitl->gps_numsats[instance]) ? 0x7 : 0x6; // sv used, diff correction data, orbit information
|
2018-01-10 19:33:25 -04:00
|
|
|
svinfo.sv[i].quality = 7; // code and carrier lock and time synchronized
|
|
|
|
svinfo.sv[i].cno = MAX(20, 30 - i);
|
|
|
|
svinfo.sv[i].elev = MAX(30, 90 - i);
|
|
|
|
svinfo.sv[i].azim = i;
|
|
|
|
// not bothering to fill in prRes
|
|
|
|
}
|
2021-10-16 00:10:40 -03:00
|
|
|
send_ubx(MSG_SVINFO, (uint8_t*)&svinfo, sizeof(svinfo));
|
2023-05-23 01:27:50 -03:00
|
|
|
_next_nav_sv_info_time = gps_tow.ms + 10000; // 10 second delay
|
2018-01-10 19:33:25 -04:00
|
|
|
}
|
2013-02-16 05:16:13 -04:00
|
|
|
}
|
|
|
|
|
2013-08-13 23:11:46 -03:00
|
|
|
/*
|
2016-05-12 13:58:56 -03:00
|
|
|
formatted print of NMEA message, with checksum appended
|
2013-08-13 23:11:46 -03:00
|
|
|
*/
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS_NMEA::nmea_printf(const char *fmt, ...)
|
2013-08-13 23:11:46 -03:00
|
|
|
{
|
|
|
|
va_list ap;
|
|
|
|
|
|
|
|
va_start(ap, fmt);
|
2021-02-06 02:23:58 -04:00
|
|
|
char *s = nmea_vaprintf(fmt, ap);
|
2013-08-13 23:11:46 -03:00
|
|
|
va_end(ap);
|
2021-02-06 02:23:58 -04:00
|
|
|
if (s != nullptr) {
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((const char*)s, strlen(s));
|
2021-02-06 02:23:58 -04:00
|
|
|
free(s);
|
|
|
|
}
|
2013-08-13 23:11:46 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
|
|
|
send a new GPS NMEA packet
|
|
|
|
*/
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_NMEA::publish(const GPS_Data *d)
|
2013-08-13 23:11:46 -03:00
|
|
|
{
|
|
|
|
struct timeval tv;
|
|
|
|
struct tm *tm;
|
|
|
|
char tstring[20];
|
|
|
|
char dstring[20];
|
|
|
|
char lat_string[20];
|
|
|
|
char lng_string[20];
|
|
|
|
|
2016-05-03 19:22:55 -03:00
|
|
|
simulation_timeval(&tv);
|
2013-08-13 23:11:46 -03:00
|
|
|
|
|
|
|
tm = gmtime(&tv.tv_sec);
|
|
|
|
|
|
|
|
// format time string
|
2013-10-23 21:10:04 -03:00
|
|
|
snprintf(tstring, sizeof(tstring), "%02u%02u%06.3f", tm->tm_hour, tm->tm_min, tm->tm_sec + tv.tv_usec*1.0e-6);
|
2013-08-13 23:11:46 -03:00
|
|
|
|
|
|
|
// format date string
|
2013-10-23 21:10:04 -03:00
|
|
|
snprintf(dstring, sizeof(dstring), "%02u%02u%02u", tm->tm_mday, tm->tm_mon+1, tm->tm_year % 100);
|
2013-08-13 23:11:46 -03:00
|
|
|
|
|
|
|
// format latitude
|
|
|
|
double deg = fabs(d->latitude);
|
|
|
|
snprintf(lat_string, sizeof(lat_string), "%02u%08.5f,%c",
|
2015-05-04 21:59:07 -03:00
|
|
|
(unsigned)deg,
|
2013-08-13 23:11:46 -03:00
|
|
|
(deg - int(deg))*60,
|
|
|
|
d->latitude<0?'S':'N');
|
|
|
|
|
|
|
|
// format longitude
|
|
|
|
deg = fabs(d->longitude);
|
|
|
|
snprintf(lng_string, sizeof(lng_string), "%03u%08.5f,%c",
|
2015-05-04 21:59:07 -03:00
|
|
|
(unsigned)deg,
|
2013-08-13 23:11:46 -03:00
|
|
|
(deg - int(deg))*60,
|
|
|
|
d->longitude<0?'W':'E');
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
nmea_printf("$GPGGA,%s,%s,%s,%01d,%02d,%04.1f,%07.2f,M,0.0,M,,",
|
2015-05-04 21:59:07 -03:00
|
|
|
tstring,
|
|
|
|
lat_string,
|
2013-08-13 23:11:46 -03:00
|
|
|
lng_string,
|
2015-05-04 21:59:07 -03:00
|
|
|
d->have_lock?1:0,
|
2020-07-07 20:53:01 -03:00
|
|
|
d->have_lock?_sitl->gps_numsats[instance]:3,
|
2022-12-17 02:36:35 -04:00
|
|
|
1.2,
|
2013-08-13 23:11:46 -03:00
|
|
|
d->altitude);
|
2023-08-06 22:48:25 -03:00
|
|
|
|
|
|
|
const float speed_mps = d->speed_2d();
|
2021-10-23 06:42:04 -03:00
|
|
|
const float speed_knots = speed_mps * M_PER_SEC_TO_KNOTS;
|
2023-08-06 22:48:25 -03:00
|
|
|
const auto heading_rad = d->heading();
|
2017-05-28 01:09:58 -03:00
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
//$GPVTG,133.18,T,120.79,M,0.11,N,0.20,K,A*24
|
|
|
|
nmea_printf("$GPVTG,%.2f,T,%.2f,M,%.2f,N,%.2f,K,A",
|
2017-05-28 01:09:58 -03:00
|
|
|
tstring,
|
2023-08-06 22:48:25 -03:00
|
|
|
heading_rad,
|
|
|
|
heading_rad,
|
2017-05-28 01:09:58 -03:00
|
|
|
speed_knots,
|
|
|
|
speed_knots * KNOTS_TO_METERS_PER_SECOND * 3.6);
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
nmea_printf("$GPRMC,%s,%c,%s,%s,%.2f,%.2f,%s,,",
|
2015-05-04 21:59:07 -03:00
|
|
|
tstring,
|
|
|
|
d->have_lock?'A':'V',
|
2013-08-13 23:11:46 -03:00
|
|
|
lat_string,
|
|
|
|
lng_string,
|
|
|
|
speed_knots,
|
2023-08-06 22:48:25 -03:00
|
|
|
heading_rad,
|
2013-08-13 23:11:46 -03:00
|
|
|
dstring);
|
2017-05-28 01:09:58 -03:00
|
|
|
|
2021-07-30 07:13:59 -03:00
|
|
|
if (_sitl->gps_hdg_enabled[instance] == SITL::SIM::GPS_HEADING_HDT) {
|
2021-10-23 06:42:04 -03:00
|
|
|
nmea_printf("$GPHDT,%.2f,T", d->yaw_deg);
|
2017-05-28 01:09:58 -03:00
|
|
|
}
|
2021-07-30 07:13:59 -03:00
|
|
|
else if (_sitl->gps_hdg_enabled[instance] == SITL::SIM::GPS_HEADING_THS) {
|
2021-10-23 06:42:04 -03:00
|
|
|
nmea_printf("$GPTHS,%.2f,%c,T", d->yaw_deg, d->have_lock ? 'A' : 'V');
|
|
|
|
} else if (_sitl->gps_hdg_enabled[instance] == SITL::SIM::GPS_HEADING_KSXT) {
|
|
|
|
// Unicore support
|
|
|
|
// $KSXT,20211016083433.00,116.31296102,39.95817066,49.4911,223.57,-11.32,330.19,0.024,,1,3,28,27,,,,-0.012,0.021,0.020,,*2D
|
|
|
|
nmea_printf("$KSXT,%04u%02u%02u%02u%02u%02u.%02u,%.8f,%.8f,%.4f,%.2f,%.2f,%.2f,%.2f,%.3f,%u,%u,%u,%u,,,,%.3f,%.3f,%.3f,,",
|
|
|
|
tm->tm_year+1900, tm->tm_mon+1, tm->tm_mday, tm->tm_hour, tm->tm_min, tm->tm_sec, unsigned(tv.tv_usec*1.e-4),
|
|
|
|
d->longitude, d->latitude,
|
|
|
|
d->altitude,
|
|
|
|
wrap_360(d->yaw_deg),
|
|
|
|
d->pitch_deg,
|
2023-08-06 22:48:25 -03:00
|
|
|
heading_rad,
|
2021-10-23 06:42:04 -03:00
|
|
|
speed_mps,
|
|
|
|
d->roll_deg,
|
|
|
|
d->have_lock?1:0, // 2=rtkfloat 3=rtkfixed,
|
|
|
|
3, // fixed rtk yaw solution,
|
|
|
|
d->have_lock?_sitl->gps_numsats[instance]:3,
|
|
|
|
d->have_lock?_sitl->gps_numsats[instance]:3,
|
|
|
|
d->speedE * 3.6,
|
|
|
|
d->speedN * 3.6,
|
|
|
|
-d->speedD * 3.6);
|
2020-07-07 10:17:08 -03:00
|
|
|
}
|
2013-08-13 23:11:46 -03:00
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS_SBP_Common::sbp_send_message(uint16_t msg_type, uint16_t sender_id, uint8_t len, uint8_t *payload)
|
2014-04-04 01:59:04 -03:00
|
|
|
{
|
2015-05-04 21:59:07 -03:00
|
|
|
if (len != 0 && payload == 0) {
|
|
|
|
return; //SBP_NULL_ERROR;
|
|
|
|
}
|
|
|
|
|
|
|
|
uint8_t preamble = 0x55;
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((char*)&preamble, 1);
|
|
|
|
write_to_autopilot((char*)&msg_type, 2);
|
|
|
|
write_to_autopilot((char*)&sender_id, 2);
|
|
|
|
write_to_autopilot((char*)&len, 1);
|
2015-05-04 21:59:07 -03:00
|
|
|
if (len > 0) {
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((char*)payload, len);
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
uint16_t crc;
|
|
|
|
crc = crc16_ccitt((uint8_t*)&(msg_type), 2, 0);
|
|
|
|
crc = crc16_ccitt((uint8_t*)&(sender_id), 2, crc);
|
|
|
|
crc = crc16_ccitt(&(len), 1, crc);
|
|
|
|
crc = crc16_ccitt(payload, len, crc);
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((char*)&crc, 2);
|
2014-04-04 01:59:04 -03:00
|
|
|
}
|
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_SBP::publish(const GPS_Data *d)
|
2014-04-04 01:59:04 -03:00
|
|
|
{
|
2017-04-04 21:00:59 -03:00
|
|
|
struct 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;
|
|
|
|
} hb; // 4 bytes
|
|
|
|
|
2014-04-04 01:59:04 -03:00
|
|
|
struct PACKED sbp_gps_time_t {
|
2015-03-19 16:02:39 -03:00
|
|
|
uint16_t wn; //< GPS week number
|
|
|
|
uint32_t tow; //< GPS Time of Week rounded to the nearest ms
|
|
|
|
int32_t ns; //< Nanosecond remainder of rounded tow
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
2014-04-04 01:59:04 -03:00
|
|
|
} t;
|
|
|
|
struct PACKED sbp_pos_llh_t {
|
2015-03-19 16:02:39 -03:00
|
|
|
uint32_t tow; //< GPS Time of Week
|
|
|
|
double lat; //< Latitude
|
|
|
|
double lon; //< Longitude
|
|
|
|
double height; //< Height
|
|
|
|
uint16_t h_accuracy; //< Horizontal position accuracy estimate
|
|
|
|
uint16_t v_accuracy; //< Vertical position accuracy estimate
|
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
|
|
|
uint8_t flags; //< Status flags
|
2014-04-04 01:59:04 -03:00
|
|
|
} pos;
|
|
|
|
struct PACKED sbp_vel_ned_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week
|
2015-03-19 16:02:39 -03:00
|
|
|
int32_t n; //< Velocity North coordinate
|
|
|
|
int32_t e; //< Velocity East coordinate
|
|
|
|
int32_t d; //< Velocity Down coordinate
|
|
|
|
uint16_t h_accuracy; //< Horizontal velocity accuracy estimate
|
|
|
|
uint16_t v_accuracy; //< Vertical velocity accuracy estimate
|
2014-04-04 01:59:04 -03:00
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
2015-03-19 16:02:39 -03:00
|
|
|
} velned;
|
|
|
|
struct PACKED sbp_dops_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week
|
|
|
|
uint16_t gdop; //< Geometric Dilution of Precision
|
|
|
|
uint16_t pdop; //< Position Dilution of Precision
|
|
|
|
uint16_t tdop; //< Time Dilution of Precision
|
|
|
|
uint16_t hdop; //< Horizontal Dilution of Precision
|
|
|
|
uint16_t vdop; //< Vertical Dilution of Precision
|
2017-04-04 21:00:59 -03:00
|
|
|
uint8_t flags; //< Status flags (reserved)
|
2015-03-19 16:02:39 -03:00
|
|
|
} dops;
|
|
|
|
|
2014-06-01 05:05:54 -03:00
|
|
|
static const uint16_t SBP_HEARTBEAT_MSGTYPE = 0xFFFF;
|
2014-04-04 01:59:04 -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_LLH_MSGTYPE = 0x0201;
|
|
|
|
static const uint16_t SBP_VEL_NED_MSGTYPE = 0x0205;
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
const auto gps_tow = gps_time();
|
2014-04-04 01:59:04 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
t.wn = gps_tow.week;
|
|
|
|
t.tow = gps_tow.ms;
|
2014-04-04 01:59:04 -03:00
|
|
|
t.ns = 0;
|
|
|
|
t.flags = 0;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_GPS_TIME_MSGTYPE, 0x2222, sizeof(t), (uint8_t*)&t);
|
2014-04-04 01:59:04 -03:00
|
|
|
|
|
|
|
if (!d->have_lock) {
|
2015-05-04 21:59:07 -03:00
|
|
|
return;
|
2014-04-04 01:59:04 -03:00
|
|
|
}
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
pos.tow = gps_tow.ms;
|
2014-04-04 01:59:04 -03:00
|
|
|
pos.lon = d->longitude;
|
|
|
|
pos.lat= d->latitude;
|
|
|
|
pos.height = d->altitude;
|
2020-08-20 07:44:20 -03:00
|
|
|
pos.h_accuracy = _sitl->gps_accuracy[instance]*1000;
|
|
|
|
pos.v_accuracy = _sitl->gps_accuracy[instance]*1000;
|
2023-05-19 02:09:44 -03:00
|
|
|
pos.n_sats = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2015-03-19 16:02:39 -03:00
|
|
|
|
|
|
|
// Send single point position solution
|
2014-04-04 01:59:04 -03:00
|
|
|
pos.flags = 0;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_POS_LLH_MSGTYPE, 0x2222, sizeof(pos), (uint8_t*)&pos);
|
2015-03-19 16:02:39 -03:00
|
|
|
// Send "pseudo-absolute" RTK position solution
|
|
|
|
pos.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_POS_LLH_MSGTYPE, 0x2222, sizeof(pos), (uint8_t*)&pos);
|
2014-04-04 01:59:04 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
velned.tow = gps_tow.ms;
|
2014-04-04 01:59:04 -03:00
|
|
|
velned.n = 1e3 * d->speedN;
|
2015-03-19 16:02:39 -03:00
|
|
|
velned.e = 1e3 * d->speedE;
|
|
|
|
velned.d = 1e3 * d->speedD;
|
2014-04-04 01:59:04 -03:00
|
|
|
velned.h_accuracy = 5e3;
|
|
|
|
velned.v_accuracy = 5e3;
|
2023-05-19 02:09:44 -03:00
|
|
|
velned.n_sats = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2014-04-04 01:59:04 -03:00
|
|
|
velned.flags = 0;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_VEL_NED_MSGTYPE, 0x2222, sizeof(velned), (uint8_t*)&velned);
|
2014-04-04 01:59:04 -03:00
|
|
|
|
2014-06-01 05:05:54 -03:00
|
|
|
static uint32_t do_every_count = 0;
|
|
|
|
if (do_every_count % 5 == 0) {
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
dops.tow = gps_tow.ms;
|
2015-05-04 21:59:07 -03:00
|
|
|
dops.gdop = 1;
|
|
|
|
dops.pdop = 1;
|
|
|
|
dops.tdop = 1;
|
|
|
|
dops.hdop = 100;
|
|
|
|
dops.vdop = 1;
|
2017-04-04 21:00:59 -03:00
|
|
|
dops.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_DOPS_MSGTYPE, 0x2222, sizeof(dops),
|
|
|
|
(uint8_t*)&dops);
|
2017-04-04 21:00:59 -03:00
|
|
|
|
|
|
|
hb.protocol_major = 0; //Sends protocol version 0
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_HEARTBEAT_MSGTYPE, 0x2222, sizeof(hb),
|
|
|
|
(uint8_t*)&hb);
|
2017-04-04 21:00:59 -03:00
|
|
|
|
|
|
|
}
|
|
|
|
do_every_count++;
|
|
|
|
}
|
|
|
|
|
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_SBP2::publish(const GPS_Data *d)
|
2017-04-04 21:00:59 -03:00
|
|
|
{
|
|
|
|
struct 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;
|
|
|
|
} hb; // 4 bytes
|
|
|
|
|
|
|
|
struct PACKED sbp_gps_time_t {
|
|
|
|
uint16_t wn; //< GPS week number
|
|
|
|
uint32_t tow; //< GPS Time of Week rounded to the nearest ms
|
|
|
|
int32_t ns; //< Nanosecond remainder of rounded tow
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
|
|
|
} t;
|
|
|
|
struct PACKED sbp_pos_llh_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week
|
|
|
|
double lat; //< Latitude
|
|
|
|
double lon; //< Longitude
|
|
|
|
double height; //< Height
|
|
|
|
uint16_t h_accuracy; //< Horizontal position accuracy estimate
|
|
|
|
uint16_t v_accuracy; //< Vertical position accuracy estimate
|
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
|
|
|
uint8_t flags; //< Status flags
|
|
|
|
} pos;
|
|
|
|
struct PACKED sbp_vel_ned_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week
|
|
|
|
int32_t n; //< Velocity North coordinate
|
|
|
|
int32_t e; //< Velocity East coordinate
|
|
|
|
int32_t d; //< Velocity Down coordinate
|
|
|
|
uint16_t h_accuracy; //< Horizontal velocity accuracy estimate
|
|
|
|
uint16_t v_accuracy; //< Vertical velocity accuracy estimate
|
|
|
|
uint8_t n_sats; //< Number of satellites used in solution
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
|
|
|
} velned;
|
|
|
|
struct PACKED sbp_dops_t {
|
|
|
|
uint32_t tow; //< GPS Time of Week
|
|
|
|
uint16_t gdop; //< Geometric Dilution of Precision
|
|
|
|
uint16_t pdop; //< Position Dilution of Precision
|
|
|
|
uint16_t tdop; //< Time Dilution of Precision
|
|
|
|
uint16_t hdop; //< Horizontal Dilution of Precision
|
|
|
|
uint16_t vdop; //< Vertical Dilution of Precision
|
|
|
|
uint8_t flags; //< Status flags (reserved)
|
|
|
|
} dops;
|
|
|
|
|
|
|
|
static const uint16_t SBP_HEARTBEAT_MSGTYPE = 0xFFFF;
|
|
|
|
static const uint16_t SBP_GPS_TIME_MSGTYPE = 0x0102;
|
|
|
|
static const uint16_t SBP_DOPS_MSGTYPE = 0x0208;
|
|
|
|
static const uint16_t SBP_POS_LLH_MSGTYPE = 0x020A;
|
|
|
|
static const uint16_t SBP_VEL_NED_MSGTYPE = 0x020E;
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
const auto gps_tow = gps_time();
|
2017-04-04 21:00:59 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
t.wn = gps_tow.week;
|
|
|
|
t.tow = gps_tow.ms;
|
2017-04-04 21:00:59 -03:00
|
|
|
t.ns = 0;
|
|
|
|
t.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_GPS_TIME_MSGTYPE, 0x2222, sizeof(t), (uint8_t*)&t);
|
2017-04-04 21:00:59 -03:00
|
|
|
|
|
|
|
if (!d->have_lock) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
pos.tow = gps_tow.ms;
|
2017-04-04 21:00:59 -03:00
|
|
|
pos.lon = d->longitude;
|
|
|
|
pos.lat= d->latitude;
|
|
|
|
pos.height = d->altitude;
|
2020-08-20 07:44:20 -03:00
|
|
|
pos.h_accuracy = _sitl->gps_accuracy[instance]*1000;
|
|
|
|
pos.v_accuracy = _sitl->gps_accuracy[instance]*1000;
|
2023-05-19 02:09:44 -03:00
|
|
|
pos.n_sats = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2017-04-04 21:00:59 -03:00
|
|
|
|
|
|
|
// Send single point position solution
|
|
|
|
pos.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_POS_LLH_MSGTYPE, 0x2222, sizeof(pos), (uint8_t*)&pos);
|
2017-04-04 21:00:59 -03:00
|
|
|
// Send "pseudo-absolute" RTK position solution
|
|
|
|
pos.flags = 4;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_POS_LLH_MSGTYPE, 0x2222, sizeof(pos), (uint8_t*)&pos);
|
2017-04-04 21:00:59 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
velned.tow = gps_tow.ms;
|
2017-04-04 21:00:59 -03:00
|
|
|
velned.n = 1e3 * d->speedN;
|
|
|
|
velned.e = 1e3 * d->speedE;
|
|
|
|
velned.d = 1e3 * d->speedD;
|
|
|
|
velned.h_accuracy = 5e3;
|
|
|
|
velned.v_accuracy = 5e3;
|
2023-05-19 02:09:44 -03:00
|
|
|
velned.n_sats = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2017-04-04 21:00:59 -03:00
|
|
|
velned.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_VEL_NED_MSGTYPE, 0x2222, sizeof(velned), (uint8_t*)&velned);
|
2017-04-04 21:00:59 -03:00
|
|
|
|
|
|
|
static uint32_t do_every_count = 0;
|
|
|
|
if (do_every_count % 5 == 0) {
|
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
dops.tow = gps_tow.ms;
|
2017-04-04 21:00:59 -03:00
|
|
|
dops.gdop = 1;
|
|
|
|
dops.pdop = 1;
|
|
|
|
dops.tdop = 1;
|
|
|
|
dops.hdop = 100;
|
|
|
|
dops.vdop = 1;
|
|
|
|
dops.flags = 1;
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_DOPS_MSGTYPE, 0x2222, sizeof(dops),
|
|
|
|
(uint8_t*)&dops);
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2017-04-04 21:00:59 -03:00
|
|
|
hb.protocol_major = 2; //Sends protocol version 2.0
|
2021-10-16 00:10:40 -03:00
|
|
|
sbp_send_message(SBP_HEARTBEAT_MSGTYPE, 0x2222, sizeof(hb),
|
|
|
|
(uint8_t*)&hb);
|
2014-06-01 05:05:54 -03:00
|
|
|
}
|
|
|
|
do_every_count++;
|
2014-04-04 01:59:04 -03:00
|
|
|
}
|
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_NOVA::publish(const GPS_Data *d)
|
2016-05-16 10:09:06 -03:00
|
|
|
{
|
|
|
|
static struct PACKED nova_header
|
|
|
|
{
|
|
|
|
// 0
|
|
|
|
uint8_t preamble[3];
|
|
|
|
// 3
|
|
|
|
uint8_t headerlength;
|
|
|
|
// 4
|
|
|
|
uint16_t messageid;
|
|
|
|
// 6
|
|
|
|
uint8_t messagetype;
|
|
|
|
//7
|
|
|
|
uint8_t portaddr;
|
|
|
|
//8
|
|
|
|
uint16_t messagelength;
|
|
|
|
//10
|
|
|
|
uint16_t sequence;
|
|
|
|
//12
|
|
|
|
uint8_t idletime;
|
|
|
|
//13
|
|
|
|
uint8_t timestatus;
|
|
|
|
//14
|
|
|
|
uint16_t week;
|
|
|
|
//16
|
|
|
|
uint32_t tow;
|
|
|
|
//20
|
|
|
|
uint32_t recvstatus;
|
|
|
|
// 24
|
|
|
|
uint16_t resv;
|
|
|
|
//26
|
|
|
|
uint16_t recvswver;
|
|
|
|
} header;
|
|
|
|
|
|
|
|
struct PACKED psrdop
|
|
|
|
{
|
|
|
|
float gdop;
|
|
|
|
float pdop;
|
|
|
|
float hdop;
|
|
|
|
float htdop;
|
|
|
|
float tdop;
|
|
|
|
float cutoff;
|
|
|
|
uint32_t svcount;
|
|
|
|
// extra data for individual prns
|
2018-12-30 03:33:27 -04:00
|
|
|
} psrdop {};
|
2016-05-16 10:09:06 -03:00
|
|
|
|
|
|
|
struct PACKED bestpos
|
|
|
|
{
|
|
|
|
uint32_t solstat;
|
|
|
|
uint32_t postype;
|
|
|
|
double lat;
|
|
|
|
double lng;
|
|
|
|
double hgt;
|
|
|
|
float undulation;
|
|
|
|
uint32_t datumid;
|
|
|
|
float latsdev;
|
|
|
|
float lngsdev;
|
|
|
|
float hgtsdev;
|
|
|
|
// 4 bytes
|
|
|
|
uint8_t stnid[4];
|
|
|
|
float diffage;
|
|
|
|
float sol_age;
|
|
|
|
uint8_t svstracked;
|
|
|
|
uint8_t svsused;
|
|
|
|
uint8_t svsl1;
|
|
|
|
uint8_t svsmultfreq;
|
|
|
|
uint8_t resv;
|
|
|
|
uint8_t extsolstat;
|
|
|
|
uint8_t galbeisigmask;
|
|
|
|
uint8_t gpsglosigmask;
|
2018-12-30 03:33:27 -04:00
|
|
|
} bestpos {};
|
2016-05-16 10:09:06 -03:00
|
|
|
|
|
|
|
struct PACKED bestvel
|
|
|
|
{
|
|
|
|
uint32_t solstat;
|
|
|
|
uint32_t veltype;
|
|
|
|
float latency;
|
|
|
|
float age;
|
|
|
|
double horspd;
|
|
|
|
double trkgnd;
|
|
|
|
// + up
|
|
|
|
double vertspd;
|
|
|
|
float resv;
|
2018-12-30 03:33:27 -04:00
|
|
|
} bestvel {};
|
2016-05-16 10:09:06 -03:00
|
|
|
|
2023-05-23 01:27:50 -03:00
|
|
|
const auto gps_tow = gps_time();
|
2016-05-16 10:09:06 -03:00
|
|
|
|
|
|
|
header.preamble[0] = 0xaa;
|
|
|
|
header.preamble[1] = 0x44;
|
|
|
|
header.preamble[2] = 0x12;
|
|
|
|
header.headerlength = sizeof(header);
|
2023-05-23 01:27:50 -03:00
|
|
|
header.week = gps_tow.week;
|
|
|
|
header.tow = gps_tow.ms;
|
2016-05-16 10:09:06 -03:00
|
|
|
|
|
|
|
header.messageid = 174;
|
|
|
|
header.messagelength = sizeof(psrdop);
|
|
|
|
header.sequence += 1;
|
|
|
|
|
|
|
|
psrdop.hdop = 1.20;
|
2021-10-16 00:10:40 -03:00
|
|
|
psrdop.htdop = 1.20;
|
|
|
|
nova_send_message((uint8_t*)&header,sizeof(header),(uint8_t*)&psrdop, sizeof(psrdop));
|
|
|
|
|
|
|
|
|
2016-05-16 10:09:06 -03:00
|
|
|
header.messageid = 99;
|
|
|
|
header.messagelength = sizeof(bestvel);
|
|
|
|
header.sequence += 1;
|
|
|
|
|
|
|
|
bestvel.horspd = norm(d->speedN, d->speedE);
|
|
|
|
bestvel.trkgnd = ToDeg(atan2f(d->speedE, d->speedN));
|
|
|
|
bestvel.vertspd = -d->speedD;
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
nova_send_message((uint8_t*)&header,sizeof(header),(uint8_t*)&bestvel, sizeof(bestvel));
|
|
|
|
|
|
|
|
|
2016-05-16 10:09:06 -03:00
|
|
|
header.messageid = 42;
|
|
|
|
header.messagelength = sizeof(bestpos);
|
|
|
|
header.sequence += 1;
|
|
|
|
|
|
|
|
bestpos.lat = d->latitude;
|
|
|
|
bestpos.lng = d->longitude;
|
|
|
|
bestpos.hgt = d->altitude;
|
2023-05-19 02:09:44 -03:00
|
|
|
bestpos.svsused = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2016-05-16 10:09:06 -03:00
|
|
|
bestpos.latsdev=0.2;
|
|
|
|
bestpos.lngsdev=0.2;
|
|
|
|
bestpos.hgtsdev=0.2;
|
|
|
|
bestpos.solstat=0;
|
|
|
|
bestpos.postype=32;
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
nova_send_message((uint8_t*)&header,sizeof(header),(uint8_t*)&bestpos, sizeof(bestpos));
|
2016-05-16 10:09:06 -03:00
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS_NOVA::nova_send_message(uint8_t *header, uint8_t headerlength, uint8_t *payload, uint8_t payloadlen)
|
2016-05-16 10:09:06 -03:00
|
|
|
{
|
2021-10-16 00:10:40 -03:00
|
|
|
write_to_autopilot((char*)header, headerlength);
|
|
|
|
write_to_autopilot((char*)payload, payloadlen);
|
2016-05-16 10:09:06 -03:00
|
|
|
|
|
|
|
uint32_t crc = CalculateBlockCRC32(headerlength, header, (uint32_t)0);
|
|
|
|
crc = CalculateBlockCRC32(payloadlen, payload, crc);
|
2021-10-16 00:10:40 -03:00
|
|
|
|
|
|
|
write_to_autopilot((char*)&crc, 4);
|
2016-05-16 10:09:06 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
#define CRC32_POLYNOMIAL 0xEDB88320L
|
2023-08-09 01:36:44 -03:00
|
|
|
uint32_t GPS_NOVA::CRC32Value(uint32_t icrc)
|
2016-05-16 10:09:06 -03:00
|
|
|
{
|
|
|
|
int i;
|
|
|
|
uint32_t crc = icrc;
|
|
|
|
for ( i = 8 ; i > 0; i-- )
|
|
|
|
{
|
|
|
|
if ( crc & 1 )
|
|
|
|
crc = ( crc >> 1 ) ^ CRC32_POLYNOMIAL;
|
|
|
|
else
|
|
|
|
crc >>= 1;
|
|
|
|
}
|
|
|
|
return crc;
|
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
uint32_t GPS_NOVA::CalculateBlockCRC32(uint32_t length, uint8_t *buffer, uint32_t crc)
|
2016-05-16 10:09:06 -03:00
|
|
|
{
|
|
|
|
while ( length-- != 0 )
|
|
|
|
{
|
|
|
|
crc = ((crc >> 8) & 0x00FFFFFFL) ^ (CRC32Value(((uint32_t) crc ^ *buffer++) & 0xff));
|
|
|
|
}
|
|
|
|
return( crc );
|
|
|
|
}
|
2015-08-30 03:53:29 -03:00
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_GSOF::publish(const GPS_Data *d)
|
2023-05-19 02:09:44 -03:00
|
|
|
{
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/index.html#GSOFmessages_TIME.html?TocPath=Output%2520Messages%257CGSOF%2520Messages%257C_____25
|
|
|
|
constexpr uint8_t GSOF_POS_TIME_TYPE { 0x01 };
|
|
|
|
constexpr uint8_t GSOF_POS_TIME_LEN { 0x0A };
|
|
|
|
// TODO magic number until SITL supports GPS bootcount based on GPSN_ENABLE
|
|
|
|
const uint8_t bootcount = 17;
|
|
|
|
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Position%20flags%201
|
|
|
|
enum class POS_FLAGS_1 : uint8_t {
|
|
|
|
NEW_POSITION = 1U << 0,
|
|
|
|
CLOCK_FIX_CALULATED = 1U << 1,
|
|
|
|
HORIZ_FROM_THIS_POS = 1U << 2,
|
|
|
|
HEIGHT_FROM_THIS_POS = 1U << 3,
|
|
|
|
RESERVED_4 = 1U << 4,
|
|
|
|
LEAST_SQ_POSITION = 1U << 5,
|
|
|
|
RESERVED_6 = 1U << 6,
|
|
|
|
POSITION_L1_PSEUDORANGES = 1U << 7
|
|
|
|
};
|
|
|
|
const uint8_t pos_flags_1 {
|
|
|
|
uint8_t(POS_FLAGS_1::NEW_POSITION) |
|
|
|
|
uint8_t(POS_FLAGS_1::CLOCK_FIX_CALULATED) |
|
|
|
|
uint8_t(POS_FLAGS_1::HORIZ_FROM_THIS_POS) |
|
|
|
|
uint8_t(POS_FLAGS_1::HEIGHT_FROM_THIS_POS) |
|
|
|
|
uint8_t(POS_FLAGS_1::RESERVED_4) |
|
|
|
|
uint8_t(POS_FLAGS_1::LEAST_SQ_POSITION) |
|
|
|
|
uint8_t(POS_FLAGS_1::POSITION_L1_PSEUDORANGES)
|
|
|
|
};
|
|
|
|
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Position%20flags%202
|
|
|
|
enum class POS_FLAGS_2 : uint8_t {
|
|
|
|
DIFFERENTIAL_POS = 1U << 0,
|
|
|
|
DIFFERENTIAL_POS_PHASE_RTK = 1U << 1,
|
|
|
|
POSITION_METHOD_FIXED_PHASE = 1U << 2,
|
|
|
|
OMNISTAR_ACTIVE = 1U << 3,
|
|
|
|
DETERMINED_WITH_STATIC_CONSTRAINT = 1U << 4,
|
|
|
|
NETWORK_RTK = 1U << 5,
|
|
|
|
DITHERED_RTK = 1U << 6,
|
|
|
|
BEACON_DGNSS = 1U << 7,
|
|
|
|
};
|
|
|
|
|
|
|
|
// Simulate a GPS without RTK in SIM since there is no RTK SIM params.
|
|
|
|
// This means these flags are unset:
|
|
|
|
// NETWORK_RTK, DITHERED_RTK, BEACON_DGNSS
|
|
|
|
uint8_t pos_flags_2 {0};
|
|
|
|
if(d->have_lock) {
|
|
|
|
pos_flags_2 |= uint8_t(POS_FLAGS_2::DIFFERENTIAL_POS);
|
|
|
|
pos_flags_2 |= uint8_t(POS_FLAGS_2::DIFFERENTIAL_POS_PHASE_RTK);
|
|
|
|
pos_flags_2 |= uint8_t(POS_FLAGS_2::POSITION_METHOD_FIXED_PHASE);
|
|
|
|
pos_flags_2 |= uint8_t(POS_FLAGS_2::OMNISTAR_ACTIVE);
|
|
|
|
pos_flags_2 |= uint8_t(POS_FLAGS_2::DETERMINED_WITH_STATIC_CONSTRAINT);
|
|
|
|
}
|
|
|
|
|
|
|
|
const auto gps_tow = gps_time();
|
|
|
|
const struct PACKED gsof_pos_time {
|
|
|
|
const uint8_t OUTPUT_RECORD_TYPE;
|
|
|
|
const uint8_t RECORD_LEN;
|
|
|
|
uint32_t time_week_ms;
|
|
|
|
uint16_t time_week;
|
|
|
|
uint8_t num_sats;
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Position%20flags%201
|
|
|
|
uint8_t pos_flags_1;
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Position%20flags%202
|
|
|
|
uint8_t pos_flags_2;
|
|
|
|
uint8_t initialized_num;
|
|
|
|
} pos_time {
|
|
|
|
GSOF_POS_TIME_TYPE,
|
|
|
|
GSOF_POS_TIME_LEN,
|
|
|
|
htobe32(gps_tow.ms),
|
|
|
|
htobe16(gps_tow.week),
|
|
|
|
d->have_lock ? _sitl->gps_numsats[instance] : uint8_t(3),
|
|
|
|
pos_flags_1,
|
|
|
|
pos_flags_2,
|
|
|
|
bootcount
|
|
|
|
};
|
|
|
|
static_assert(sizeof(gsof_pos_time) - (sizeof(gsof_pos_time::OUTPUT_RECORD_TYPE) + sizeof(gsof_pos_time::RECORD_LEN)) == GSOF_POS_TIME_LEN);
|
|
|
|
|
|
|
|
constexpr uint8_t GSOF_POS_TYPE = 0x02;
|
|
|
|
constexpr uint8_t GSOF_POS_LEN = 0x18;
|
|
|
|
|
|
|
|
const struct PACKED gsof_pos {
|
|
|
|
const uint8_t OUTPUT_RECORD_TYPE;
|
|
|
|
const uint8_t RECORD_LEN;
|
|
|
|
uint64_t lat;
|
|
|
|
uint64_t lng;
|
|
|
|
uint64_t alt;
|
|
|
|
} pos {
|
|
|
|
GSOF_POS_TYPE,
|
|
|
|
GSOF_POS_LEN,
|
2023-08-08 23:58:51 -03:00
|
|
|
gsof_pack_double(d->latitude * DEG_TO_RAD_DOUBLE),
|
|
|
|
gsof_pack_double(d->longitude * DEG_TO_RAD_DOUBLE),
|
|
|
|
gsof_pack_double(static_cast<double>(d->altitude))
|
2023-05-19 02:09:44 -03:00
|
|
|
};
|
|
|
|
static_assert(sizeof(gsof_pos) - (sizeof(gsof_pos::OUTPUT_RECORD_TYPE) + sizeof(gsof_pos::RECORD_LEN)) == GSOF_POS_LEN);
|
|
|
|
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Velocity.html
|
|
|
|
constexpr uint8_t GSOF_VEL_TYPE = 0x08;
|
|
|
|
// use the smaller packet by ignoring local coordinate system
|
|
|
|
constexpr uint8_t GSOF_VEL_LEN = 0x0D;
|
|
|
|
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Velocity%20flags
|
|
|
|
enum class VEL_FIELDS : uint8_t {
|
|
|
|
VALID = 1U << 0,
|
|
|
|
CONSECUTIVE_MEASUREMENTS = 1U << 1,
|
|
|
|
HEADING_VALID = 1U << 2,
|
|
|
|
RESERVED_3 = 1U << 3,
|
|
|
|
RESERVED_4 = 1U << 4,
|
|
|
|
RESERVED_5 = 1U << 5,
|
|
|
|
RESERVED_6 = 1U << 6,
|
|
|
|
RESERVED_7 = 1U << 7,
|
|
|
|
};
|
|
|
|
uint8_t vel_flags {0};
|
|
|
|
if(d->have_lock) {
|
|
|
|
vel_flags |= uint8_t(VEL_FIELDS::VALID);
|
|
|
|
vel_flags |= uint8_t(VEL_FIELDS::CONSECUTIVE_MEASUREMENTS);
|
|
|
|
vel_flags |= uint8_t(VEL_FIELDS::HEADING_VALID);
|
|
|
|
}
|
|
|
|
|
|
|
|
const struct PACKED gsof_vel {
|
|
|
|
const uint8_t OUTPUT_RECORD_TYPE;
|
|
|
|
const uint8_t RECORD_LEN;
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/GSOFmessages_Flags.html#Velocity%20flags
|
|
|
|
uint8_t flags;
|
|
|
|
uint32_t horiz_m_p_s;
|
|
|
|
uint32_t heading_rad;
|
|
|
|
uint32_t vertical_m_p_s;
|
|
|
|
} vel {
|
|
|
|
GSOF_VEL_TYPE,
|
|
|
|
GSOF_VEL_LEN,
|
|
|
|
vel_flags,
|
2023-08-08 23:58:51 -03:00
|
|
|
gsof_pack_float(d->speed_2d()),
|
|
|
|
gsof_pack_float(d->heading()),
|
2023-05-19 02:09:44 -03:00
|
|
|
// Trimble API has ambiguous direction here.
|
|
|
|
// Intentionally narrow from double.
|
2023-08-08 23:58:51 -03:00
|
|
|
gsof_pack_float(static_cast<float>(d->speedD))
|
2023-05-19 02:09:44 -03:00
|
|
|
};
|
|
|
|
static_assert(sizeof(gsof_vel) - (sizeof(gsof_vel::OUTPUT_RECORD_TYPE) + sizeof(gsof_vel::RECORD_LEN)) == GSOF_VEL_LEN);
|
|
|
|
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/index.html#GSOFmessages_PDOP.html?TocPath=Output%2520Messages%257CGSOF%2520Messages%257C_____12
|
|
|
|
constexpr uint8_t GSOF_DOP_TYPE = 0x09;
|
|
|
|
constexpr uint8_t GSOF_DOP_LEN = 0x10;
|
|
|
|
const struct PACKED gsof_dop {
|
|
|
|
const uint8_t OUTPUT_RECORD_TYPE { GSOF_DOP_TYPE };
|
|
|
|
const uint8_t RECORD_LEN { GSOF_DOP_LEN };
|
|
|
|
uint32_t pdop = htobe32(1);
|
|
|
|
uint32_t hdop = htobe32(1);
|
|
|
|
uint32_t vdop = htobe32(1);
|
|
|
|
uint32_t tdop = htobe32(1);
|
|
|
|
} dop {};
|
|
|
|
// Check the payload size calculation in the compiler
|
|
|
|
constexpr auto dop_size = sizeof(gsof_dop);
|
|
|
|
static_assert(dop_size == 18);
|
|
|
|
constexpr auto dop_record_type_size = sizeof(gsof_dop::OUTPUT_RECORD_TYPE);
|
|
|
|
static_assert(dop_record_type_size == 1);
|
|
|
|
constexpr auto len_size = sizeof(gsof_dop::RECORD_LEN);
|
|
|
|
static_assert(len_size == 1);
|
|
|
|
constexpr auto dop_payload_size = dop_size - (dop_record_type_size + len_size);
|
|
|
|
static_assert(dop_payload_size == GSOF_DOP_LEN);
|
|
|
|
|
|
|
|
constexpr uint8_t GSOF_POS_SIGMA_TYPE = 0x0C;
|
|
|
|
constexpr uint8_t GSOF_POS_SIGMA_LEN = 0x26;
|
|
|
|
const struct PACKED gsof_pos_sigma {
|
|
|
|
const uint8_t OUTPUT_RECORD_TYPE { GSOF_POS_SIGMA_TYPE };
|
|
|
|
const uint8_t RECORD_LEN { GSOF_POS_SIGMA_LEN };
|
|
|
|
uint32_t pos_rms = htobe32(0);
|
|
|
|
uint32_t sigma_e = htobe32(0);
|
|
|
|
uint32_t sigma_n = htobe32(0);
|
|
|
|
uint32_t cov_en = htobe32(0);
|
|
|
|
uint32_t sigma_up = htobe32(0);
|
|
|
|
uint32_t semi_major_axis = htobe32(0);
|
|
|
|
uint32_t semi_minor_axis = htobe32(0);
|
|
|
|
uint32_t orientation = htobe32(0);
|
|
|
|
uint32_t unit_variance = htobe32(0);
|
|
|
|
uint16_t n_epocs = htobe32(1); // Always 1 for kinematic.
|
|
|
|
} pos_sigma {};
|
|
|
|
static_assert(sizeof(gsof_pos_sigma) - (sizeof(gsof_pos_sigma::OUTPUT_RECORD_TYPE) + sizeof(gsof_pos_sigma::RECORD_LEN)) == GSOF_POS_SIGMA_LEN);
|
|
|
|
|
|
|
|
// TODO add GSOF49
|
|
|
|
const uint8_t payload_sz = sizeof(pos_time) + sizeof(pos) + sizeof(vel) + sizeof(dop) + sizeof(pos_sigma);
|
|
|
|
uint8_t buf[payload_sz] = {};
|
|
|
|
uint8_t offset = 0;
|
|
|
|
memcpy(&buf[offset], &pos_time, sizeof(pos_time));
|
|
|
|
offset += sizeof(pos_time);
|
|
|
|
memcpy(&buf[offset], &pos, sizeof(pos));
|
|
|
|
offset += sizeof(pos);
|
|
|
|
memcpy(&buf[offset], &vel, sizeof(vel));
|
|
|
|
offset += sizeof(vel);
|
|
|
|
memcpy(&buf[offset], &dop, sizeof(dop));
|
|
|
|
offset += sizeof(dop);
|
|
|
|
memcpy(&buf[offset], &pos_sigma, sizeof(pos_sigma));
|
|
|
|
offset += sizeof(pos_sigma);
|
|
|
|
assert(offset == payload_sz);
|
|
|
|
send_gsof(buf, sizeof(buf));
|
|
|
|
}
|
|
|
|
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS_GSOF::send_gsof(const uint8_t *buf, const uint16_t size)
|
2023-05-19 02:09:44 -03:00
|
|
|
{
|
|
|
|
// All Trimble "Data Collector" packets, including GSOF, are comprised of three fields:
|
|
|
|
// * A fixed-length packet header (dcol_header)
|
|
|
|
// * A variable-length data frame (buf)
|
|
|
|
// * A fixed-length packet trailer (dcol_trailer)
|
|
|
|
// Reference: // https://receiverhelp.trimble.com/oem-gnss/index.html#API_DataCollectorFormatPacketStructure.html?TocPath=API%2520Documentation%257CData%2520collector%2520format%2520packets%257CData%2520collector%2520format%253A%2520packet%2520structure%257C_____0
|
|
|
|
|
|
|
|
const uint8_t STX = 0x02;
|
|
|
|
// status bitfield
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/index.html#API_ReceiverStatusByte.html?TocPath=API%2520Documentation%257CData%2520collector%2520format%2520packets%257CData%2520collector%2520format%253A%2520packet%2520structure%257C_____1
|
|
|
|
const uint8_t STATUS = 0xa8;
|
|
|
|
const uint8_t PACKET_TYPE = 0x40; // Report Packet 40h (GENOUT)
|
|
|
|
|
|
|
|
// Before writing the GSOF data buffer, the GSOF header needs added between the DCOL header and the payload data frame.
|
|
|
|
// https://receiverhelp.trimble.com/oem-gnss/index.html#GSOFmessages_GSOF.html?TocPath=Output%2520Messages%257CGSOF%2520Messages%257C_____2
|
|
|
|
|
|
|
|
static uint8_t TRANSMISSION_NUMBER = 0; // Functionally, this is a sequence number
|
|
|
|
// Most messages, even GSOF49, only take one page. For SIM, assume it.
|
|
|
|
assert(size < 0xFA); // GPS SIM doesn't yet support paging
|
|
|
|
constexpr uint8_t PAGE_INDEX = 0;
|
|
|
|
constexpr uint8_t MAX_PAGE_INDEX = 0;
|
|
|
|
const uint8_t gsof_header[3] = {
|
|
|
|
TRANSMISSION_NUMBER,
|
|
|
|
PAGE_INDEX,
|
|
|
|
MAX_PAGE_INDEX,
|
|
|
|
};
|
|
|
|
++TRANSMISSION_NUMBER;
|
|
|
|
|
|
|
|
// A captured GSOF49 packet from BD940 has LENGTH field set to 0x6d = 109 bytes.
|
|
|
|
// A captured GSOF49 packet from BD940 has total bytes of 115 bytes.
|
|
|
|
// Thus, the following 5 bytes are not counted.
|
|
|
|
// 1) STX
|
|
|
|
// 2) STATUS
|
|
|
|
// 3) PACKET TYPE
|
|
|
|
// 4) LENGTH
|
|
|
|
// 5) CHECKSUM
|
|
|
|
// 6) ETX
|
|
|
|
// This aligns with manual's idea of data bytes:
|
|
|
|
// "Each message begins with a 4-byte header, followed by the bytes of data in each packet. The packet ends with a 2-byte trailer."
|
|
|
|
// Thus, for this implementation with single-page single-record per DCOL packet,
|
|
|
|
// the length is simply the sum of data packet size, the gsof_header size.
|
|
|
|
const uint8_t length = size + sizeof(gsof_header);
|
|
|
|
const uint8_t dcol_header[4] {
|
|
|
|
STX,
|
|
|
|
STATUS,
|
|
|
|
PACKET_TYPE,
|
|
|
|
length
|
|
|
|
};
|
|
|
|
|
|
|
|
|
|
|
|
// Sum bytes (status + type + length + data bytes) and modulo 256 the summation
|
|
|
|
// Because it's a uint8, use natural overflow
|
|
|
|
uint8_t csum = STATUS + PACKET_TYPE + length;
|
|
|
|
for (size_t i = 0; i < ARRAY_SIZE(gsof_header); i++) {
|
|
|
|
csum += gsof_header[i];
|
|
|
|
}
|
|
|
|
for (size_t i = 0; i < size; i++) {
|
|
|
|
csum += buf[i];
|
|
|
|
}
|
|
|
|
|
|
|
|
constexpr uint8_t ETX = 0x03;
|
|
|
|
const uint8_t dcol_trailer[2] = {
|
|
|
|
csum,
|
|
|
|
ETX
|
|
|
|
};
|
|
|
|
|
|
|
|
write_to_autopilot((char*)dcol_header, sizeof(dcol_header));
|
|
|
|
write_to_autopilot((char*)gsof_header, sizeof(gsof_header));
|
|
|
|
write_to_autopilot((char*)buf, size);
|
|
|
|
write_to_autopilot((char*)dcol_trailer, sizeof(dcol_trailer));
|
|
|
|
const uint8_t total_size = sizeof(dcol_header) + sizeof(gsof_header) + size + sizeof(dcol_trailer);
|
|
|
|
// Validate length based on everything but DCOL h
|
|
|
|
if(dcol_header[3] != total_size - (sizeof(dcol_header) + sizeof(dcol_trailer))) {
|
|
|
|
INTERNAL_ERROR(AP_InternalError::error_t::flow_of_control);
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2023-08-08 23:58:51 -03:00
|
|
|
uint64_t GPS_GSOF::gsof_pack_double(const double& src)
|
2023-05-19 02:09:44 -03:00
|
|
|
{
|
|
|
|
uint64_t dst;
|
|
|
|
static_assert(sizeof(src) == sizeof(dst));
|
|
|
|
memcpy(&dst, &src, sizeof(dst));
|
|
|
|
dst = htobe64(dst);
|
|
|
|
return dst;
|
|
|
|
}
|
|
|
|
|
2023-08-08 23:58:51 -03:00
|
|
|
uint32_t GPS_GSOF::gsof_pack_float(const float& src)
|
2023-05-19 02:09:44 -03:00
|
|
|
{
|
|
|
|
uint32_t dst;
|
|
|
|
static_assert(sizeof(src) == sizeof(dst));
|
|
|
|
memcpy(&dst, &src, sizeof(dst));
|
|
|
|
dst = htobe32(dst);
|
|
|
|
return dst;
|
|
|
|
}
|
|
|
|
|
2023-07-30 22:40:35 -03:00
|
|
|
/*
|
|
|
|
send MSP GPS data
|
|
|
|
*/
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_MSP::publish(const GPS_Data *d)
|
2023-07-30 22:40:35 -03:00
|
|
|
{
|
|
|
|
struct PACKED {
|
|
|
|
// header
|
|
|
|
struct PACKED {
|
|
|
|
uint8_t dollar = '$';
|
|
|
|
uint8_t magic = 'X';
|
|
|
|
uint8_t code = '<';
|
|
|
|
uint8_t flags;
|
|
|
|
uint16_t cmd = 0x1F03; // GPS
|
|
|
|
uint16_t size = 52;
|
|
|
|
} hdr;
|
|
|
|
uint8_t instance;
|
|
|
|
uint16_t gps_week;
|
|
|
|
uint32_t ms_tow;
|
|
|
|
uint8_t fix_type;
|
|
|
|
uint8_t satellites_in_view;
|
|
|
|
uint16_t horizontal_pos_accuracy; // [cm]
|
|
|
|
uint16_t vertical_pos_accuracy; // [cm]
|
|
|
|
uint16_t horizontal_vel_accuracy; // [cm/s]
|
|
|
|
uint16_t hdop;
|
|
|
|
int32_t longitude;
|
|
|
|
int32_t latitude;
|
|
|
|
int32_t msl_altitude; // cm
|
|
|
|
int32_t ned_vel_north; // cm/s
|
|
|
|
int32_t ned_vel_east;
|
|
|
|
int32_t ned_vel_down;
|
|
|
|
uint16_t ground_course; // deg * 100, 0..36000
|
|
|
|
uint16_t true_yaw; // deg * 100, values of 0..36000 are valid. 65535 = no data available
|
|
|
|
uint16_t year;
|
|
|
|
uint8_t month;
|
|
|
|
uint8_t day;
|
|
|
|
uint8_t hour;
|
|
|
|
uint8_t min;
|
|
|
|
uint8_t sec;
|
|
|
|
|
|
|
|
// footer CRC
|
|
|
|
uint8_t crc;
|
|
|
|
} msp_gps {};
|
|
|
|
|
|
|
|
auto t = gps_time();
|
|
|
|
struct timeval tv;
|
|
|
|
simulation_timeval(&tv);
|
|
|
|
auto *tm = gmtime(&tv.tv_sec);
|
|
|
|
|
|
|
|
msp_gps.gps_week = t.week;
|
|
|
|
msp_gps.ms_tow = t.ms;
|
|
|
|
msp_gps.fix_type = d->have_lock?3:0;
|
2023-05-19 02:09:44 -03:00
|
|
|
msp_gps.satellites_in_view = d->have_lock ? _sitl->gps_numsats[instance] : 3;
|
2023-07-30 22:40:35 -03:00
|
|
|
msp_gps.horizontal_pos_accuracy = _sitl->gps_accuracy[instance]*100;
|
|
|
|
msp_gps.vertical_pos_accuracy = _sitl->gps_accuracy[instance]*100;
|
|
|
|
msp_gps.horizontal_vel_accuracy = 30;
|
|
|
|
msp_gps.hdop = 100;
|
|
|
|
msp_gps.longitude = d->longitude * 1.0e7;
|
|
|
|
msp_gps.latitude = d->latitude * 1.0e7;
|
|
|
|
msp_gps.msl_altitude = d->altitude * 100;
|
|
|
|
msp_gps.ned_vel_north = 100 * d->speedN;
|
|
|
|
msp_gps.ned_vel_east = 100 * d->speedE;
|
|
|
|
msp_gps.ned_vel_down = 100 * d->speedD;
|
|
|
|
msp_gps.ground_course = ToDeg(atan2f(d->speedE, d->speedN)) * 100;
|
|
|
|
msp_gps.true_yaw = wrap_360(d->yaw_deg)*100U; // can send 65535 for no yaw
|
|
|
|
msp_gps.year = tm->tm_year;
|
|
|
|
msp_gps.month = tm->tm_mon;
|
|
|
|
msp_gps.day = tm->tm_mday;
|
|
|
|
msp_gps.hour = tm->tm_hour;
|
|
|
|
msp_gps.min = tm->tm_min;
|
|
|
|
msp_gps.sec = tm->tm_sec;
|
|
|
|
|
|
|
|
// CRC is over packet without first 3 bytes and trailing CRC byte
|
|
|
|
msp_gps.crc = crc8_dvb_s2_update(0, (uint8_t *)&msp_gps.hdr.flags, sizeof(msp_gps)-4);
|
|
|
|
|
|
|
|
write_to_autopilot((const char *)&msp_gps, sizeof(msp_gps));
|
|
|
|
}
|
|
|
|
|
2015-08-30 03:53:29 -03:00
|
|
|
/*
|
2022-10-14 19:38:45 -03:00
|
|
|
read file data logged from AP_GPS_DEBUG_LOGGING_ENABLED
|
2015-08-30 03:53:29 -03:00
|
|
|
*/
|
2021-11-01 01:56:39 -03:00
|
|
|
#if AP_SIM_GPS_FILE_ENABLED
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_FILE::publish(const GPS_Data *d)
|
2015-08-30 03:53:29 -03:00
|
|
|
{
|
2022-10-14 19:38:45 -03:00
|
|
|
static int fd[2] = {-1,-1};
|
|
|
|
static uint32_t base_time[2];
|
2022-12-18 17:01:41 -04:00
|
|
|
const uint16_t lognum = uint16_t(_sitl->gps_log_num.get());
|
2022-10-14 19:38:45 -03:00
|
|
|
if (instance > 1) {
|
2015-08-30 03:53:29 -03:00
|
|
|
return;
|
|
|
|
}
|
2022-10-14 19:38:45 -03:00
|
|
|
if (fd[instance] == -1) {
|
|
|
|
char fname[] = "gpsN_NNN.log";
|
|
|
|
hal.util->snprintf(fname, 13, "gps%u_%03u.log", instance+1, lognum);
|
|
|
|
fd[instance] = open(fname, O_RDONLY|O_CLOEXEC);
|
|
|
|
if (fd[instance] == -1) {
|
|
|
|
return;
|
|
|
|
}
|
2015-08-30 03:53:29 -03:00
|
|
|
}
|
2022-10-14 19:38:45 -03:00
|
|
|
const uint32_t magic = 0x7fe53b04;
|
|
|
|
struct {
|
|
|
|
uint32_t magic;
|
|
|
|
uint32_t time_ms;
|
|
|
|
uint32_t n;
|
|
|
|
} header;
|
|
|
|
uint8_t *buf = nullptr;
|
|
|
|
while (true) {
|
|
|
|
if (::read(fd[instance], (void *)&header, sizeof(header)) != sizeof(header) ||
|
|
|
|
header.magic != magic) {
|
|
|
|
goto rewind_file;
|
|
|
|
}
|
|
|
|
if (header.time_ms+base_time[instance] > AP_HAL::millis()) {
|
|
|
|
// not ready for this data yet
|
|
|
|
::lseek(fd[instance], -sizeof(header), SEEK_CUR);
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
buf = new uint8_t[header.n];
|
|
|
|
if (buf != nullptr && ::read(fd[instance], buf, header.n) == ssize_t(header.n)) {
|
|
|
|
write_to_autopilot((const char *)buf, header.n);
|
|
|
|
delete[] buf;
|
|
|
|
buf = nullptr;
|
|
|
|
continue;
|
|
|
|
}
|
|
|
|
goto rewind_file;
|
2015-08-30 03:53:29 -03:00
|
|
|
}
|
2022-10-14 19:38:45 -03:00
|
|
|
|
|
|
|
rewind_file:
|
|
|
|
::printf("GPS[%u] rewind\n", unsigned(instance));
|
|
|
|
base_time[instance] = AP_HAL::millis();
|
|
|
|
::lseek(fd[instance], 0, SEEK_SET);
|
|
|
|
delete[] buf;
|
2015-08-30 03:53:29 -03:00
|
|
|
}
|
2021-11-01 01:56:39 -03:00
|
|
|
#endif // AP_SIM_GPS_FILE_ENABLED
|
2015-08-30 03:53:29 -03:00
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
void GPS::check_backend_allocation()
|
|
|
|
{
|
|
|
|
const Type configured_type = Type(_sitl->gps_type[instance].get());
|
|
|
|
if (allocated_type == configured_type) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
|
|
|
// mismatch; delete any already-allocated backend:
|
|
|
|
if (backend != nullptr) {
|
|
|
|
delete backend;
|
|
|
|
backend = nullptr;
|
|
|
|
}
|
|
|
|
|
|
|
|
// attempt to allocate backend
|
|
|
|
switch (configured_type) {
|
|
|
|
case Type::NONE:
|
|
|
|
// no GPS attached
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::UBLOX:
|
|
|
|
backend = new GPS_UBlox(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::NMEA:
|
|
|
|
backend = new GPS_NMEA(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::SBP:
|
|
|
|
backend = new GPS_SBP(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::SBP2:
|
|
|
|
backend = new GPS_SBP2(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::NOVA:
|
|
|
|
backend = new GPS_NOVA(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::MSP:
|
|
|
|
backend = new GPS_MSP(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
case Type::GSOF:
|
|
|
|
backend = new GPS_GSOF(*this, instance);
|
|
|
|
break;
|
|
|
|
|
|
|
|
#if AP_SIM_GPS_FILE_ENABLED
|
|
|
|
case Type::FILE:
|
|
|
|
backend = new GPS_FILE(*this, instance);
|
|
|
|
break;
|
|
|
|
#endif
|
|
|
|
};
|
|
|
|
|
|
|
|
allocated_type = configured_type;
|
|
|
|
}
|
|
|
|
|
2013-02-16 05:16:13 -04:00
|
|
|
/*
|
|
|
|
possibly send a new GPS packet
|
|
|
|
*/
|
2021-10-16 00:10:40 -03:00
|
|
|
void GPS::update()
|
2013-02-16 05:16:13 -04:00
|
|
|
{
|
2021-10-16 00:10:40 -03:00
|
|
|
if (!init_sitl_pointer()) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
check_backend_allocation();
|
|
|
|
if (backend == nullptr) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
double latitude =_sitl->state.latitude;
|
|
|
|
double longitude = _sitl->state.longitude;
|
|
|
|
float altitude = _sitl->state.altitude;
|
|
|
|
const double speedN = _sitl->state.speedN;
|
|
|
|
const double speedE = _sitl->state.speedE;
|
|
|
|
const double speedD = _sitl->state.speedD;
|
2022-01-05 20:32:55 -04:00
|
|
|
const uint32_t now_ms = AP_HAL::millis();
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2022-01-05 20:32:55 -04:00
|
|
|
if (now_ms < 20000) {
|
2021-06-17 22:18:18 -03:00
|
|
|
// apply the init offsets for the first 20s. This allows for
|
|
|
|
// having the origin a long way from the takeoff location,
|
|
|
|
// which makes testing long flights easier
|
|
|
|
latitude += _sitl->gps_init_lat_ofs;
|
|
|
|
longitude += _sitl->gps_init_lon_ofs;
|
|
|
|
altitude += _sitl->gps_init_alt_ofs;
|
|
|
|
}
|
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
//Capture current position as basestation location for
|
2020-07-07 20:53:01 -03:00
|
|
|
if (!_gps_has_basestation_position &&
|
2022-01-05 20:32:55 -04:00
|
|
|
now_ms >= _sitl->gps_lock_time[0]*1000UL) {
|
2020-07-07 20:53:01 -03:00
|
|
|
_gps_basestation_data.latitude = latitude;
|
|
|
|
_gps_basestation_data.longitude = longitude;
|
|
|
|
_gps_basestation_data.altitude = altitude;
|
|
|
|
_gps_basestation_data.speedN = speedN;
|
|
|
|
_gps_basestation_data.speedE = speedE;
|
|
|
|
_gps_basestation_data.speedD = speedD;
|
|
|
|
_gps_has_basestation_position = true;
|
2014-04-04 01:59:04 -03:00
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
const uint8_t idx = instance; // alias to avoid code churn
|
2020-07-07 20:53:01 -03:00
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
struct GPS_Data d {};
|
2013-02-16 05:59:48 -04:00
|
|
|
|
2020-07-07 20:53:01 -03:00
|
|
|
// simulate delayed lock times
|
2022-01-05 20:32:55 -04:00
|
|
|
bool have_lock = (!_sitl->gps_disable[idx] && now_ms >= _sitl->gps_lock_time[idx]*1000UL);
|
2013-02-16 05:59:48 -04:00
|
|
|
|
2020-01-26 00:17:20 -04:00
|
|
|
// run at configured GPS rate (default 5Hz)
|
2022-01-05 20:32:55 -04:00
|
|
|
if ((now_ms - last_update) < (uint32_t)(1000/_sitl->gps_hertz[idx])) {
|
2023-11-16 03:04:09 -04:00
|
|
|
backend->update_read();
|
2021-10-16 00:10:40 -03:00
|
|
|
return;
|
2020-01-26 00:17:20 -04:00
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
last_update = now_ms;
|
2020-01-26 00:17:20 -04:00
|
|
|
|
|
|
|
d.latitude = latitude;
|
|
|
|
d.longitude = longitude;
|
2021-10-23 06:42:04 -03:00
|
|
|
d.yaw_deg = _sitl->state.yawDeg;
|
|
|
|
d.roll_deg = _sitl->state.rollDeg;
|
|
|
|
d.pitch_deg = _sitl->state.pitchDeg;
|
|
|
|
|
2020-01-26 00:17:20 -04:00
|
|
|
// add an altitude error controlled by a slow sine wave
|
2022-01-05 20:32:55 -04:00
|
|
|
d.altitude = altitude + _sitl->gps_noise[idx] * sinf(now_ms * 0.0005f) + _sitl->gps_alt_offset[idx];
|
2020-01-26 00:17:20 -04:00
|
|
|
|
2023-08-31 12:30:16 -03:00
|
|
|
// Add offset to c.g. velocity to get velocity at antenna and add simulated error
|
2020-07-26 16:45:06 -03:00
|
|
|
Vector3f velErrorNED = _sitl->gps_vel_err[idx];
|
|
|
|
d.speedN = speedN + (velErrorNED.x * rand_float());
|
|
|
|
d.speedE = speedE + (velErrorNED.y * rand_float());
|
|
|
|
d.speedD = speedD + (velErrorNED.z * rand_float());
|
2020-01-26 00:17:20 -04:00
|
|
|
d.have_lock = have_lock;
|
|
|
|
|
2020-07-07 20:53:01 -03:00
|
|
|
if (_sitl->gps_drift_alt[idx] > 0) {
|
2023-08-31 12:30:16 -03:00
|
|
|
// add slow altitude drift controlled by a slow sine wave
|
2022-01-05 20:32:55 -04:00
|
|
|
d.altitude += _sitl->gps_drift_alt[idx]*sinf(now_ms*0.001f*0.02f);
|
2020-01-26 00:17:20 -04:00
|
|
|
}
|
2016-10-14 22:07:40 -03:00
|
|
|
|
2022-01-13 14:09:19 -04:00
|
|
|
// correct the latitude, longitude, height and NED velocity for the offset between
|
2023-08-31 12:30:16 -03:00
|
|
|
// the vehicle c.g. and GPS antenna
|
2020-01-26 00:17:20 -04:00
|
|
|
Vector3f posRelOffsetBF = _sitl->gps_pos_offset[idx];
|
|
|
|
if (!posRelOffsetBF.is_zero()) {
|
|
|
|
// get a rotation matrix following DCM conventions (body to earth)
|
|
|
|
Matrix3f rotmat;
|
|
|
|
_sitl->state.quaternion.rotation_matrix(rotmat);
|
|
|
|
|
|
|
|
// rotate the antenna offset into the earth frame
|
|
|
|
Vector3f posRelOffsetEF = rotmat * posRelOffsetBF;
|
|
|
|
|
|
|
|
// Add the offset to the latitude, longitude and height using a spherical earth approximation
|
|
|
|
double const earth_rad_inv = 1.569612305760477e-7; // use Authalic/Volumetric radius
|
|
|
|
double lng_scale_factor = earth_rad_inv / cos(radians(d.latitude));
|
|
|
|
d.latitude += degrees(posRelOffsetEF.x * earth_rad_inv);
|
|
|
|
d.longitude += degrees(posRelOffsetEF.y * lng_scale_factor);
|
|
|
|
d.altitude -= posRelOffsetEF.z;
|
|
|
|
|
|
|
|
// calculate a velocity offset due to the antenna position offset and body rotation rate
|
|
|
|
// note: % operator is overloaded for cross product
|
|
|
|
Vector3f gyro(radians(_sitl->state.rollRate),
|
|
|
|
radians(_sitl->state.pitchRate),
|
|
|
|
radians(_sitl->state.yawRate));
|
|
|
|
Vector3f velRelOffsetBF = gyro % posRelOffsetBF;
|
|
|
|
|
|
|
|
// rotate the velocity offset into earth frame and add to the c.g. velocity
|
|
|
|
Vector3f velRelOffsetEF = rotmat * velRelOffsetBF;
|
|
|
|
d.speedN += velRelOffsetEF.x;
|
|
|
|
d.speedE += velRelOffsetEF.y;
|
|
|
|
d.speedD += velRelOffsetEF.z;
|
|
|
|
}
|
2016-10-14 22:07:40 -03:00
|
|
|
|
2022-01-05 20:32:55 -04:00
|
|
|
// get delayed data
|
|
|
|
d.timestamp_ms = now_ms;
|
|
|
|
d = interpolate_data(d, _sitl->gps_delay_ms[instance]);
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2020-01-26 00:17:20 -04:00
|
|
|
// Applying GPS glitch
|
|
|
|
// Using first gps glitch
|
|
|
|
Vector3f glitch_offsets = _sitl->gps_glitch[idx];
|
|
|
|
d.latitude += glitch_offsets.x;
|
|
|
|
d.longitude += glitch_offsets.y;
|
|
|
|
d.altitude += glitch_offsets.z;
|
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
backend->publish(&d);
|
2023-08-09 01:36:44 -03:00
|
|
|
}
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2023-11-16 03:04:09 -04:00
|
|
|
void GPS_Backend::update_read()
|
2023-08-09 01:36:44 -03:00
|
|
|
{
|
|
|
|
// swallow any config bytes
|
|
|
|
char c;
|
|
|
|
read_from_autopilot(&c, 1);
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
2022-01-05 20:32:55 -04:00
|
|
|
/*
|
|
|
|
get delayed data by interpolation
|
|
|
|
*/
|
2023-08-09 01:36:44 -03:00
|
|
|
GPS_Data GPS::interpolate_data(const GPS_Data &d, uint32_t delay_ms)
|
2022-01-05 20:32:55 -04:00
|
|
|
{
|
|
|
|
const uint8_t N = ARRAY_SIZE(_gps_history);
|
|
|
|
const uint32_t now_ms = d.timestamp_ms;
|
|
|
|
|
|
|
|
// add in into history array, shifting old elements
|
|
|
|
memmove(&_gps_history[1], &_gps_history[0], sizeof(_gps_history[0])*(ARRAY_SIZE(_gps_history)-1));
|
|
|
|
_gps_history[0] = d;
|
|
|
|
|
|
|
|
for (uint8_t i=0; i<N-1; i++) {
|
|
|
|
uint32_t dt1 = now_ms - _gps_history[i].timestamp_ms;
|
|
|
|
uint32_t dt2 = now_ms - _gps_history[i+1].timestamp_ms;
|
|
|
|
if (delay_ms >= dt1 && delay_ms <= dt2) {
|
|
|
|
// we will interpolate this pair of samples. Start with
|
|
|
|
// the older sample
|
2023-08-09 01:36:44 -03:00
|
|
|
const GPS_Data &s1 = _gps_history[i+1];
|
|
|
|
const GPS_Data &s2 = _gps_history[i];
|
|
|
|
GPS_Data d2 = s1;
|
2022-01-05 20:32:55 -04:00
|
|
|
const float p = (dt2 - delay_ms) / MAX(1,float(dt2 - dt1));
|
|
|
|
d2.latitude += p * (s2.latitude - s1.latitude);
|
|
|
|
d2.longitude += p * (s2.longitude - s1.longitude);
|
|
|
|
d2.altitude += p * (s2.altitude - s1.altitude);
|
|
|
|
d2.speedN += p * (s2.speedN - s1.speedN);
|
|
|
|
d2.speedE += p * (s2.speedE - s1.speedE);
|
|
|
|
d2.speedD += p * (s2.speedD - s1.speedD);
|
2023-07-30 22:40:35 -03:00
|
|
|
d2.yaw_deg += p * wrap_180(s2.yaw_deg - s1.yaw_deg);
|
2022-01-05 20:32:55 -04:00
|
|
|
return d2;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
// delay is too long, use last sample
|
|
|
|
return _gps_history[N-1];
|
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
float GPS_Data::heading() const
|
2023-08-06 22:48:25 -03:00
|
|
|
{
|
|
|
|
const auto velocity = Vector2d{speedE, speedN};
|
|
|
|
return velocity.angle();
|
|
|
|
}
|
|
|
|
|
2023-08-09 01:36:44 -03:00
|
|
|
float GPS_Data::speed_2d() const
|
2023-08-06 22:48:25 -03:00
|
|
|
{
|
|
|
|
const auto velocity = Vector2d{speedN, speedE};
|
|
|
|
return velocity.length();
|
|
|
|
}
|
|
|
|
|
2021-10-16 00:10:40 -03:00
|
|
|
#endif // HAL_SIM_GPS_ENABLED
|