50 base_odom_.twist.twist.linear.x = msg->twist.twist.linear.x;
51 base_odom_.twist.twist.linear.y = msg->twist.twist.linear.y;
52 base_odom_.twist.twist.angular.z = msg->twist.twist.angular.z;
53 base_odom_.child_frame_id = msg->child_frame_id;
67 geometry_msgs::Twist global_vel;
70 global_vel.linear.x =
base_odom_.twist.twist.linear.x;
71 global_vel.linear.y =
base_odom_.twist.twist.linear.y;
72 global_vel.angular.z =
base_odom_.twist.twist.angular.z;
void getRobotVel(tf::Stamped< tf::Pose > &robot_vel)
void setData(const T &input)
#define ROS_INFO_ONCE(...)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void getOdom(nav_msgs::Odometry &base_odom)
nav_msgs::Odometry base_odom_
static Quaternion createQuaternionFromYaw(double yaw)
ros::Subscriber odom_sub_
OdometryHelperRos(std::string odom_topic="")
Constructor.
void odomCallback(const nav_msgs::Odometry::ConstPtr &msg)
Callback for receiving odometry data.
void setOdomTopic(std::string odom_topic)
Set the odometry topic. This overrides what was set in the constructor, if anything.