Go to the source code of this file.
Namespaces | |
novatel_oem7_driver | |
Enumerations | |
enum | novatel_oem7_driver::GPSReferenceTimeStatus { novatel_oem7_driver::GPS_REFTIME_STATUS_UNKNOWN = 20 } |
Functions | |
size_t | novatel_oem7_driver::Get_INSCONFIG_NumRotations (const INSCONFIG_FixedMem *insconfig) |
size_t | novatel_oem7_driver::Get_INSCONFIG_NumTranslations (const INSCONFIG_FixedMem *insconfig) |
const INSCONFIG_RotationMem * | novatel_oem7_driver::Get_INSCONFIG_Rotation (const INSCONFIG_FixedMem *insconfig, size_t idx) |
const INSCONFIG_TranslationMem * | novatel_oem7_driver::Get_INSCONFIG_Translation (const INSCONFIG_FixedMem *insconfig, size_t idx) |
size_t | novatel_oem7_driver::Get_PSRDOP2_NumSystems (const PSRDOP2_FixedMem *psrdop2) |
const PSRDOP2_SystemMem * | novatel_oem7_driver::Get_PSRDOP2_System (const PSRDOP2_FixedMem *psrdop2, size_t idx) |
void | novatel_oem7_driver::getOem7Header (const Oem7RawMessageIf::ConstPtr &raw_msg, novatel_oem7_msgs::Oem7Header::Type &hdr) |
int | novatel_oem7_driver::getOem7MessageId (const std::string &msg_name) |
const std::string & | novatel_oem7_driver::getOem7MessageName (int msg_id) |
void | novatel_oem7_driver::getOem7ShortHeader (const Oem7RawMessageIf::ConstPtr &raw_msg, novatel_oem7_msgs::Oem7Header::Type &hdr) |
void | novatel_oem7_driver::initializeOem7MessageUtil (ros::NodeHandle &nh) |
bool | novatel_oem7_driver::isNMEAMessage (const Oem7RawMessageIf::ConstPtr &raw_msg) |