3 #include <geometry_msgs/PoseWithCovarianceStamped.h> 9 nh_ = getPrivateNodeHandle();
10 nh_ = getNodeHandle();
12 pose_pub_ = nh_.advertise<geometry_msgs::PoseWithCovarianceStamped>(
"pose", 1);
19 geometry_msgs::PoseWithCovarianceStamped pose;
20 pose.header = odom->header;
21 pose.pose.pose = odom->pose.pose;
22 pose.pose.covariance = odom->pose.covariance;
void publish(const boost::shared_ptr< M > &message) const
void odomCallback(const nav_msgs::OdometryConstPtr &odom)
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)