33 #ifndef POSITIONLLAPUBLISHER_H
34 #define POSITIONLLAPUBLISHER_H
37 #include <geometry_msgs/Vector3Stamped.h>
47 int pub_queue_size = 5;
49 pub = node.
advertise<geometry_msgs::Vector3Stamped>(
"filter/positionlla", pub_queue_size);
55 if (packet.containsPositionLLA())
57 geometry_msgs::Vector3Stamped
msg;
59 msg.header.stamp = timestamp;