#include <std_msgs/String.h>#include <cv_bridge/cv_bridge.h>#include <image_transport/image_transport.h>#include <sensor_msgs/image_encodings.h>#include <boost/date_time/posix_time/posix_time.hpp>#include "ScavTaskColorShirt.h"
Go to the source code of this file.
Defines | |
| #define | COLOR_RATIO (0.25) |
| #define | DISTANCE_TO_COLOR (200) |
| #define | INTMAX (32767) |
| #define | INTMIN (-32767) |
| #define | SHIRT_HEIGHT_BOTTOM (-0.5) |
| #define | SHIRT_HEIGHT_TOP (0.5) |
Functions | |
| std::ostream & | operator<< (std::ostream &stream, const Color &color) |
Variables | |
| Rgb | baseline |
| sensor_msgs::ImageConstPtr | image |
| std::string | path_to_image |
| #define COLOR_RATIO (0.25) |
Definition at line 14 of file ScavTaskColorShirt.cpp.
| #define DISTANCE_TO_COLOR (200) |
Definition at line 15 of file ScavTaskColorShirt.cpp.
| #define INTMAX (32767) |
Definition at line 12 of file ScavTaskColorShirt.cpp.
| #define INTMIN (-32767) |
Definition at line 13 of file ScavTaskColorShirt.cpp.
| #define SHIRT_HEIGHT_BOTTOM (-0.5) |
Definition at line 19 of file ScavTaskColorShirt.cpp.
| #define SHIRT_HEIGHT_TOP (0.5) |
Definition at line 18 of file ScavTaskColorShirt.cpp.
| std::ostream& operator<< | ( | std::ostream & | stream, |
| const Color & | color | ||
| ) |
Definition at line 27 of file ScavTaskColorShirt.cpp.
Definition at line 25 of file ScavTaskColorShirt.cpp.
| sensor_msgs::ImageConstPtr image |
Definition at line 21 of file ScavTaskColorShirt.cpp.
| std::string path_to_image |
Definition at line 23 of file ScavTaskColorShirt.cpp.