#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>
Go to the source code of this file.
Classes | |
class | image_view2::ImageView2 |
Namespaces | |
namespace | image_view2 |
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 > | image_view2::V_ImageMarkerMessage |
Functions | |
CvScalar | image_view2::MsgToRGB (const std_msgs::ColorRGBA &color) |
#define DEFAULT_CIRCLE_SCALE 20 |
Definition at line 65 of file image_view2.h.
#define DEFAULT_COLOR CV_RGB(255,0,0) |
Definition at line 63 of file image_view2.h.
#define DEFAULT_LINE_WIDTH 3 |
Definition at line 66 of file image_view2.h.
#define USER_ROI_COLOR CV_RGB(255,0,0) |
Definition at line 64 of file image_view2.h.