Go to the documentation of this file.
33 #ifndef ANGULARVELOCITYPUBLISHER_H
34 #define ANGULARVELOCITYPUBLISHER_H
37 #include <geometry_msgs/Vector3Stamped.h>
47 int pub_queue_size = 5;
49 pub = node.
advertise<geometry_msgs::Vector3Stamped>(
"imu/angular_velocity", pub_queue_size);
55 if (packet.containsCalibratedGyroscopeData())
57 geometry_msgs::Vector3Stamped
msg;
62 msg.header.stamp = timestamp;
65 XsVector gyro = packet.calibratedGyroscopeData();
67 msg.vector.x = gyro[0];
68 msg.vector.y = gyro[1];
69 msg.vector.z = gyro[2];
void operator()(const XsDataPacket &packet, ros::Time timestamp)
A class that represents a vector of real numbers.
ROSCPP_DECL bool get(const std::string &key, bool &b)
const char * DEFAULT_FRAME_ID
Contains an interpreted data message. The class provides easy access to the contained data through it...
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
ROSCPP_DECL bool getCached(const std::string &key, bool &b)
AngularVelocityPublisher(ros::NodeHandle &node)