31 #ifndef PARSING_UTILITIES_HPP 32 #define PARSING_UTILITIES_HPP 41 #include <geometry_msgs/Quaternion.h> 67 bool parseDouble(
const std::string&
string,
double& value);
84 bool parseFloat(
const std::string&
string,
float& value);
102 bool parseInt16(
const std::string&
string, int16_t& value, int32_t base = 10);
120 bool parseInt32(
const std::string&
string, int32_t& value, int32_t base = 10);
131 bool parseUInt8(
const std::string&
string, uint8_t& value, int32_t base = 10);
149 bool parseUInt16(
const std::string&
string, uint16_t& value, int32_t base = 10);
167 bool parseUInt32(
const std::string&
string, uint32_t& value, int32_t base = 10);
211 #endif //PARSING_UTILITIES_HPP float parseFloat(const uint8_t *buffer)
Converts a 4-byte-buffer into a float.
double convertUTCDoubleToSeconds(double utc_double)
Converts UTC time from the without-colon-delimiter format to the number-of-seconds-since-midnight for...
uint16_t parseUInt16(const uint8_t *buffer)
Converts a 2-byte-buffer into an unsigned 16-bit integer.
uint32_t parseUInt32(const uint8_t *buffer)
Converts a 4-byte-buffer into an unsigned 32-bit integer.
double convertDMSToDegrees(double dms)
Converts latitude or longitude from the DMS notation (in the without-colon-delimiter format)...
uint32_t convertUserPeriodToRxCommand(uint32_t period_user)
Transforms the input polling period [milliseconds] into a uint32_t number that can be appended to eit...
time_t convertUTCtoUnix(double utc_double)
Converts UTC time from the without-colon-delimiter format to Unix Epoch time (a number-of-seconds-sin...
double parseDouble(const uint8_t *buffer)
Converts an 8-byte-buffer into a double.
int16_t parseInt16(const uint8_t *buffer)
Converts a 2-byte-buffer into a signed 16-bit integer.
int32_t parseInt32(const uint8_t *buffer)
Converts a 4-byte-buffer into a signed 32-bit integer.
bool parseUInt8(const std::string &string, uint8_t &value, int32_t base)
Interprets the contents of "string" as a unsigned integer number of type uint8_t. ...
geometry_msgs::Quaternion convertEulerToQuaternion(double yaw, double pitch, double roll)
Transforms Euler angles to a quaternion.