#include <odom_frame_publisher.h>
Public Member Functions | |
OdomFramePublisher (ros::NodeHandle nh, ros::NodeHandle pnh) | |
Constructor of the OdomFramePublisher Class. More... | |
~OdomFramePublisher () | |
Destructor of the OdomFramePublisher class. More... | |
Private Member Functions | |
void | currentPoseCallback (const geometry_msgs::PoseStamped::ConstPtr msg) |
ROS callback function for the current pose topic. More... | |
void | currentTwistCallback (const geometry_msgs::TwistStamped::ConstPtr msg) |
ROS callback function for the current tiwst topic. More... | |
Private Attributes | |
tf2_ros::TransformBroadcaster | broadcaster_ |
tf2_ros::Buffer | buffer_ |
geometry_msgs::PoseStamped | current_odom_pose_ |
geometry_msgs::PoseStamped | current_pose_ |
bool | current_pose_recieved_ |
ros::Subscriber | current_pose_sub_ |
std::string | current_pose_topic_ |
ros::Subscriber | current_twist_sub_ |
std::string | current_twist_topic_ |
boost::circular_buffer< geometry_msgs::TwistStamped > | data_ |
tf2_ros::TransformListener | listenter_ |
std::string | map_frame_id_ |
ros::NodeHandle | nh_ |
std::string | odom_frame_id_ |
ros::Publisher | odom_pose_pub_ |
ros::NodeHandle | pnh_ |
std::string | robot_frame_id_ |
Definition at line 30 of file odom_frame_publisher.h.
OdomFramePublisher::OdomFramePublisher | ( | ros::NodeHandle | nh, |
ros::NodeHandle | pnh | ||
) |
Constructor of the OdomFramePublisher Class.
Definition at line 19 of file odom_frame_publisher.cpp.
OdomFramePublisher::~OdomFramePublisher | ( | ) |
Destructor of the OdomFramePublisher class.
Definition at line 49 of file odom_frame_publisher.cpp.
|
private |
ROS callback function for the current pose topic.
Definition at line 58 of file odom_frame_publisher.cpp.
|
private |
ROS callback function for the current tiwst topic.
Definition at line 69 of file odom_frame_publisher.cpp.
|
private |
Definition at line 47 of file odom_frame_publisher.h.
|
private |
Definition at line 54 of file odom_frame_publisher.h.
|
private |
Definition at line 49 of file odom_frame_publisher.h.
|
private |
Definition at line 50 of file odom_frame_publisher.h.
|
private |
Definition at line 52 of file odom_frame_publisher.h.
|
private |
Definition at line 46 of file odom_frame_publisher.h.
|
private |
Definition at line 40 of file odom_frame_publisher.h.
|
private |
Definition at line 45 of file odom_frame_publisher.h.
|
private |
Definition at line 41 of file odom_frame_publisher.h.
|
private |
Definition at line 48 of file odom_frame_publisher.h.
|
private |
Definition at line 53 of file odom_frame_publisher.h.
|
private |
Definition at line 43 of file odom_frame_publisher.h.
|
private |
Definition at line 36 of file odom_frame_publisher.h.
|
private |
Definition at line 42 of file odom_frame_publisher.h.
|
private |
Definition at line 51 of file odom_frame_publisher.h.
|
private |
Definition at line 37 of file odom_frame_publisher.h.
|
private |
Definition at line 44 of file odom_frame_publisher.h.