36 #ifndef JSK_PCL_ROS_UTILS_DELAY_POINTCLOUD_H_ 37 #define JSK_PCL_ROS_UTILS_DELAY_POINTCLOUD_H_ 40 #include <sensor_msgs/PointCloud.h> 43 #include "jsk_pcl_ros_utils/DelayPointCloudConfig.h" 44 #include <dynamic_reconfigure/server.h> 57 typedef jsk_pcl_ros_utils::DelayPointCloudConfig
Config;
61 virtual void delay(
const sensor_msgs::PointCloud2::ConstPtr& msg);
message_filters::Subscriber< sensor_msgs::PointCloud2 > sub_
void configCallback(Config &config, uint32_t level)
boost::shared_ptr< message_filters::TimeSequencer< sensor_msgs::PointCloud2 > > time_sequencer_
virtual void unsubscribe()
jsk_pcl_ros_utils::DelayPointCloudConfig Config
virtual void delay(const sensor_msgs::PointCloud2::ConstPtr &msg)
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_