Public Member Functions | Private Types | Private Attributes
PointsRectExtractor Class Reference

List of all members.

Public Member Functions

void callback_point (const sensor_msgs::PointCloud2ConstPtr &points_ptr, const geometry_msgs::PointStampedConstPtr &array_ptr)
void callback_polygon (const sensor_msgs::PointCloud2ConstPtr &points_ptr, const geometry_msgs::PolygonStampedConstPtr &array_ptr)
 PointsRectExtractor ()

Private Types

typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::PointCloud2,
geometry_msgs::PointStamped > 
PointApproxSyncPolicy
typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::PointCloud2,
geometry_msgs::PolygonStamped > 
PolygonApproxSyncPolicy

Private Attributes

int crop_width
ros::NodeHandle pnode_
message_filters::Subscriber
< geometry_msgs::PointStamped > 
point_sub_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
points_sub_
ros::Publisher pub_
int queue_size
message_filters::Subscriber
< geometry_msgs::PolygonStamped > 
rect_sub_
boost::shared_ptr
< message_filters::Synchronizer
< PointApproxSyncPolicy > > 
sync_a_point_
boost::shared_ptr
< message_filters::Synchronizer
< PolygonApproxSyncPolicy > > 
sync_a_polygon_

Detailed Description

Definition at line 16 of file points_rectangle_extractor.cpp.


Member Typedef Documentation

typedef message_filters::sync_policies::ApproximateTime< sensor_msgs::PointCloud2, geometry_msgs::PointStamped > PointsRectExtractor::PointApproxSyncPolicy [private]

Definition at line 22 of file points_rectangle_extractor.cpp.

typedef message_filters::sync_policies::ApproximateTime< sensor_msgs::PointCloud2, geometry_msgs::PolygonStamped > PointsRectExtractor::PolygonApproxSyncPolicy [private]

Definition at line 19 of file points_rectangle_extractor.cpp.


Constructor & Destructor Documentation

Definition at line 38 of file points_rectangle_extractor.cpp.


Member Function Documentation

void PointsRectExtractor::callback_point ( const sensor_msgs::PointCloud2ConstPtr &  points_ptr,
const geometry_msgs::PointStampedConstPtr &  array_ptr 
) [inline]

Definition at line 55 of file points_rectangle_extractor.cpp.

void PointsRectExtractor::callback_polygon ( const sensor_msgs::PointCloud2ConstPtr &  points_ptr,
const geometry_msgs::PolygonStampedConstPtr &  array_ptr 
) [inline]

Definition at line 94 of file points_rectangle_extractor.cpp.


Member Data Documentation

Definition at line 28 of file points_rectangle_extractor.cpp.

Definition at line 25 of file points_rectangle_extractor.cpp.

message_filters::Subscriber< geometry_msgs::PointStamped > PointsRectExtractor::point_sub_ [private]

Definition at line 32 of file points_rectangle_extractor.cpp.

message_filters::Subscriber< sensor_msgs::PointCloud2 > PointsRectExtractor::points_sub_ [private]

Definition at line 30 of file points_rectangle_extractor.cpp.

Definition at line 26 of file points_rectangle_extractor.cpp.

Definition at line 27 of file points_rectangle_extractor.cpp.

message_filters::Subscriber< geometry_msgs::PolygonStamped > PointsRectExtractor::rect_sub_ [private]

Definition at line 31 of file points_rectangle_extractor.cpp.

Definition at line 35 of file points_rectangle_extractor.cpp.

Definition at line 34 of file points_rectangle_extractor.cpp.


The documentation for this class was generated from the following file:


image_view2
Author(s): Kei Okada
autogenerated on Sun Jan 25 2015 12:38:01