PX4 Firmware
PX4 Autopilot Software http://px4.io
GPSDriverAshtech Member List

This is the complete list of members for GPSDriverAshtech, including all inherited members.

_base_settingsGPSBaseStationSupportprotected
_boardGPSDriverAshtechprivate
_callbackGPSHelperprotected
_callback_userGPSHelperprotected
_command_stateGPSDriverAshtechprivate
_configure_doneGPSDriverAshtechprivate
_correction_output_activatedGPSDriverAshtechprivate
_decode_stateGPSDriverAshtechprivate
_got_pashr_pos_messageGPSDriverAshtechprivate
_gps_positionGPSDriverAshtechprivate
_heading_offsetGPSDriverAshtechprivate
_interval_rate_startGPSHelperprotected
_last_timestamp_timeGPSDriverAshtechprivate
_output_modeGPSDriverAshtechprivate
_portGPSDriverAshtechprivate
_rate_count_lat_lonGPSHelperprotected
_rate_count_velGPSHelperprotected
_rate_lat_lonGPSHelperprotected
_rate_velGPSHelperprotected
_rtcm_parsingGPSDriverAshtechprivate
_rx_bufferGPSDriverAshtechprivate
_rx_buffer_bytesGPSDriverAshtechprivate
_satellite_infoGPSDriverAshtechprivate
_survey_in_startGPSDriverAshtechprivate
_waiting_for_commandGPSDriverAshtechprivate
activateCorrectionOutput()GPSDriverAshtechprivate
activateRTCMOutput()GPSDriverAshtechprivate
AshtechBoard enum nameGPSDriverAshtechprivate
BaseSettingsType enum nameGPSBaseStationSupportprotected
configure(unsigned &baudrate, OutputMode output_mode) overrideGPSDriverAshtechvirtual
decodeInit(void)GPSDriverAshtechprivate
ECEF2lla(double ecef_x, double ecef_y, double ecef_z, double &latitude, double &longitude, float &altitude)GPSHelperprotectedstatic
getPositionUpdateRate()GPSHelperinline
getVelocityUpdateRate()GPSHelperinline
gotRTCMMessage(uint8_t *buf, int buf_length)GPSHelperinlineprotected
GPSBaseStationSupport(GPSCallbackPtr callback, void *callback_user)GPSBaseStationSupportinline
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)GPSDriverAshtechprivate
Interface enum nameGPSHelper
NMEACommand enum nameGPSDriverAshtechprivate
NMEACommandState enum nameGPSDriverAshtechprivate
NMEADecodeState enum nameGPSDriverAshtechprivate
OutputMode enum nameGPSHelper
parseChar(uint8_t b)GPSDriverAshtechprivate
read(uint8_t *buf, int buf_length, int timeout)GPSHelperinlineprotected
receive(unsigned timeout) overrideGPSDriverAshtechvirtual
receiveWait(unsigned timeout_min)GPSDriverAshtechprivate
reset(GPSRestartType restart_type)GPSHelperinlinevirtual
resetUpdateRates()GPSHelper
sendSurveyInStatusUpdate(bool active, bool valid, double latitude=(double) NAN, double longitude=(double) NAN, float altitude=NAN)GPSDriverAshtechprivate
setBasePosition(double latitude, double longitude, float altitude, float position_accuracy)GPSBaseStationSupportinline
setBaudrate(int baudrate)GPSHelperinlineprotected
setClock(timespec &t)GPSHelperinlineprotected
setSurveyInSpecs(uint32_t survey_in_acc_limit, uint32_t survey_in_min_dur)GPSBaseStationSupportinline
storeUpdateRates()GPSHelper
surveyInStatus(SurveyInStatus &status)GPSHelperinlineprotected
waitForReply(NMEACommand command, const unsigned timeout)GPSDriverAshtechprivate
write(const void *buf, int buf_length)GPSHelperinlineprotected
writeAckedCommand(const void *buf, int buf_length, unsigned timeout)GPSDriverAshtechprivate
~GPSBaseStationSupport()=defaultGPSBaseStationSupportvirtual
~GPSDriverAshtech()GPSDriverAshtechvirtual
~GPSHelper()=defaultGPSHelpervirtual