1 #ifndef ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED 2 #define ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED 17 #include <geometry_msgs/TwistStamped.h> 18 #include <geometry_msgs/PoseStamped.h> 24 #include <tf2/impl/convert.h> 28 #include <boost/circular_buffer.hpp> 48 boost::circular_buffer<geometry_msgs::TwistStamped>
data_;
57 #endif //ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED tf2_ros::TransformListener listenter_
std::string robot_frame_id_
tf2_ros::TransformBroadcaster broadcaster_
ros::Subscriber current_pose_sub_
std::string map_frame_id_
std::string odom_frame_id_
geometry_msgs::PoseStamped current_pose_
ros::Publisher odom_pose_pub_
OdomFramePublisher(ros::NodeHandle nh, ros::NodeHandle pnh)
Constructor of the OdomFramePublisher Class.
std::string current_twist_topic_
boost::circular_buffer< geometry_msgs::TwistStamped > data_
bool current_pose_recieved_
ros::Subscriber current_twist_sub_
void currentPoseCallback(const geometry_msgs::PoseStamped::ConstPtr msg)
ROS callback function for the current pose topic.
void currentTwistCallback(const geometry_msgs::TwistStamped::ConstPtr msg)
ROS callback function for the current tiwst topic.
~OdomFramePublisher()
Destructor of the OdomFramePublisher class.
geometry_msgs::PoseStamped current_odom_pose_
std::string current_pose_topic_