odom_frame_publisher.h
Go to the documentation of this file.
1 #ifndef ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED
2 #define ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED
3 
15 // Headers in ROS
16 #include <ros/ros.h>
17 #include <geometry_msgs/TwistStamped.h>
18 #include <geometry_msgs/PoseStamped.h>
23 #include <tf2/convert.h>
24 #include <tf2/impl/convert.h>
26 
27 // Headers in Boost
28 #include <boost/circular_buffer.hpp>
29 
31 {
32 public:
35 private:
38  void currentTwistCallback(const geometry_msgs::TwistStamped::ConstPtr msg);
39  void currentPoseCallback(const geometry_msgs::PoseStamped::ConstPtr msg);
40  std::string current_pose_topic_;
41  std::string current_twist_topic_;
42  std::string odom_frame_id_;
43  std::string map_frame_id_;
44  std::string robot_frame_id_;
48  boost::circular_buffer<geometry_msgs::TwistStamped> data_;
49  geometry_msgs::PoseStamped current_odom_pose_;
50  geometry_msgs::PoseStamped current_pose_;
55 };
56 
57 #endif //ODOM_FRAME_PUBLISHER_ODOM_FRAME_PUBLISHER_H_INCLUDED
tf2_ros::TransformListener listenter_
tf2_ros::TransformBroadcaster broadcaster_
ros::Subscriber current_pose_sub_
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_
ros::Subscriber current_twist_sub_
void currentPoseCallback(const geometry_msgs::PoseStamped::ConstPtr msg)
ROS callback function for the current pose topic.
tf2_ros::Buffer buffer_
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_


odom_frame_publisher
Author(s):
autogenerated on Tue Jun 2 2020 03:53:06