$search

pcl_ros::PassThrough Class Reference

PassThrough uses the base Filter class methods to pass through all data that satisfies the user given constraints. More...

#include <passthrough.h>

Inheritance diagram for pcl_ros::PassThrough:
Inheritance graph
[legend]

List of all members.

Protected Member Functions

bool child_init (ros::NodeHandle &nh, bool &has_service)
 Child initialization routine.
void config_callback (pcl_ros::FilterConfig &config, uint32_t level)
 Dynamic reconfigure service callback.
void filter (const PointCloud2::ConstPtr &input, const IndicesPtr &indices, PointCloud2 &output)
 Call the actual filter.

Protected Attributes

boost::shared_ptr
< dynamic_reconfigure::Server
< pcl_ros::FilterConfig > > 
srv_
 Pointer to a dynamic reconfigure service.

Private Attributes

pcl::PassThrough
< sensor_msgs::PointCloud2
impl_
 The PCL filter implementation used.

Detailed Description

PassThrough uses the base Filter class methods to pass through all data that satisfies the user given constraints.

Author:
Radu Bogdan Rusu

Definition at line 51 of file passthrough.h.


Member Function Documentation

bool pcl_ros::PassThrough::child_init ( ros::NodeHandle nh,
bool &  has_service 
) [protected, virtual]

Child initialization routine.

Parameters:
nh ROS node handle
has_service set to true if the child has a Dynamic Reconfigure service

Reimplemented from pcl_ros::Filter.

Definition at line 43 of file passthrough.cpp.

void pcl_ros::PassThrough::config_callback ( pcl_ros::FilterConfig &  config,
uint32_t  level 
) [protected, virtual]

Dynamic reconfigure service callback.

Parameters:
config the dynamic reconfigure FilterConfig object
level the dynamic reconfigure level

Reimplemented from pcl_ros::Filter.

Definition at line 56 of file passthrough.cpp.

void pcl_ros::PassThrough::filter ( const PointCloud2::ConstPtr input,
const IndicesPtr indices,
PointCloud2 output 
) [inline, protected, virtual]

Call the actual filter.

Parameters:
input the input point cloud dataset
indices the input set of indices to use from input
output the resultant filtered dataset

Implements pcl_ros::Filter.

Definition at line 63 of file passthrough.h.


Member Data Documentation

The PCL filter implementation used.

Definition at line 88 of file passthrough.h.

boost::shared_ptr<dynamic_reconfigure::Server<pcl_ros::FilterConfig> > pcl_ros::PassThrough::srv_ [protected]

Pointer to a dynamic reconfigure service.

Reimplemented from pcl_ros::Filter.

Definition at line 55 of file passthrough.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


pcl_ros
Author(s): Maintained by Radu Bogdan Rusu
autogenerated on Fri Mar 1 16:26:35 2013