Files | Classes | Macros | Functions | Variables
Texturize_polygon_primitives

Files

file  texturize_polygon_primitives.cpp
 Main code for adding texture to geometric polygonal primitives.
 
file  texturize_polygon_primitives.h
 Header of the texturize polygon primitives binary.
 

Classes

struct  t_cam
 

Macros

#define _EXTERN_   extern
 
#define _MAX_NUM_POLYGONS_   99
 
#define _texturize_polygon_primitives_CPP_
 
#define _USE_THREADS_   0
 
#define PFLN   {printf("DEBUG PRINT FILE %s LINE %d\n",__FILE__,__LINE__);}
 Ros includes. More...
 

Functions

int add_camera_projection_to_polygon (std::string cam_name, t_cam *cam, c_polygon_primitive_with_texture *plg)
 
void handler_cam_roof_fc (const sensor_msgs::ImageConstPtr &msg)
 
void handler_cam_roof_fc_6mm (const sensor_msgs::ImageConstPtr &msg)
 
void handler_cam_roof_fl (const sensor_msgs::ImageConstPtr &msg)
 
void handler_cam_roof_fr (const sensor_msgs::ImageConstPtr &msg)
 
void handler_cam_roof_rc (const sensor_msgs::ImageConstPtr &msg)
 
int main (int argc, char **argv)
 The main function for the extraction of polygon primitives. More...
 
void polygon_primitive_received_handler (const polygon_primitive_msg::polygon_primitive &input)
 Handles the receiving of a new polygonal primitive message. More...
 
void * process_polygon_primitive (void *ptr)
 

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
 

Detailed Description

Macro Definition Documentation

#define _EXTERN_   extern

Definition at line 102 of file texturize_polygon_primitives.h.

#define _MAX_NUM_POLYGONS_   99

Definition at line 74 of file texturize_polygon_primitives.h.

#define _texturize_polygon_primitives_CPP_

Definition at line 37 of file texturize_polygon_primitives.cpp.

#define _USE_THREADS_   0

Definition at line 42 of file texturize_polygon_primitives.cpp.

#define PFLN   {printf("DEBUG PRINT FILE %s LINE %d\n",__FILE__,__LINE__);}

Ros includes.

PLC includes Rviz includes Other modules include Local includes

Definition at line 73 of file texturize_polygon_primitives.h.

Function Documentation

int add_camera_projection_to_polygon ( std::string  cam_name,
t_cam cam,
c_polygon_primitive_with_texture plg 
)

Definition at line 129 of file texturize_polygon_primitives.cpp.

void handler_cam_roof_fc ( const sensor_msgs::ImageConstPtr &  msg)

Definition at line 44 of file texturize_polygon_primitives.cpp.

void handler_cam_roof_fc_6mm ( const sensor_msgs::ImageConstPtr &  msg)

Definition at line 112 of file texturize_polygon_primitives.cpp.

void handler_cam_roof_fl ( const sensor_msgs::ImageConstPtr &  msg)

Definition at line 61 of file texturize_polygon_primitives.cpp.

void handler_cam_roof_fr ( const sensor_msgs::ImageConstPtr &  msg)

Definition at line 78 of file texturize_polygon_primitives.cpp.

void handler_cam_roof_rc ( const sensor_msgs::ImageConstPtr &  msg)

Definition at line 95 of file texturize_polygon_primitives.cpp.

int main ( int  argc,
char **  argv 
)

The main function for the extraction of polygon primitives.

Parameters
argcthe standard argc
argvthe standard argv
Returns
standard return for main

Definition at line 278 of file texturize_polygon_primitives.cpp.

void polygon_primitive_received_handler ( const polygon_primitive_msg::polygon_primitive &  input)

Handles the receiving of a new polygonal primitive message.

Parameters
inputa reference for the polygonal primitive data structure

Definition at line 205 of file texturize_polygon_primitives.cpp.

void* process_polygon_primitive ( void *  ptr)

Definition at line 172 of file texturize_polygon_primitives.cpp.

Variable Documentation

_EXTERN_ t_cam cam_roof_fc

Definition at line 107 of file texturize_polygon_primitives.h.

_EXTERN_ t_cam cam_roof_fc_6mm

Definition at line 111 of file texturize_polygon_primitives.h.

_EXTERN_ t_cam cam_roof_fl

Definition at line 108 of file texturize_polygon_primitives.h.

_EXTERN_ t_cam cam_roof_fr

Definition at line 109 of file texturize_polygon_primitives.h.

_EXTERN_ t_cam cam_roof_rc

Definition at line 110 of file texturize_polygon_primitives.h.

_EXTERN_ ros::Time mission_start

Definition at line 115 of file texturize_polygon_primitives.h.

_EXTERN_ tf::TransformListener* p_listener

Definition at line 112 of file texturize_polygon_primitives.h.

_EXTERN_ ros::Publisher* p_markerarray_pub

Definition at line 114 of file texturize_polygon_primitives.h.

_EXTERN_ ros::NodeHandle* p_node

Definition at line 113 of file texturize_polygon_primitives.h.

_EXTERN_ std::map<std::string, c_polygon_primitive_with_texture> pmap

Definition at line 106 of file texturize_polygon_primitives.h.



polygon_primitives_extraction
Author(s): Miguel Oliveira
autogenerated on Mon Mar 2 2015 01:32:42