Public Member Functions | |
SelfFilter (void) | |
~SelfFilter (void) | |
Private Member Functions | |
void | cloudCallback (const sensor_msgs::PointCloud2ConstPtr &cloud2) |
void | noFilterCallback (const sensor_msgs::PointCloud2ConstPtr &cloud) |
Private Attributes | |
pcl::VoxelGrid< pcl::PointXYZ > | grid_ |
tf::MessageFilter < sensor_msgs::PointCloud2 > * | mn_ |
ros::NodeHandle | nh_ |
ros::Subscriber | no_filter_sub_ |
ros::Publisher | pointCloudPublisher_ |
ros::NodeHandle | root_handle_ |
filters::SelfFilter < pcl::PointCloud < pcl::PointXYZ > > * | self_filter_ |
std::string | sensor_frame_ |
message_filters::Subscriber < sensor_msgs::PointCloud2 > * | sub_ |
double | subsample_param_ |
tf::TransformListener | tf_ |
Definition at line 45 of file self_filter.cpp.
SelfFilter::SelfFilter | ( | void | ) | [inline] |
Definition at line 48 of file self_filter.cpp.
SelfFilter::~SelfFilter | ( | void | ) | [inline] |
Definition at line 74 of file self_filter.cpp.
void SelfFilter::cloudCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud2 | ) | [inline, private] |
Definition at line 89 of file self_filter.cpp.
void SelfFilter::noFilterCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud | ) | [inline, private] |
Definition at line 83 of file self_filter.cpp.
pcl::VoxelGrid<pcl::PointXYZ> SelfFilter::grid_ [private] |
Definition at line 136 of file self_filter.cpp.
tf::MessageFilter<sensor_msgs::PointCloud2>* SelfFilter::mn_ [private] |
Definition at line 126 of file self_filter.cpp.
ros::NodeHandle SelfFilter::nh_ [private] |
Definition at line 124 of file self_filter.cpp.
ros::Subscriber SelfFilter::no_filter_sub_ [private] |
Definition at line 134 of file self_filter.cpp.
Definition at line 133 of file self_filter.cpp.
ros::NodeHandle SelfFilter::root_handle_ [private] |
Definition at line 124 of file self_filter.cpp.
filters::SelfFilter<pcl::PointCloud<pcl::PointXYZ> >* SelfFilter::self_filter_ [private] |
Definition at line 129 of file self_filter.cpp.
std::string SelfFilter::sensor_frame_ [private] |
Definition at line 130 of file self_filter.cpp.
message_filters::Subscriber<sensor_msgs::PointCloud2>* SelfFilter::sub_ [private] |
Definition at line 127 of file self_filter.cpp.
double SelfFilter::subsample_param_ [private] |
Definition at line 131 of file self_filter.cpp.
tf::TransformListener SelfFilter::tf_ [private] |
Definition at line 122 of file self_filter.cpp.