5 namespace configuration
8 const uint8_t temperatureCompensationActive,
const uint8_t imuActive,
9 const uint8_t coordinateSystemConfigurationActive,
10 const uint8_t inertiaCompensationActive,
11 const uint8_t orientationEstimationActive)
12 : calibrationMatrixActive_(calibrationMatrixActive)
13 , temperatureCompensationActive_(temperatureCompensationActive)
14 , imuActive_(imuActive)
15 , coordinateSystemConfigurationActive_(coordinateSystemConfigurationActive)
16 , inertiaCompensationActive_(inertiaCompensationActive)
17 , orientationEstimationActive_(orientationEstimationActive)
24 std::string local_key;
25 local_key = key +
"/calibration_matrix_active";
26 if (nh->hasParam(local_key))
28 bool calibration_matrix_active;
29 nh->getParam(local_key, calibration_matrix_active);
33 local_key = key +
"/temperature_compensation_active";
34 if (nh->hasParam(local_key))
36 bool temperature_compensation_active;
37 nh->getParam(local_key, temperature_compensation_active);
41 local_key = key +
"/imu_active";
42 if (nh->hasParam(local_key))
45 nh->getParam(local_key, imu_active);
49 local_key = key +
"/coordinate_system_active";
50 if (nh->hasParam(local_key))
52 bool coordinate_system_active;
53 nh->getParam(local_key, coordinate_system_active);
57 local_key = key +
"/inertia_compensation_active";
58 if (nh->hasParam(local_key))
60 int inertia_compensation_active;
61 nh->getParam(local_key, inertia_compensation_active);
65 local_key = key +
"/orientation_estimation_active";
66 if (nh->hasParam(local_key))
68 int orientation_estimation_active;
69 nh->getParam(local_key, orientation_estimation_active);
uint8_t inertiaCompensationActive_
void print() const
Prints the existing sensor configuration settings.
uint8_t orientationEstimationActive_
std::shared_ptr< ros::NodeHandle > NodeHandlePtr
uint8_t temperatureCompensationActive_
uint8_t coordinateSystemConfigurationActive_
#define ROS_INFO_STREAM(args)
bool load(const std::string &key, NodeHandlePtr nh)
Loads the sensor configuration from the parameter server.
SensorConfiguration()=default
Default constructor.
uint8_t calibrationMatrixActive_