_base_settings | GPSBaseStationSupport | protected |
_board | GPSDriverAshtech | private |
_callback | GPSHelper | protected |
_callback_user | GPSHelper | protected |
_command_state | GPSDriverAshtech | private |
_configure_done | GPSDriverAshtech | private |
_correction_output_activated | GPSDriverAshtech | private |
_decode_state | GPSDriverAshtech | private |
_got_pashr_pos_message | GPSDriverAshtech | private |
_gps_position | GPSDriverAshtech | private |
_heading_offset | GPSDriverAshtech | private |
_interval_rate_start | GPSHelper | protected |
_last_timestamp_time | GPSDriverAshtech | private |
_output_mode | GPSDriverAshtech | private |
_port | GPSDriverAshtech | private |
_rate_count_lat_lon | GPSHelper | protected |
_rate_count_vel | GPSHelper | protected |
_rate_lat_lon | GPSHelper | protected |
_rate_vel | GPSHelper | protected |
_rtcm_parsing | GPSDriverAshtech | private |
_rx_buffer | GPSDriverAshtech | private |
_rx_buffer_bytes | GPSDriverAshtech | private |
_satellite_info | GPSDriverAshtech | private |
_survey_in_start | GPSDriverAshtech | private |
_waiting_for_command | GPSDriverAshtech | private |
activateCorrectionOutput() | GPSDriverAshtech | private |
activateRTCMOutput() | GPSDriverAshtech | private |
AshtechBoard enum name | GPSDriverAshtech | private |
BaseSettingsType enum name | GPSBaseStationSupport | protected |
configure(unsigned &baudrate, OutputMode output_mode) override | GPSDriverAshtech | virtual |
decodeInit(void) | GPSDriverAshtech | private |
ECEF2lla(double ecef_x, double ecef_y, double ecef_z, double &latitude, double &longitude, float &altitude) | GPSHelper | protectedstatic |
getPositionUpdateRate() | GPSHelper | inline |
getVelocityUpdateRate() | GPSHelper | inline |
gotRTCMMessage(uint8_t *buf, int buf_length) | GPSHelper | inlineprotected |
GPSBaseStationSupport(GPSCallbackPtr callback, void *callback_user) | GPSBaseStationSupport | inline |
GPSDriverAshtech(GPSCallbackPtr callback, void *callback_user, struct vehicle_gps_position_s *gps_position, struct satellite_info_s *satellite_info, float heading_offset=0.f) | GPSDriverAshtech | |
GPSHelper(GPSCallbackPtr callback, void *callback_user) | GPSHelper | |
handleMessage(int len) | GPSDriverAshtech | private |
Interface enum name | GPSHelper | |
NMEACommand enum name | GPSDriverAshtech | private |
NMEACommandState enum name | GPSDriverAshtech | private |
NMEADecodeState enum name | GPSDriverAshtech | private |
OutputMode enum name | GPSHelper | |
parseChar(uint8_t b) | GPSDriverAshtech | private |
read(uint8_t *buf, int buf_length, int timeout) | GPSHelper | inlineprotected |
receive(unsigned timeout) override | GPSDriverAshtech | virtual |
receiveWait(unsigned timeout_min) | GPSDriverAshtech | private |
reset(GPSRestartType restart_type) | GPSHelper | inlinevirtual |
resetUpdateRates() | GPSHelper | |
sendSurveyInStatusUpdate(bool active, bool valid, double latitude=(double) NAN, double longitude=(double) NAN, float altitude=NAN) | GPSDriverAshtech | private |
setBasePosition(double latitude, double longitude, float altitude, float position_accuracy) | GPSBaseStationSupport | inline |
setBaudrate(int baudrate) | GPSHelper | inlineprotected |
setClock(timespec &t) | GPSHelper | inlineprotected |
setSurveyInSpecs(uint32_t survey_in_acc_limit, uint32_t survey_in_min_dur) | GPSBaseStationSupport | inline |
storeUpdateRates() | GPSHelper | |
surveyInStatus(SurveyInStatus &status) | GPSHelper | inlineprotected |
waitForReply(NMEACommand command, const unsigned timeout) | GPSDriverAshtech | private |
write(const void *buf, int buf_length) | GPSHelper | inlineprotected |
writeAckedCommand(const void *buf, int buf_length, unsigned timeout) | GPSDriverAshtech | private |
~GPSBaseStationSupport()=default | GPSBaseStationSupport | virtual |
~GPSDriverAshtech() | GPSDriverAshtech | virtual |
~GPSHelper()=default | GPSHelper | virtual |