|
uint32_t | baudrate () |
| Returns the baudrate of the serial port connection. Note this is independent of the sensor's on-board serial baudrate setting. More...
|
|
std::string | port () |
| Returns the name of the port the sensor is connected to. More...
|
|
protocol::uart::ErrorDetectionMode | sendErrorDetectionMode () |
| Gets the current error detection mode used for commands sent to the sensor. Default is protocol::uart::ErrorDetectionMode::CHECKSUM. More...
|
|
void | setSendErrorDetectionMode (protocol::uart::ErrorDetectionMode mode) |
| Sets the error detection mode used by the class for commands sent to the sensor. More...
|
|
bool | isConnected () |
| Indicates if the VnSensor is connected. More...
|
|
uint16_t | responseTimeoutMs () |
| Gets the amount of time in milliseconds to wait for a response during read/writes with the sensor. More...
|
|
void | setResponseTimeoutMs (uint16_t timeout) |
| Sets the amount of time in milliseconds to wait for a response during read/writes with the sensor. More...
|
|
uint16_t | retransmitDelayMs () |
| The delay in milliseconds between retransmitting commands. More...
|
|
void | setRetransmitDelayMs (uint16_t delay) |
| Sets the delay in milliseconds between command retransmits. More...
|
|
bool | verifySensorConnectivity () |
| Checks if we are able to send and receive communication with a sensor. More...
|
|
void | connect (const std::string &portName, uint32_t baudrate) |
| Connects to a VectorNav sensor. More...
|
|
void | connect (xplat::IPort *port) |
| Allows connecting to a VectorNav sensor over a vn::common::ISimplePort. More...
|
|
void | disconnect () |
| Disconnects from the VectorNav sensor. More...
|
|
std::string | transaction (std::string toSend) |
| Sends the provided command and returns the response from the sensor. More...
|
|
std::string | send (std::string toSend, bool waitForReply=true, protocol::uart::ErrorDetectionMode errorDetectionMode=protocol::uart::ERRORDETECTIONMODE_CHECKSUM) |
| Writes a raw data string to the sensor, normally appending an appropriate error detection checksum. More...
|
|
void | tare (bool waitForReply=true) |
| Issues a tare command to the VectorNav Sensor. More...
|
|
void | setGyroBias (bool waitForReply=true) |
| Issues a command to the VectorNav Sensor to set the gyro's bias. More...
|
|
void | magneticDisturbancePresent (bool disturbancePresent, bool waitForReply=true) |
| Command to inform the VectorNav Sensor if there is a magnetic disturbance present. More...
|
|
void | accelerationDisturbancePresent (bool disturbancePresent, bool waitForReply=true) |
| Command to inform the VectorNav Sensor if there is an acceleration disturbance present. More...
|
|
void | writeSettings (bool waitForReply=true) |
| Issues a Write Settings command to the VectorNav Sensor. More...
|
|
void | restoreFactorySettings (bool waitForReply=true) |
| Issues a Restore Factory Settings command to the VectorNav sensor. More...
|
|
void | reset (bool waitForReply=true) |
| Issues a Reset command to the VectorNav sensor. More...
|
|
void | changeBaudRate (uint32_t baudrate) |
| Issues a change baudrate to the VectorNav sensor and then reconnects the attached serial port at the new baudrate. More...
|
|
Family | determineDeviceFamily () |
| This method will connect to the specified serial port, query the attached sensor, and determine the type of device. More...
|
|
void | registerRawDataReceivedHandler (void *userData, RawDataReceivedHandler handler) |
| Registers a callback method for notification when raw data is received. More...
|
|
void | unregisterRawDataReceivedHandler () |
| Unregisters the registered callback method.
|
|
void | registerPossiblePacketFoundHandler (void *userData, PossiblePacketFoundHandler handler) |
| Registers a callback method for notification when a new possible packet is found. More...
|
|
void | unregisterPossiblePacketFoundHandler () |
| Unregisters the registered callback method.
|
|
void | registerAsyncPacketReceivedHandler (void *userData, AsyncPacketReceivedHandler handler) |
| Registers a callback method for notification when a new asynchronous data packet is received. More...
|
|
void | unregisterAsyncPacketReceivedHandler () |
| Unregisters the registered callback method.
|
|
void | registerErrorPacketReceivedHandler (void *userData, ErrorPacketReceivedHandler handler) |
| Registers a callback method for notification when an error packet is received. More...
|
|
void | unregisterErrorPacketReceivedHandler () |
| Unregisters the registered callback method.
|
|
BinaryOutputRegister | readBinaryOutput1 () |
| Reads the Binary Output 1 register. More...
|
|
void | writeBinaryOutput1 (BinaryOutputRegister &fields, bool waitForReply=true) |
| Writes to the Binary Output 1 register. More...
|
|
BinaryOutputRegister | readBinaryOutput2 () |
| Reads the Binary Output 2 register. More...
|
|
void | writeBinaryOutput2 (BinaryOutputRegister &fields, bool waitForReply=true) |
| Writes to the Binary Output 2 register. More...
|
|
BinaryOutputRegister | readBinaryOutput3 () |
| Reads the Binary Output 3 register. More...
|
|
void | writeBinaryOutput3 (BinaryOutputRegister &fields, bool waitForReply=true) |
| Writes to the Binary Output 3 register. More...
|
|
uint32_t | readSerialBaudRate (uint8_t port) |
| Reads the Serial Baud Rate register for the specified port. More...
|
|
void | writeSerialBaudRate (const uint32_t &baudrate, uint8_t port, bool waitForReply=true) |
| Writes to the Serial Baud Rate register for the specified port. More...
|
|
protocol::uart::AsciiAsync | readAsyncDataOutputType (uint8_t port) |
| Reads the Async Data Output Type register. More...
|
|
void | writeAsyncDataOutputType (protocol::uart::AsciiAsync ador, uint8_t port, bool waitForReply=true) |
| Writes to the Async Data Output Type register. More...
|
|
uint32_t | readAsyncDataOutputFrequency (uint8_t port) |
| Reads the Async Data Output Frequency register. More...
|
|
void | writeAsyncDataOutputFrequency (const uint32_t &adof, uint8_t port, bool waitForReply=true) |
| Writes to the Async Data Output Frequency register. More...
|
|
InsBasicConfigurationRegisterVn200 | readInsBasicConfigurationVn200 () |
| Reads the INS Basic Configuration register for a VN-200 sensor. More...
|
|
void | writeInsBasicConfigurationVn200 (InsBasicConfigurationRegisterVn200 &fields, bool waitForReply=true) |
| Writes to the INS Basic Configuration register for a VN-200 sensor. More...
|
|
void | writeInsBasicConfigurationVn200 (protocol::uart::Scenario scenario, const uint8_t &ahrsAiding, bool waitForReply=true) |
| Writes to the INS Basic Configuration register for a VN-200 sensor. More...
|
|
InsBasicConfigurationRegisterVn300 | readInsBasicConfigurationVn300 () |
| Reads the INS Basic Configuration register for a VN-300 sensor. More...
|
|
void | writeInsBasicConfigurationVn300 (InsBasicConfigurationRegisterVn300 &fields, bool waitForReply=true) |
| Writes to the INS Basic Configuration register for a VN-300 sensor. More...
|
|
void | writeInsBasicConfigurationVn300 (protocol::uart::Scenario scenario, const uint8_t &ahrsAiding, const uint8_t &estBaseline, bool waitForReply=true) |
| Writes to the INS Basic Configuration register for a VN-300 sensor. More...
|
|
std::string | readUserTag () |
| Reads the User Tag register. More...
|
|
void | writeUserTag (const std::string &tag, bool waitForReply=true) |
| Writes to the User Tag register. More...
|
|
std::string | readModelNumber () |
| Reads the Model Number register. More...
|
|
uint32_t | readHardwareRevision () |
| Reads the Hardware Revision register. More...
|
|
uint32_t | readSerialNumber () |
| Reads the Serial Number register. More...
|
|
std::string | readFirmwareVersion () |
| Reads the Firmware Version register. More...
|
|
uint32_t | readSerialBaudRate () |
| Reads the Serial Baud Rate register. More...
|
|
void | writeSerialBaudRate (const uint32_t &baudrate, bool waitForReply=true) |
| Writes to the Serial Baud Rate register. More...
|
|
protocol::uart::AsciiAsync | readAsyncDataOutputType () |
| Reads the Async Data Output Type register. More...
|
|
void | writeAsyncDataOutputType (protocol::uart::AsciiAsync ador, bool waitForReply=true) |
| Writes to the Async Data Output Type register. More...
|
|
uint32_t | readAsyncDataOutputFrequency () |
| Reads the Async Data Output Frequency register. More...
|
|
void | writeAsyncDataOutputFrequency (const uint32_t &adof, bool waitForReply=true) |
| Writes to the Async Data Output Frequency register. More...
|
|
vn::math::vec3f | readYawPitchRoll () |
| Reads the Yaw Pitch Roll register. More...
|
|
vn::math::vec4f | readAttitudeQuaternion () |
| Reads the Attitude Quaternion register. More...
|
|
QuaternionMagneticAccelerationAndAngularRatesRegister | readQuaternionMagneticAccelerationAndAngularRates () |
| Reads the Quaternion, Magnetic, Acceleration and Angular Rates register. More...
|
|
vn::math::vec3f | readMagneticMeasurements () |
| Reads the Magnetic Measurements register. More...
|
|
vn::math::vec3f | readAccelerationMeasurements () |
| Reads the Acceleration Measurements register. More...
|
|
vn::math::vec3f | readAngularRateMeasurements () |
| Reads the Angular Rate Measurements register. More...
|
|
MagneticAccelerationAndAngularRatesRegister | readMagneticAccelerationAndAngularRates () |
| Reads the Magnetic, Acceleration and Angular Rates register. More...
|
|
MagneticAndGravityReferenceVectorsRegister | readMagneticAndGravityReferenceVectors () |
| Reads the Magnetic and Gravity Reference Vectors register. More...
|
|
void | writeMagneticAndGravityReferenceVectors (MagneticAndGravityReferenceVectorsRegister &fields, bool waitForReply=true) |
| Writes to the Magnetic and Gravity Reference Vectors register. More...
|
|
void | writeMagneticAndGravityReferenceVectors (const vn::math::vec3f &magRef, const vn::math::vec3f &accRef, bool waitForReply=true) |
| Writes to the Magnetic and Gravity Reference Vectors register. More...
|
|
FilterMeasurementsVarianceParametersRegister | readFilterMeasurementsVarianceParameters () |
| Reads the Filter Measurements Variance Parameters register. More...
|
|
void | writeFilterMeasurementsVarianceParameters (FilterMeasurementsVarianceParametersRegister &fields, bool waitForReply=true) |
| Writes to the Filter Measurements Variance Parameters register. More...
|
|
void | writeFilterMeasurementsVarianceParameters (const float &angularWalkVariance, const vn::math::vec3f &angularRateVariance, const vn::math::vec3f &magneticVariance, const vn::math::vec3f &accelerationVariance, bool waitForReply=true) |
| Writes to the Filter Measurements Variance Parameters register. More...
|
|
MagnetometerCompensationRegister | readMagnetometerCompensation () |
| Reads the Magnetometer Compensation register. More...
|
|
void | writeMagnetometerCompensation (MagnetometerCompensationRegister &fields, bool waitForReply=true) |
| Writes to the Magnetometer Compensation register. More...
|
|
void | writeMagnetometerCompensation (const vn::math::mat3f &c, const vn::math::vec3f &b, bool waitForReply=true) |
| Writes to the Magnetometer Compensation register. More...
|
|
FilterActiveTuningParametersRegister | readFilterActiveTuningParameters () |
| Reads the Filter Active Tuning Parameters register. More...
|
|
void | writeFilterActiveTuningParameters (FilterActiveTuningParametersRegister &fields, bool waitForReply=true) |
| Writes to the Filter Active Tuning Parameters register. More...
|
|
void | writeFilterActiveTuningParameters (const float &magneticDisturbanceGain, const float &accelerationDisturbanceGain, const float &magneticDisturbanceMemory, const float &accelerationDisturbanceMemory, bool waitForReply=true) |
| Writes to the Filter Active Tuning Parameters register. More...
|
|
AccelerationCompensationRegister | readAccelerationCompensation () |
| Reads the Acceleration Compensation register. More...
|
|
void | writeAccelerationCompensation (AccelerationCompensationRegister &fields, bool waitForReply=true) |
| Writes to the Acceleration Compensation register. More...
|
|
void | writeAccelerationCompensation (const vn::math::mat3f &c, const vn::math::vec3f &b, bool waitForReply=true) |
| Writes to the Acceleration Compensation register. More...
|
|
vn::math::mat3f | readReferenceFrameRotation () |
| Reads the Reference Frame Rotation register. More...
|
|
void | writeReferenceFrameRotation (const vn::math::mat3f &c, bool waitForReply=true) |
| Writes to the Reference Frame Rotation register. More...
|
|
YawPitchRollMagneticAccelerationAndAngularRatesRegister | readYawPitchRollMagneticAccelerationAndAngularRates () |
| Reads the Yaw, Pitch, Roll, Magnetic, Acceleration and Angular Rates register. More...
|
|
CommunicationProtocolControlRegister | readCommunicationProtocolControl () |
| Reads the Communication Protocol Control register. More...
|
|
void | writeCommunicationProtocolControl (CommunicationProtocolControlRegister &fields, bool waitForReply=true) |
| Writes to the Communication Protocol Control register. More...
|
|
void | writeCommunicationProtocolControl (protocol::uart::CountMode serialCount, protocol::uart::StatusMode serialStatus, protocol::uart::CountMode spiCount, protocol::uart::StatusMode spiStatus, protocol::uart::ChecksumMode serialChecksum, protocol::uart::ChecksumMode spiChecksum, protocol::uart::ErrorMode errorMode, bool waitForReply=true) |
| Writes to the Communication Protocol Control register. More...
|
|
SynchronizationControlRegister | readSynchronizationControl () |
| Reads the Synchronization Control register. More...
|
|
void | writeSynchronizationControl (SynchronizationControlRegister &fields, bool waitForReply=true) |
| Writes to the Synchronization Control register. More...
|
|
void | writeSynchronizationControl (protocol::uart::SyncInMode syncInMode, protocol::uart::SyncInEdge syncInEdge, const uint16_t &syncInSkipFactor, protocol::uart::SyncOutMode syncOutMode, protocol::uart::SyncOutPolarity syncOutPolarity, const uint16_t &syncOutSkipFactor, const uint32_t &syncOutPulseWidth, bool waitForReply=true) |
| Writes to the Synchronization Control register. More...
|
|
SynchronizationStatusRegister | readSynchronizationStatus () |
| Reads the Synchronization Status register. More...
|
|
void | writeSynchronizationStatus (SynchronizationStatusRegister &fields, bool waitForReply=true) |
| Writes to the Synchronization Status register. More...
|
|
void | writeSynchronizationStatus (const uint32_t &syncInCount, const uint32_t &syncInTime, const uint32_t &syncOutCount, bool waitForReply=true) |
| Writes to the Synchronization Status register. More...
|
|
FilterBasicControlRegister | readFilterBasicControl () |
| Reads the Filter Basic Control register. More...
|
|
void | writeFilterBasicControl (FilterBasicControlRegister &fields, bool waitForReply=true) |
| Writes to the Filter Basic Control register. More...
|
|
void | writeFilterBasicControl (protocol::uart::MagneticMode magMode, protocol::uart::ExternalSensorMode extMagMode, protocol::uart::ExternalSensorMode extAccMode, protocol::uart::ExternalSensorMode extGyroMode, const vn::math::vec3f &gyroLimit, bool waitForReply=true) |
| Writes to the Filter Basic Control register. More...
|
|
VpeBasicControlRegister | readVpeBasicControl () |
| Reads the VPE Basic Control register. More...
|
|
void | writeVpeBasicControl (VpeBasicControlRegister &fields, bool waitForReply=true) |
| Writes to the VPE Basic Control register. More...
|
|
void | writeVpeBasicControl (protocol::uart::VpeEnable enable, protocol::uart::HeadingMode headingMode, protocol::uart::VpeMode filteringMode, protocol::uart::VpeMode tuningMode, bool waitForReply=true) |
| Writes to the VPE Basic Control register. More...
|
|
VpeMagnetometerBasicTuningRegister | readVpeMagnetometerBasicTuning () |
| Reads the VPE Magnetometer Basic Tuning register. More...
|
|
void | writeVpeMagnetometerBasicTuning (VpeMagnetometerBasicTuningRegister &fields, bool waitForReply=true) |
| Writes to the VPE Magnetometer Basic Tuning register. More...
|
|
void | writeVpeMagnetometerBasicTuning (const vn::math::vec3f &baseTuning, const vn::math::vec3f &adaptiveTuning, const vn::math::vec3f &adaptiveFiltering, bool waitForReply=true) |
| Writes to the VPE Magnetometer Basic Tuning register. More...
|
|
VpeMagnetometerAdvancedTuningRegister | readVpeMagnetometerAdvancedTuning () |
| Reads the VPE Magnetometer Advanced Tuning register. More...
|
|
void | writeVpeMagnetometerAdvancedTuning (VpeMagnetometerAdvancedTuningRegister &fields, bool waitForReply=true) |
| Writes to the VPE Magnetometer Advanced Tuning register. More...
|
|
void | writeVpeMagnetometerAdvancedTuning (const vn::math::vec3f &minFiltering, const vn::math::vec3f &maxFiltering, const float &maxAdaptRate, const float &disturbanceWindow, const float &maxTuning, bool waitForReply=true) |
| Writes to the VPE Magnetometer Advanced Tuning register. More...
|
|
VpeAccelerometerBasicTuningRegister | readVpeAccelerometerBasicTuning () |
| Reads the VPE Accelerometer Basic Tuning register. More...
|
|
void | writeVpeAccelerometerBasicTuning (VpeAccelerometerBasicTuningRegister &fields, bool waitForReply=true) |
| Writes to the VPE Accelerometer Basic Tuning register. More...
|
|
void | writeVpeAccelerometerBasicTuning (const vn::math::vec3f &baseTuning, const vn::math::vec3f &adaptiveTuning, const vn::math::vec3f &adaptiveFiltering, bool waitForReply=true) |
| Writes to the VPE Accelerometer Basic Tuning register. More...
|
|
VpeAccelerometerAdvancedTuningRegister | readVpeAccelerometerAdvancedTuning () |
| Reads the VPE Accelerometer Advanced Tuning register. More...
|
|
void | writeVpeAccelerometerAdvancedTuning (VpeAccelerometerAdvancedTuningRegister &fields, bool waitForReply=true) |
| Writes to the VPE Accelerometer Advanced Tuning register. More...
|
|
void | writeVpeAccelerometerAdvancedTuning (const vn::math::vec3f &minFiltering, const vn::math::vec3f &maxFiltering, const float &maxAdaptRate, const float &disturbanceWindow, const float &maxTuning, bool waitForReply=true) |
| Writes to the VPE Accelerometer Advanced Tuning register. More...
|
|
VpeGyroBasicTuningRegister | readVpeGyroBasicTuning () |
| Reads the VPE Gyro Basic Tuning register. More...
|
|
void | writeVpeGyroBasicTuning (VpeGyroBasicTuningRegister &fields, bool waitForReply=true) |
| Writes to the VPE Gyro Basic Tuning register. More...
|
|
void | writeVpeGyroBasicTuning (const vn::math::vec3f &angularWalkVariance, const vn::math::vec3f &baseTuning, const vn::math::vec3f &adaptiveTuning, bool waitForReply=true) |
| Writes to the VPE Gyro Basic Tuning register. More...
|
|
vn::math::vec3f | readFilterStartupGyroBias () |
| Reads the Filter Startup Gyro Bias register. More...
|
|
void | writeFilterStartupGyroBias (const vn::math::vec3f &bias, bool waitForReply=true) |
| Writes to the Filter Startup Gyro Bias register. More...
|
|
MagnetometerCalibrationControlRegister | readMagnetometerCalibrationControl () |
| Reads the Magnetometer Calibration Control register. More...
|
|
void | writeMagnetometerCalibrationControl (MagnetometerCalibrationControlRegister &fields, bool waitForReply=true) |
| Writes to the Magnetometer Calibration Control register. More...
|
|
void | writeMagnetometerCalibrationControl (protocol::uart::HsiMode hsiMode, protocol::uart::HsiOutput hsiOutput, const uint8_t &convergeRate, bool waitForReply=true) |
| Writes to the Magnetometer Calibration Control register. More...
|
|
CalculatedMagnetometerCalibrationRegister | readCalculatedMagnetometerCalibration () |
| Reads the Calculated Magnetometer Calibration register. More...
|
|
float | readIndoorHeadingModeControl () |
| Reads the Indoor Heading Mode Control register. More...
|
|
void | writeIndoorHeadingModeControl (const float &maxRateError, bool waitForReply=true) |
| Writes to the Indoor Heading Mode Control register. More...
|
|
vn::math::vec3f | readVelocityCompensationMeasurement () |
| Reads the Velocity Compensation Measurement register. More...
|
|
void | writeVelocityCompensationMeasurement (const vn::math::vec3f &velocity, bool waitForReply=true) |
| Writes to the Velocity Compensation Measurement register. More...
|
|
VelocityCompensationControlRegister | readVelocityCompensationControl () |
| Reads the Velocity Compensation Control register. More...
|
|
void | writeVelocityCompensationControl (VelocityCompensationControlRegister &fields, bool waitForReply=true) |
| Writes to the Velocity Compensation Control register. More...
|
|
void | writeVelocityCompensationControl (protocol::uart::VelocityCompensationMode mode, const float &velocityTuning, const float &rateTuning, bool waitForReply=true) |
| Writes to the Velocity Compensation Control register. More...
|
|
VelocityCompensationStatusRegister | readVelocityCompensationStatus () |
| Reads the Velocity Compensation Status register. More...
|
|
ImuMeasurementsRegister | readImuMeasurements () |
| Reads the IMU Measurements register. More...
|
|
GpsConfigurationRegister | readGpsConfiguration () |
| Reads the GPS Configuration register. More...
|
|
void | writeGpsConfiguration (GpsConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the GPS Configuration register. More...
|
|
void | writeGpsConfiguration (protocol::uart::GpsMode mode, protocol::uart::PpsSource ppsSource, bool waitForReply=true) |
| Writes to the GPS Configuration register. More...
|
|
vn::math::vec3f | readGpsAntennaOffset () |
| Reads the GPS Antenna Offset register. More...
|
|
void | writeGpsAntennaOffset (const vn::math::vec3f &position, bool waitForReply=true) |
| Writes to the GPS Antenna Offset register. More...
|
|
GpsSolutionLlaRegister | readGpsSolutionLla () |
| Reads the GPS Solution - LLA register. More...
|
|
GpsSolutionEcefRegister | readGpsSolutionEcef () |
| Reads the GPS Solution - ECEF register. More...
|
|
InsSolutionLlaRegister | readInsSolutionLla () |
| Reads the INS Solution - LLA register. More...
|
|
InsSolutionEcefRegister | readInsSolutionEcef () |
| Reads the INS Solution - ECEF register. More...
|
|
InsAdvancedConfigurationRegister | readInsAdvancedConfiguration () |
| Reads the INS Advanced Configuration register. More...
|
|
void | writeInsAdvancedConfiguration (InsAdvancedConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the INS Advanced Configuration register. More...
|
|
void | writeInsAdvancedConfiguration (const uint8_t &useMag, const uint8_t &usePres, const uint8_t &posAtt, const uint8_t &velAtt, const uint8_t &velBias, protocol::uart::FoamInit useFoam, const uint8_t &gpsCovType, const uint8_t &velCount, const float &velInit, const float &moveOrigin, const float &gpsTimeout, const float &deltaLimitPos, const float &deltaLimitVel, const float &minPosUncertainty, const float &minVelUncertainty, bool waitForReply=true) |
| Writes to the INS Advanced Configuration register. More...
|
|
InsStateLlaRegister | readInsStateLla () |
| Reads the INS State - LLA register. More...
|
|
InsStateEcefRegister | readInsStateEcef () |
| Reads the INS State - ECEF register. More...
|
|
StartupFilterBiasEstimateRegister | readStartupFilterBiasEstimate () |
| Reads the Startup Filter Bias Estimate register. More...
|
|
void | writeStartupFilterBiasEstimate (StartupFilterBiasEstimateRegister &fields, bool waitForReply=true) |
| Writes to the Startup Filter Bias Estimate register. More...
|
|
void | writeStartupFilterBiasEstimate (const vn::math::vec3f &gyroBias, const vn::math::vec3f &accelBias, const float &pressureBias, bool waitForReply=true) |
| Writes to the Startup Filter Bias Estimate register. More...
|
|
DeltaThetaAndDeltaVelocityRegister | readDeltaThetaAndDeltaVelocity () |
| Reads the Delta Theta and Delta Velocity register. More...
|
|
DeltaThetaAndDeltaVelocityConfigurationRegister | readDeltaThetaAndDeltaVelocityConfiguration () |
| Reads the Delta Theta and Delta Velocity Configuration register. More...
|
|
void | writeDeltaThetaAndDeltaVelocityConfiguration (DeltaThetaAndDeltaVelocityConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the Delta Theta and Delta Velocity Configuration register. More...
|
|
void | writeDeltaThetaAndDeltaVelocityConfiguration (protocol::uart::IntegrationFrame integrationFrame, protocol::uart::CompensationMode gyroCompensation, protocol::uart::CompensationMode accelCompensation, bool waitForReply=true) |
| Writes to the Delta Theta and Delta Velocity Configuration register. More...
|
|
ReferenceVectorConfigurationRegister | readReferenceVectorConfiguration () |
| Reads the Reference Vector Configuration register. More...
|
|
void | writeReferenceVectorConfiguration (ReferenceVectorConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the Reference Vector Configuration register. More...
|
|
void | writeReferenceVectorConfiguration (const uint8_t &useMagModel, const uint8_t &useGravityModel, const uint32_t &recalcThreshold, const float &year, const vn::math::vec3d &position, bool waitForReply=true) |
| Writes to the Reference Vector Configuration register. More...
|
|
GyroCompensationRegister | readGyroCompensation () |
| Reads the Gyro Compensation register. More...
|
|
void | writeGyroCompensation (GyroCompensationRegister &fields, bool waitForReply=true) |
| Writes to the Gyro Compensation register. More...
|
|
void | writeGyroCompensation (const vn::math::mat3f &c, const vn::math::vec3f &b, bool waitForReply=true) |
| Writes to the Gyro Compensation register. More...
|
|
ImuFilteringConfigurationRegister | readImuFilteringConfiguration () |
| Reads the IMU Filtering Configuration register. More...
|
|
void | writeImuFilteringConfiguration (ImuFilteringConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the IMU Filtering Configuration register. More...
|
|
void | writeImuFilteringConfiguration (const uint16_t &magWindowSize, const uint16_t &accelWindowSize, const uint16_t &gyroWindowSize, const uint16_t &tempWindowSize, const uint16_t &presWindowSize, protocol::uart::FilterMode magFilterMode, protocol::uart::FilterMode accelFilterMode, protocol::uart::FilterMode gyroFilterMode, protocol::uart::FilterMode tempFilterMode, protocol::uart::FilterMode presFilterMode, bool waitForReply=true) |
| Writes to the IMU Filtering Configuration register. More...
|
|
GpsCompassBaselineRegister | readGpsCompassBaseline () |
| Reads the GPS Compass Baseline register. More...
|
|
void | writeGpsCompassBaseline (GpsCompassBaselineRegister &fields, bool waitForReply=true) |
| Writes to the GPS Compass Baseline register. More...
|
|
void | writeGpsCompassBaseline (const vn::math::vec3f &position, const vn::math::vec3f &uncertainty, bool waitForReply=true) |
| Writes to the GPS Compass Baseline register. More...
|
|
GpsCompassEstimatedBaselineRegister | readGpsCompassEstimatedBaseline () |
| Reads the GPS Compass Estimated Baseline register. More...
|
|
ImuRateConfigurationRegister | readImuRateConfiguration () |
| Reads the IMU Rate Configuration register. More...
|
|
void | writeImuRateConfiguration (ImuRateConfigurationRegister &fields, bool waitForReply=true) |
| Writes to the IMU Rate Configuration register. More...
|
|
void | writeImuRateConfiguration (const uint16_t &imuRate, const uint16_t &navDivisor, const float &filterTargetRate, const float &filterMinRate, bool waitForReply=true) |
| Writes to the IMU Rate Configuration register. More...
|
|
YawPitchRollTrueBodyAccelerationAndAngularRatesRegister | readYawPitchRollTrueBodyAccelerationAndAngularRates () |
| Reads the Yaw, Pitch, Roll, True Body Acceleration and Angular Rates register. More...
|
|
YawPitchRollTrueInertialAccelerationAndAngularRatesRegister | readYawPitchRollTrueInertialAccelerationAndAngularRates () |
| Reads the Yaw, Pitch, Roll, True Inertial Acceleration and Angular Rates register. More...
|
|