Header of the texturize polygon primitives binary. More...
#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <tf/transform_listener.h>#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <pcl/ros/conversions.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <visualization_msgs/Marker.h>#include <visualization_msgs/MarkerArray.h>#include <wrapper_collada.h>#include "polygon_primitive_with_texture.h"

Go to the source code of this file.
Classes | |
| struct | t_cam | 
Macros | |
| #define | _EXTERN_ extern | 
| #define | _MAX_NUM_POLYGONS_ 99 | 
| #define | PFLN {printf("DEBUG PRINT FILE %s LINE %d\n",__FILE__,__LINE__);} | 
| Ros includes.  More... | |
Variables | |
| _EXTERN_ t_cam | cam_roof_fc | 
| _EXTERN_ t_cam | cam_roof_fc_6mm | 
| _EXTERN_ t_cam | cam_roof_fl | 
| _EXTERN_ t_cam | cam_roof_fr | 
| _EXTERN_ t_cam | cam_roof_rc | 
| _EXTERN_ ros::Time | mission_start | 
| _EXTERN_ tf::TransformListener * | p_listener | 
| _EXTERN_ ros::Publisher * | p_markerarray_pub | 
| _EXTERN_ ros::NodeHandle * | p_node | 
| _EXTERN_ std::map< std::string,  c_polygon_primitive_with_texture >  | pmap | 
Header of the texturize polygon primitives binary.
Definition in file texturize_polygon_primitives.h.