#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <opencv2/opencv.hpp>#include <cmvision/Blobs.h>#include "conversions.h"#include "cmvision.h"#include "capture.h"

Go to the source code of this file.
Classes | |
| class | color_blob_track::CMVisionColorBlobFinder |
Namespaces | |
| color_blob_track | |
Macros | |
| #define | CMV_BLOB_SIZE 16 |
| #define | CMV_HEADER_SIZE 4*CMV_NUM_CHANNELS |
| #define | CMV_MAX_BLOBS_PER_CHANNEL 10 |
| #define | CMV_NUM_CHANNELS CMV_MAX_COLORS |
| #define | DEFAULT_CMV_HEIGHT CMV_DEFAULT_HEIGHT |
| #define | DEFAULT_CMV_WIDTH CMV_DEFAULT_WIDTH |
| #define CMV_BLOB_SIZE 16 |
Definition at line 39 of file cmvision_color_blob_finder.h.
| #define CMV_HEADER_SIZE 4*CMV_NUM_CHANNELS |
Definition at line 38 of file cmvision_color_blob_finder.h.
| #define CMV_MAX_BLOBS_PER_CHANNEL 10 |
Definition at line 40 of file cmvision_color_blob_finder.h.
| #define CMV_NUM_CHANNELS CMV_MAX_COLORS |
Definition at line 37 of file cmvision_color_blob_finder.h.
| #define DEFAULT_CMV_HEIGHT CMV_DEFAULT_HEIGHT |
Definition at line 43 of file cmvision_color_blob_finder.h.
| #define DEFAULT_CMV_WIDTH CMV_DEFAULT_WIDTH |
Definition at line 42 of file cmvision_color_blob_finder.h.