Go to the documentation of this file.
35 #ifndef NAV_2D_UTILS_ODOM_SUBSCRIBER_H
36 #define NAV_2D_UTILS_ODOM_SUBSCRIBER_H
40 #include <nav_msgs/Odometry.h>
41 #include <nav_2d_msgs/Twist2DStamped.h>
62 std::string odom_topic;
63 nh.
param(
"odom_topic", odom_topic, default_topic);
66 std::placeholders::_1));
88 #endif // NAV_2D_UTILS_ODOM_SUBSCRIBER_H
ros::Subscriber odom_sub_
OdomSubscriber(ros::NodeHandle &nh, std::string default_topic="odom")
Constructor that subscribes to an Odometry topic.
void odomCallback(const nav_msgs::Odometry::ConstPtr &msg)
nav_2d_msgs::Twist2DStamped getTwistStamped()
#define ROS_INFO_ONCE(...)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, const boost::function< void(C)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr(), const TransportHints &transport_hints=TransportHints())
nav_2d_msgs::Twist2D getTwist()
A set of utility functions for Bounds objects interacting with other messages/types.
T param(const std::string ¶m_name, const T &default_val) const
nav_2d_msgs::Twist2DStamped odom_vel_
nav_2d_msgs::Twist2D twist3Dto2D(const geometry_msgs::Twist &cmd_vel)
nav_2d_utils
Author(s):
autogenerated on Sun May 18 2025 02:47:23