Functions
packet_publisher.cpp File Reference
#include "unistd.h"
#include <map>
#include <cmath>
#include "packet_publisher.hpp"
Include dependency graph for packet_publisher.cpp:

Go to the source code of this file.

Functions

double BoundFromNegPiToPi (const double _value)
 
double BoundFromNegPiToPi (const float _value)
 
double BoundFromZeroTo2Pi (const double _value)
 
double BoundFromZeroTo2Pi (const float _value)
 
void PublishEcefPosition (ros::Publisher &_publisher, ecef_position_packet_t _packet)
 
void PublishIMU_ENU (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, euler_orientation_standard_deviation_packet_t _eulStdDevPack)
 
void PublishIMU_NED (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, euler_orientation_standard_deviation_packet_t _eulStdDevPack)
 
void PublishIMU_RPY_ENU (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMU_RPY_ENU_DEG (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMU_RPY_NED (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMU_RPY_NED_DEG (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMURaw (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMURawFLU (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishIMUSensorRaw (ros::Publisher &_publisher, raw_sensors_packet_t _rawSensorPack)
 
void PublishIMUSensorRawFLU (ros::Publisher &_publisher, raw_sensors_packet_t _rawSensorPack)
 
void PublishKvhOdometerState (ros::Publisher &_publisher, odometer_state_packet_t _packet)
 
void PublishLocalMagnetics (ros::Publisher &_publisher, local_magnetics_packet_t _packet)
 
void PublishMagField (ros::Publisher &_publisher, raw_sensors_packet_t _rawSensorPack)
 
void PublishNavSatFix (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket)
 
void PublishNorthSeekingStatus (ros::Publisher &_publisher, north_seeking_status_packet_t _packet)
 
void PublishOdomENU (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, utm_position_packet_t _utmPosPacket, euler_orientation_standard_deviation_packet_t _eulStdPacket, body_velocity_packet_t _bodyVelPacket)
 
void PublishOdomNED (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, utm_position_packet_t _utmPosPacket, euler_orientation_standard_deviation_packet_t _eulerStdPacket, body_velocity_packet_t _bodyVelPacket)
 
void PublishOdomSpeed (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, odometer_state_packet_t _odomStatePacket, double _trackWidth, double _odometerVelocityCovariance, bool _encoderOnLeft)
 
void PublishOdomState (ros::Publisher &_publisher, odometer_state_packet_t _odomStatePacket, double odomPulseToMeters)
 
void PublishRawGnss (ros::Publisher &_publisher, raw_gnss_packet_t _packet)
 
void PublishRawNavSatFix (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, raw_gnss_packet_t _rawGnssPacket)
 
void PublishRawSensors (ros::Publisher &_publisher, raw_sensors_packet_t _packet)
 
void PublishSatellites (ros::Publisher &_publisher, satellites_packet_t _packet)
 
void PublishSatellitesDetailed (ros::Publisher &_publisher, detailed_satellites_packet_t _packet)
 
void PublishSystemState (ros::Publisher &_publisher, system_state_packet_t _packet)
 
void PublishUtmPosition (ros::Publisher &_publisher, utm_position_packet_t _packet)
 
void PublishVelBodyTwistFLU (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, body_velocity_packet_t _bodyVelPack, velocity_standard_deviation_packet_t _velStdPack)
 
void PublishVelBodyTwistFRD (ros::Publisher &_publisher, system_state_packet_t _sysStatePacket, body_velocity_packet_t _bodyVelPack, velocity_standard_deviation_packet_t _velStdPack)
 
void PublishVelENUTwist (ros::Publisher &_publisher, system_state_packet_t _sysStatePack, velocity_standard_deviation_packet_t _velStdPack)
 
void PublishVelNEDTwist (ros::Publisher &_publisher, system_state_packet_t _sysStatePack, velocity_standard_deviation_packet_t _velStdPack)
 
tf2::Quaternion quatFromRPY (double roll, double pitch, double yaw)
 

Function Documentation

◆ BoundFromNegPiToPi() [1/2]

double BoundFromNegPiToPi ( const double  _value)

Definition at line 8 of file packet_publisher.cpp.

◆ BoundFromNegPiToPi() [2/2]

double BoundFromNegPiToPi ( const float  _value)

Definition at line 18 of file packet_publisher.cpp.

◆ BoundFromZeroTo2Pi() [1/2]

double BoundFromZeroTo2Pi ( const double  _value)

Definition at line 28 of file packet_publisher.cpp.

◆ BoundFromZeroTo2Pi() [2/2]

double BoundFromZeroTo2Pi ( const float  _value)

Definition at line 33 of file packet_publisher.cpp.

◆ PublishEcefPosition()

void PublishEcefPosition ( ros::Publisher _publisher,
ecef_position_packet_t  _packet 
)

Definition at line 156 of file packet_publisher.cpp.

◆ PublishIMU_ENU()

void PublishIMU_ENU ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
euler_orientation_standard_deviation_packet_t  _eulStdDevPack 
)

Definition at line 366 of file packet_publisher.cpp.

◆ PublishIMU_NED()

void PublishIMU_NED ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
euler_orientation_standard_deviation_packet_t  _eulStdDevPack 
)

Definition at line 324 of file packet_publisher.cpp.

◆ PublishIMU_RPY_ENU()

void PublishIMU_RPY_ENU ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 442 of file packet_publisher.cpp.

◆ PublishIMU_RPY_ENU_DEG()

void PublishIMU_RPY_ENU_DEG ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 462 of file packet_publisher.cpp.

◆ PublishIMU_RPY_NED()

void PublishIMU_RPY_NED ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 407 of file packet_publisher.cpp.

◆ PublishIMU_RPY_NED_DEG()

void PublishIMU_RPY_NED_DEG ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 424 of file packet_publisher.cpp.

◆ PublishIMURaw()

void PublishIMURaw ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 262 of file packet_publisher.cpp.

◆ PublishIMURawFLU()

void PublishIMURawFLU ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 292 of file packet_publisher.cpp.

◆ PublishIMUSensorRaw()

void PublishIMUSensorRaw ( ros::Publisher _publisher,
raw_sensors_packet_t  _rawSensorPack 
)

Definition at line 734 of file packet_publisher.cpp.

◆ PublishIMUSensorRawFLU()

void PublishIMUSensorRawFLU ( ros::Publisher _publisher,
raw_sensors_packet_t  _rawSensorPack 
)

Definition at line 756 of file packet_publisher.cpp.

◆ PublishKvhOdometerState()

void PublishKvhOdometerState ( ros::Publisher _publisher,
odometer_state_packet_t  _packet 
)

Definition at line 188 of file packet_publisher.cpp.

◆ PublishLocalMagnetics()

void PublishLocalMagnetics ( ros::Publisher _publisher,
local_magnetics_packet_t  _packet 
)

Definition at line 133 of file packet_publisher.cpp.

◆ PublishMagField()

void PublishMagField ( ros::Publisher _publisher,
raw_sensors_packet_t  _rawSensorPack 
)

Definition at line 562 of file packet_publisher.cpp.

◆ PublishNavSatFix()

void PublishNavSatFix ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket 
)

Definition at line 483 of file packet_publisher.cpp.

◆ PublishNorthSeekingStatus()

void PublishNorthSeekingStatus ( ros::Publisher _publisher,
north_seeking_status_packet_t  _packet 
)

Definition at line 167 of file packet_publisher.cpp.

◆ PublishOdomENU()

void PublishOdomENU ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
utm_position_packet_t  _utmPosPacket,
euler_orientation_standard_deviation_packet_t  _eulStdPacket,
body_velocity_packet_t  _bodyVelPacket 
)

Definition at line 623 of file packet_publisher.cpp.

◆ PublishOdomNED()

void PublishOdomNED ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
utm_position_packet_t  _utmPosPacket,
euler_orientation_standard_deviation_packet_t  _eulerStdPacket,
body_velocity_packet_t  _bodyVelPacket 
)

Definition at line 575 of file packet_publisher.cpp.

◆ PublishOdomSpeed()

void PublishOdomSpeed ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
odometer_state_packet_t  _odomStatePacket,
double  _trackWidth,
double  _odometerVelocityCovariance,
bool  _encoderOnLeft 
)

Definition at line 702 of file packet_publisher.cpp.

◆ PublishOdomState()

void PublishOdomState ( ros::Publisher _publisher,
odometer_state_packet_t  _odomStatePacket,
double  odomPulseToMeters 
)

Definition at line 679 of file packet_publisher.cpp.

◆ PublishRawGnss()

void PublishRawGnss ( ros::Publisher _publisher,
raw_gnss_packet_t  _packet 
)

Definition at line 226 of file packet_publisher.cpp.

◆ PublishRawNavSatFix()

void PublishRawNavSatFix ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
raw_gnss_packet_t  _rawGnssPacket 
)

Definition at line 522 of file packet_publisher.cpp.

◆ PublishRawSensors()

void PublishRawSensors ( ros::Publisher _publisher,
raw_sensors_packet_t  _packet 
)

Definition at line 201 of file packet_publisher.cpp.

◆ PublishSatellites()

void PublishSatellites ( ros::Publisher _publisher,
satellites_packet_t  _packet 
)

Definition at line 88 of file packet_publisher.cpp.

◆ PublishSatellitesDetailed()

void PublishSatellitesDetailed ( ros::Publisher _publisher,
detailed_satellites_packet_t  _packet 
)

Definition at line 102 of file packet_publisher.cpp.

◆ PublishSystemState()

void PublishSystemState ( ros::Publisher _publisher,
system_state_packet_t  _packet 
)

Definition at line 48 of file packet_publisher.cpp.

◆ PublishUtmPosition()

void PublishUtmPosition ( ros::Publisher _publisher,
utm_position_packet_t  _packet 
)

Definition at line 144 of file packet_publisher.cpp.

◆ PublishVelBodyTwistFLU()

void PublishVelBodyTwistFLU ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
body_velocity_packet_t  _bodyVelPack,
velocity_standard_deviation_packet_t  _velStdPack 
)

Definition at line 807 of file packet_publisher.cpp.

◆ PublishVelBodyTwistFRD()

void PublishVelBodyTwistFRD ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePacket,
body_velocity_packet_t  _bodyVelPack,
velocity_standard_deviation_packet_t  _velStdPack 
)

Definition at line 827 of file packet_publisher.cpp.

◆ PublishVelENUTwist()

void PublishVelENUTwist ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePack,
velocity_standard_deviation_packet_t  _velStdPack 
)

Definition at line 791 of file packet_publisher.cpp.

◆ PublishVelNEDTwist()

void PublishVelNEDTwist ( ros::Publisher _publisher,
system_state_packet_t  _sysStatePack,
velocity_standard_deviation_packet_t  _velStdPack 
)

Definition at line 775 of file packet_publisher.cpp.

◆ quatFromRPY()

tf2::Quaternion quatFromRPY ( double  roll,
double  pitch,
double  yaw 
)

Definition at line 38 of file packet_publisher.cpp.



kvh_geo_fog_3d_driver
Author(s): Trevor Bostic , Zach LaCelle
autogenerated on Wed Mar 2 2022 00:28:57