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

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

_base_settingsGPSBaseStationSupportprotected
_bufGPSDriverSBFprivate
_callbackGPSHelperprotected
_callback_userGPSHelperprotected
_configuredGPSDriverSBFprivate
_decode_stateGPSDriverSBFprivate
_dynamic_modelGPSDriverSBFprivate
_gps_positionGPSDriverSBFprivate
_interval_rate_startGPSHelperprotected
_last_timestamp_timeGPSDriverSBFprivate
_msg_statusGPSDriverSBFprivate
_output_modeGPSDriverSBFprivate
_rate_count_lat_lonGPSHelperprotected
_rate_count_velGPSHelperprotected
_rate_lat_lonGPSHelperprotected
_rate_velGPSHelperprotected
_rtcm_parsingGPSDriverSBFprivate
_rx_payload_indexGPSDriverSBFprivate
_satellite_infoGPSDriverSBFprivate
BaseSettingsType enum nameGPSBaseStationSupportprotected
configure(unsigned &baudrate, OutputMode output_mode) overrideGPSDriverSBF
GPSBaseStationSupport::configure(unsigned &baud, OutputMode output_mode)=0GPSHelperpure virtual
decodeInit(void)GPSDriverSBFprivate
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
GPSDriverSBF(GPSCallbackPtr callback, void *callback_user, struct vehicle_gps_position_s *gps_position, struct satellite_info_s *satellite_info, uint8_t dynamic_model)GPSDriverSBF
GPSHelper(GPSCallbackPtr callback, void *callback_user)GPSHelper
Interface enum nameGPSHelper
OutputMode enum nameGPSHelper
parseChar(const uint8_t b)GPSDriverSBFprivate
payloadRxAdd(const uint8_t b)GPSDriverSBFprivate
payloadRxDone(void)GPSDriverSBFprivate
read(uint8_t *buf, int buf_length, int timeout)GPSHelperinlineprotected
receive(unsigned timeout) overrideGPSDriverSBFvirtual
reset(GPSRestartType restart_type) overrideGPSDriverSBFvirtual
resetUpdateRates()GPSHelper
sendMessage(const char *msg)GPSDriverSBFprivate
sendMessageAndWaitForAck(const char *msg, const int timeout)GPSDriverSBFprivate
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
write(const void *buf, int buf_length)GPSHelperinlineprotected
~GPSBaseStationSupport()=defaultGPSBaseStationSupportvirtual
~GPSDriverSBF() overrideGPSDriverSBFvirtual
~GPSHelper()=defaultGPSHelpervirtual