#include <config_store.h>
Classes | |
struct | SbgLogOutput |
Private Member Functions | |
template<typename T > | |
T | getParameter (const ros::NodeHandle &ref_node_handle, std::string param_key, int default_value) const |
void | loadAidingAssignementParameters (const ros::NodeHandle &ref_node_handle) |
void | loadCommunicationParameters (const ros::NodeHandle &ref_node_handle) |
void | loadDriverParameters (const ros::NodeHandle &ref_node_handle) |
void | loadGnssParameters (const ros::NodeHandle &ref_node_handle) |
void | loadImuAlignementParameters (const ros::NodeHandle &ref_node_handle) |
void | loadMagnetometersParameters (const ros::NodeHandle &ref_node_handle) |
void | loadOdometerParameters (const ros::NodeHandle &ref_node_handle) |
void | loadOdomParameters (const ros::NodeHandle &ref_node_handle) |
void | loadOutputConfiguration (const ros::NodeHandle &ref_node_handle, const std::string &ref_key, SbgEComClass sbg_msg_class, SbgEComMsgId sbg_msg_id) |
void | loadOutputFrameParameters (const ros::NodeHandle &ref_node_handle) |
void | loadOutputTimeReference (const ros::NodeHandle &ref_node_handle, const std::string &ref_key) |
void | loadSensorParameters (const ros::NodeHandle &ref_node_handle) |
Class to handle the device configuration.
Definition at line 60 of file config_store.h.
ConfigStore::ConfigStore | ( | void | ) |
Default constructor.
Class to handle the device configuration.
Definition at line 13 of file config_store.cpp.
bool ConfigStore::checkConfigWithRos | ( | void | ) | const |
Check if the configuration should be done with ROS.
Definition at line 198 of file config_store.cpp.
bool ConfigStore::checkRosStandardMessages | ( | void | ) | const |
Check if the ROS standard outputs are defined.
Definition at line 323 of file config_store.cpp.
const SbgEComAidingAssignConf & ConfigStore::getAidingAssignement | ( | void | ) | const |
Get the aiding assignement configuration.
Definition at line 263 of file config_store.cpp.
uint32_t ConfigStore::getBaudRate | ( | void | ) | const |
Get the UART baudrate communication.
Definition at line 213 of file config_store.cpp.
const std::string & ConfigStore::getFrameId | ( | void | ) | const |
const SbgEComGnssInstallation & ConfigStore::getGnssInstallation | ( | void | ) | const |
Get the Gnss installation configuration.
Definition at line 293 of file config_store.cpp.
const SbgEComModelInfo & ConfigStore::getGnssModel | ( | void | ) | const |
Get the Gnss model configuration.
Definition at line 288 of file config_store.cpp.
const SbgEComGnssRejectionConf & ConfigStore::getGnssRejection | ( | void | ) | const |
Get the Gnss rejection configuration.
Definition at line 298 of file config_store.cpp.
const SbgEComInitConditionConf & ConfigStore::getInitialConditions | ( | void | ) | const |
Get the initial conditions configuration.
Definition at line 243 of file config_store.cpp.
uint32_t ConfigStore::getInputPortAddress | ( | void | ) | const |
sbgIpAddress ConfigStore::getIpAddress | ( | void | ) | const |
Get the Ip address of the interface.
Definition at line 228 of file config_store.cpp.
const SbgEComMagCalibBandwidth & ConfigStore::getMagnetometerCalibBandwidth | ( | void | ) | const |
Get the magnetometer calibration bandwidth.
Definition at line 283 of file config_store.cpp.
const SbgEComMagCalibMode & ConfigStore::getMagnetometerCalibMode | ( | void | ) | const |
Get the magnetometer calibration mode.
Definition at line 278 of file config_store.cpp.
const SbgEComModelInfo & ConfigStore::getMagnetometerModel | ( | void | ) | const |
Get the magnetometer model configuration.
Definition at line 268 of file config_store.cpp.
const SbgEComMagRejectionConf & ConfigStore::getMagnetometerRejection | ( | void | ) | const |
Get the magnetometer rejection configuration.
Definition at line 273 of file config_store.cpp.
const SbgEComModelInfo & ConfigStore::getMotionProfile | ( | void | ) | const |
Get the motion profile configuration.
Definition at line 248 of file config_store.cpp.
const std::string & ConfigStore::getOdomBaseFrameId | ( | void | ) | const |
Get the odometry base frame ID.
Definition at line 363 of file config_store.cpp.
bool ConfigStore::getOdomEnable | ( | void | ) | const |
Get odom enable.
Definition at line 348 of file config_store.cpp.
const SbgEComOdoConf & ConfigStore::getOdometerConf | ( | void | ) | const |
Get the odometer configuration.
Definition at line 303 of file config_store.cpp.
const sbg::SbgVector3< float > & ConfigStore::getOdometerLevelArms | ( | void | ) | const |
Get the odometer level arms.
Definition at line 308 of file config_store.cpp.
const SbgEComOdoRejectionConf & ConfigStore::getOdometerRejection | ( | void | ) | const |
Get the odometer rejection.
Definition at line 313 of file config_store.cpp.
const std::string & ConfigStore::getOdomFrameId | ( | void | ) | const |
Get the odometry frame ID.
Definition at line 358 of file config_store.cpp.
const std::string & ConfigStore::getOdomInitFrameId | ( | void | ) | const |
Get the odometry init frame ID.
Definition at line 368 of file config_store.cpp.
bool ConfigStore::getOdomPublishTf | ( | void | ) | const |
Get odom publish_tf.
Definition at line 353 of file config_store.cpp.
const std::vector< ConfigStore::SbgLogOutput > & ConfigStore::getOutputModes | ( | void | ) | const |
Get all the output modes.
Definition at line 318 of file config_store.cpp.
SbgEComOutputPort ConfigStore::getOutputPort | ( | void | ) | const |
Get the output port of the device.
Definition at line 218 of file config_store.cpp.
uint32_t ConfigStore::getOutputPortAddress | ( | void | ) | const |
|
inlineprivate |
Get the ROS integer parameter casted in the T type. This function has the same behavior as the param base function, however it enables an implicit cast, and the use of const NodeHandle.
T Template type to cast the ROS param to.
[in] | ref_node_handle | ROS NodeHandle. |
[in] | param_key | Parameter key. |
[in] | default_value | Default value for the parameter. |
Definition at line 139 of file config_store.h.
uint32_t ConfigStore::getReadingRateFrequency | ( | void | ) | const |
Get the reading frequency defined in settings. If this frequency is null, the driver will automatically configure the max output frequency according to the outputs.
Definition at line 328 of file config_store.cpp.
const SbgEComSensorAlignmentInfo & ConfigStore::getSensorAlignement | ( | void | ) | const |
Get the sensor alignement configuration.
Definition at line 253 of file config_store.cpp.
const sbg::SbgVector3< float > & ConfigStore::getSensorLevelArms | ( | void | ) | const |
Get the sensor level arms.
Definition at line 258 of file config_store.cpp.
sbg::TimeReference ConfigStore::getTimeReference | ( | void | ) | const |
const std::string & ConfigStore::getUartPortName | ( | void | ) | const |
Get the UART port name.
Definition at line 208 of file config_store.cpp.
bool ConfigStore::getUseEnu | ( | void | ) | const |
Get use ENU.
Definition at line 338 of file config_store.cpp.
bool ConfigStore::isInterfaceSerial | ( | void | ) | const |
Check if the interface configuration is a serial interface.
Definition at line 203 of file config_store.cpp.
bool ConfigStore::isInterfaceUdp | ( | void | ) | const |
Check if the interface configuration is a UDP interface.
Definition at line 223 of file config_store.cpp.
|
private |
Load aiding assignement parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 98 of file config_store.cpp.
|
private |
Load interface communication parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 40 of file config_store.cpp.
|
private |
Load driver parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 26 of file config_store.cpp.
void ConfigStore::loadFromRosNodeHandle | ( | const ros::NodeHandle & | ref_node_handle | ) |
Load the configuration from a ros parameter handle.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 377 of file config_store.cpp.
|
private |
Load Gnss parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 115 of file config_store.cpp.
|
private |
Load IMU alignement parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 81 of file config_store.cpp.
|
private |
Load magnetometers parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 106 of file config_store.cpp.
|
private |
Load odometer parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 133 of file config_store.cpp.
|
private |
Load odometry parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 31 of file config_store.cpp.
|
private |
Load the output configuration.
[in] | ref_node_handle | ROS nodeHandle. |
[in] | ref_key | String key for the output config. |
[in] | sbg_msg_class | SBG message class. |
[in] | sbg_msg_id | ID of the SBG log. |
Definition at line 149 of file config_store.cpp.
|
private |
Load frame parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 160 of file config_store.cpp.
|
private |
Load output time reference.
[in] | ref_node_handle | ROS nodeHandle. |
[in] | ref_key | String key for the output config. |
Definition at line 174 of file config_store.cpp.
|
private |
Load sensor parameters.
[in] | ref_node_handle | ROS nodeHandle. |
Definition at line 68 of file config_store.cpp.
|
private |
Definition at line 94 of file config_store.h.
|
private |
Definition at line 86 of file config_store.h.
|
private |
Definition at line 115 of file config_store.h.
|
private |
Definition at line 102 of file config_store.h.
|
private |
Definition at line 101 of file config_store.h.
|
private |
Definition at line 103 of file config_store.h.
|
private |
Definition at line 83 of file config_store.h.
|
private |
Definition at line 88 of file config_store.h.
|
private |
Definition at line 99 of file config_store.h.
|
private |
Definition at line 98 of file config_store.h.
|
private |
Definition at line 96 of file config_store.h.
|
private |
Definition at line 97 of file config_store.h.
|
private |
Definition at line 89 of file config_store.h.
|
private |
Definition at line 121 of file config_store.h.
|
private |
Definition at line 118 of file config_store.h.
|
private |
Definition at line 120 of file config_store.h.
|
private |
Definition at line 122 of file config_store.h.
|
private |
Definition at line 119 of file config_store.h.
|
private |
Definition at line 105 of file config_store.h.
|
private |
Definition at line 106 of file config_store.h.
|
private |
Definition at line 107 of file config_store.h.
|
private |
Definition at line 82 of file config_store.h.
|
private |
Definition at line 109 of file config_store.h.
|
private |
Definition at line 77 of file config_store.h.
|
private |
Definition at line 114 of file config_store.h.
|
private |
Definition at line 110 of file config_store.h.
|
private |
Definition at line 81 of file config_store.h.
|
private |
Definition at line 91 of file config_store.h.
|
private |
Definition at line 92 of file config_store.h.
|
private |
Definition at line 79 of file config_store.h.
|
private |
Definition at line 112 of file config_store.h.
|
private |
Definition at line 78 of file config_store.h.
|
private |
Definition at line 76 of file config_store.h.
|
private |
Definition at line 84 of file config_store.h.
|
private |
Definition at line 116 of file config_store.h.