33 #ifndef VELOCITYINCREMENTPUBLISHER_H
34 #define VELOCITYINCREMENTPUBLISHER_H
37 #include <geometry_msgs/Vector3Stamped.h>
47 int pub_queue_size = 5;
49 pub = node.
advertise<geometry_msgs::Vector3Stamped>(
"imu/dv", pub_queue_size);
54 if (packet.containsVelocityIncrement())
56 geometry_msgs::Vector3Stamped
msg;
58 msg.header.stamp = timestamp;
61 XsVector dv = packet.velocityIncrement();