#include "Sensor.h"#include "XMLTag.h"#include <ros/ros.h>#include <ros/node_handle.h>#include <sensor_msgs/Image.h>#include "IplImageReading.h"

Go to the source code of this file.
Classes | |
| class | cop::ImageSubscription |
Namespaces | |
| namespace | cop |
| namespace | sensor_msgs |
Defines | |
| #define | XML_ATTRIBUTE_FOCAL_LENGTH "focal_length" |
| #define | XML_ATTRIBUTE_PIX_SIZE_X "pix_size_x" |
| #define | XML_ATTRIBUTE_PIX_SIZE_Y "pix_size_y" |
| #define | XML_ATTRIBUTE_PROJ_CENTER_X "proj_center_x" |
| #define | XML_ATTRIBUTE_PROJ_CENTER_Y "proj_center_y" |
| #define | XML_NODE_IMAGESUBSCRIPTION "ImageSubscription" |
| #define | XML_PROPERTY_TOPIC "TopicName" |
| #define XML_ATTRIBUTE_FOCAL_LENGTH "focal_length" |
Definition at line 40 of file ImageSubscription.h.
| #define XML_ATTRIBUTE_PIX_SIZE_X "pix_size_x" |
Definition at line 41 of file ImageSubscription.h.
| #define XML_ATTRIBUTE_PIX_SIZE_Y "pix_size_y" |
Definition at line 42 of file ImageSubscription.h.
| #define XML_ATTRIBUTE_PROJ_CENTER_X "proj_center_x" |
Definition at line 43 of file ImageSubscription.h.
| #define XML_ATTRIBUTE_PROJ_CENTER_Y "proj_center_y" |
Definition at line 44 of file ImageSubscription.h.
| #define XML_NODE_IMAGESUBSCRIPTION "ImageSubscription" |
Definition at line 38 of file ImageSubscription.h.
| #define XML_PROPERTY_TOPIC "TopicName" |
Definition at line 39 of file ImageSubscription.h.