Classes | Defines | Typedefs | Functions
image_view2.cpp File Reference
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <image_geometry/pinhole_camera_model.h>
#include <tf/transform_listener.h>
#include <image_view2/ImageMarker2.h>
#include <geometry_msgs/PointStamped.h>
#include <geometry_msgs/PolygonStamped.h>
#include <std_msgs/Empty.h>
#include <boost/thread.hpp>
#include <boost/format.hpp>
#include <boost/foreach.hpp>
#include <boost/circular_buffer.hpp>
#include <boost/lambda/lambda.hpp>
#include <pcl/point_types.h>
#include <pcl_ros/publisher.h>
Include dependency graph for image_view2.cpp:

Go to the source code of this file.

Classes

class  ImageView2

Defines

#define DEFAULT_CIRCLE_SCALE   20
#define DEFAULT_COLOR   CV_RGB(255,0,0)
#define DEFAULT_LINE_WIDTH   3
#define USER_ROI_COLOR   CV_RGB(255,0,0)

Typedefs

typedef std::vector
< image_view2::ImageMarker2::ConstPtr > 
V_ImageMarkerMessage

Functions

int main (int argc, char **argv)
CvScalar MsgToRGB (const std_msgs::ColorRGBA &color)

Define Documentation

#define DEFAULT_CIRCLE_SCALE   20

Definition at line 63 of file image_view2.cpp.

#define DEFAULT_COLOR   CV_RGB(255,0,0)

Definition at line 61 of file image_view2.cpp.

#define DEFAULT_LINE_WIDTH   3

Definition at line 64 of file image_view2.cpp.

#define USER_ROI_COLOR   CV_RGB(255,0,0)

Definition at line 62 of file image_view2.cpp.


Typedef Documentation

typedef std::vector<image_view2::ImageMarker2::ConstPtr> V_ImageMarkerMessage

Definition at line 59 of file image_view2.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 1106 of file image_view2.cpp.

CvScalar MsgToRGB ( const std_msgs::ColorRGBA &  color) [inline]

Definition at line 66 of file image_view2.cpp.



image_view2
Author(s): Kei Okada
autogenerated on Mon Oct 6 2014 10:54:45