33 #ifndef ACCELERATIONPUBLISHER_H
34 #define ACCELERATIONPUBLISHER_H
37 #include <geometry_msgs/Vector3Stamped.h>
46 int pub_queue_size = 5;
48 pub = node.
advertise<geometry_msgs::Vector3Stamped>(
"imu/acceleration", pub_queue_size);
54 if (packet.containsCalibratedAcceleration())
56 geometry_msgs::Vector3Stamped
msg;
58 msg.header.stamp = timestamp;
61 XsVector accel = packet.calibratedAcceleration();
63 msg.vector.x = accel[0];
64 msg.vector.y = accel[1];
65 msg.vector.z = accel[2];