41 #ifndef POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET    42 #define POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET    45 #include "boost/thread/mutex.hpp"    52 #include "sensor_msgs/PointCloud2.h"    71     void cloudCb(
const sensor_msgs::PointCloud2ConstPtr &cloud_msg);
    72     void failureCb(
const sensor_msgs::PointCloud2ConstPtr &cloud_msg,
    98 #endif  // POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET 
boost::shared_ptr< tf2_ros::Buffer > tf2_
void failureCb(const sensor_msgs::PointCloud2ConstPtr &cloud_msg, tf2_ros::filter_failure_reasons::FilterFailureReason reason)
tf2_ros::MessageFilter< sensor_msgs::PointCloud2 > MessageFilter
boost::shared_ptr< MessageFilter > message_filter_
PointCloudToLaserScanNodelet()
unsigned int input_queue_size_
ros::NodeHandle private_nh_
std::string target_frame_
message_filters::Subscriber< sensor_msgs::PointCloud2 > sub_
void cloudCb(const sensor_msgs::PointCloud2ConstPtr &cloud_msg)
boost::shared_ptr< tf2_ros::TransformListener > tf2_listener_
boost::mutex connect_mutex_