27 obj.rawMeasurements.at(IMU_ORI_QUAT_X) = msg.orientation.x;
28 obj.rawMeasurements.at(IMU_ORI_QUAT_Y) = msg.orientation.y;
29 obj.rawMeasurements.at(IMU_ORI_QUAT_Z) = msg.orientation.z;
30 obj.rawMeasurements.at(IMU_ORI_QUAT_W) = msg.orientation.w;
32 obj.rawMeasurements.at(IMU_X_ACC_GLOBAL) = msg.linear_acceleration.x;
33 obj.rawMeasurements.at(IMU_Y_ACC_GLOBAL) = msg.linear_acceleration.y;
34 obj.rawMeasurements.at(IMU_Z_ACC_GLOBAL) = msg.linear_acceleration.z;
36 obj.rawMeasurements.at(IMU_X_VEL) = msg.angular_velocity.x;
37 obj.rawMeasurements.at(IMU_Y_VEL) = msg.angular_velocity.y;
38 obj.rawMeasurements.at(IMU_Z_VEL) = msg.angular_velocity.z;
49 msg.header = msg_header;
51 vector<double> measurements = obj.rawMeasurements;
52 msg.orientation.x = measurements.at(IMU_ORI_QUAT_X);
53 msg.orientation.y = measurements.at(IMU_ORI_QUAT_Y);
54 msg.orientation.z = measurements.at(IMU_ORI_QUAT_Z);
55 msg.orientation.w = measurements.at(IMU_ORI_QUAT_W);
59 msg.linear_acceleration.x = measurements.at(IMU_X_ACC_GLOBAL);
60 msg.linear_acceleration.y = measurements.at(IMU_Y_ACC_GLOBAL);
61 msg.linear_acceleration.z = measurements.at(IMU_Z_ACC_GLOBAL);
63 msg.angular_velocity.x = measurements.at(IMU_X_VEL);
64 msg.angular_velocity.y = measurements.at(IMU_Y_VEL);
65 msg.angular_velocity.z = measurements.at(IMU_Z_VEL);
bool mrpt2ros(const CObservationGPS &obj, const std_msgs::Header &msg_header, sensor_msgs::NavSatFix &msg)
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
bool ros2mrpt(const sensor_msgs::NavSatFix &msg, CObservationGPS &obj)