bounding_box.h
Go to the documentation of this file.
00001 #ifndef _BOUNDING_BOX_H_
00002 #define _BOUNDING_BOX_H_
00003 
00004 // [Eigen]
00005 #include "Eigen/Core"
00006 
00007 // [ROS]
00008 #include "ros/ros.h"
00009 #include "ros/callback_queue.h"
00010 
00011 // [publisher subscriber headers]
00012 #include "sensor_msgs/PointCloud2.h"
00013 
00014 // [services]
00015 
00016 // static const char WINDOW[] = "Image window";
00017 
00018 class FilterBB {
00019     public:
00020       FilterBB();
00021       ~FilterBB();
00022      
00023     private:
00024       ros::NodeHandle nh;
00025 
00026       // [Subscribers]
00027       ros::Subscriber pcl2_sub; // Point Cloud 2
00028 
00029       // [Publishers]
00030       ros::Publisher pcl2_pub;  // Point Cloud 2
00031 
00032       // [Services]
00033       
00034       // Bounding Box Threshold
00035       double x_s, y_s, z_s, x_e, y_e, z_e;
00036      
00037       void pcl2_sub_callback(const sensor_msgs::PointCloud2::ConstPtr& msg);
00038 };
00039 #endif


iri_pcl_filters
Author(s): Sergi Foix
autogenerated on Fri Dec 6 2013 20:44:42