41 #ifndef POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET_H 42 #define POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET_H 44 #include <boost/thread/mutex.hpp> 48 #include <sensor_msgs/PointCloud2.h> 69 void cloudCb(
const sensor_msgs::PointCloud2ConstPtr& cloud_msg);
70 void failureCb(
const sensor_msgs::PointCloud2ConstPtr& cloud_msg,
97 #endif // POINTCLOUD_TO_LASERSCAN_POINTCLOUD_TO_LASERSCAN_NODELET_H
boost::shared_ptr< tf2_ros::Buffer > tf2_
void failureCb(const sensor_msgs::PointCloud2ConstPtr &cloud_msg, tf2_ros::filter_failure_reasons::FilterFailureReason reason)
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_
tf2_ros::MessageFilter< sensor_msgs::LaserScan > MessageFilter