cart_state_estimator::PolygonPointCloudFilter Class Reference

#include <polygon_point_cloud_filter.h>

List of all members.

Public Member Functions

bool configure ()
bool inPolygon (const geometry_msgs::Point32 &p) const
 PolygonPointCloudFilter ()
bool update (const sensor_msgs::PointCloud &input_scan, sensor_msgs::PointCloud &filtered_scan)

Private Attributes

ros::Publisher filter_polygon_pub_
std::string frame_
ros::NodeHandle nh_
std::vector
< geometry_msgs::Point32 > 
poly_
tf::TransformListener tf_

Detailed Description

Filter that takes as parameters a 2d polygon and a frame Given a point cloud, for each point it transforms to the frame and drops the z coordinate, then checks if it lies in the polygon. If it does, skip it, else keep the (untransformed) point.

Definition at line 52 of file polygon_point_cloud_filter.h.


Constructor & Destructor Documentation

cart_state_estimator::PolygonPointCloudFilter::PolygonPointCloudFilter (  )  [inline]

Definition at line 47 of file polygon_point_cloud_filter.h.


Member Function Documentation

bool cart_state_estimator::PolygonPointCloudFilter::configure (  ) 
bool cart_state_estimator::PolygonPointCloudFilter::inPolygon ( const geometry_msgs::Point32 &  p  )  const
bool cart_state_estimator::PolygonPointCloudFilter::update ( const sensor_msgs::PointCloud &  input_scan,
sensor_msgs::PointCloud &  filtered_scan 
)

Member Data Documentation

Definition at line 56 of file polygon_point_cloud_filter.h.

Definition at line 58 of file polygon_point_cloud_filter.h.

Definition at line 55 of file polygon_point_cloud_filter.h.

std::vector<geometry_msgs::Point32> cart_state_estimator::PolygonPointCloudFilter::poly_ [private]

Definition at line 57 of file polygon_point_cloud_filter.h.

tf::TransformListener cart_state_estimator::PolygonPointCloudFilter::tf_ [private]

Definition at line 54 of file polygon_point_cloud_filter.h.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs


cart_state_estimator
Author(s): Bhaskara Marthi
autogenerated on Fri Jan 11 09:52:50 2013