#include <ros/ros.h>#include <opencv/cv.h>#include <opencv/highgui.h>#include <sensor_msgs/Image.h>#include <cv_bridge/CvBridge.h>#include <image_transport/image_transport.h>#include <face_contour_detector/GetFilters.h>#include <face_contour_detector/ApplyFilters.h>#include <face_contour_detector/ContourDetectorGUI.h>#include <face_contour_detector/autoselect_result.h>#include <face_contour_detector/filters/List.h>#include <face_contour_detector/filters/Canny.h>#include <face_contour_detector/filters/ColorGraphs.h>#include <face_contour_detector/filters/DeleteShortLines.h>#include <face_contour_detector/filters/EdgeConnectorGraphBased.h>#include <face_contour_detector/filters/GaussianBlur.h>#include <face_contour_detector/filters/RosServices.h>#include <vector>
Go to the source code of this file.
Functions | |
| int | main (int argc, char *argv[]) |
| Registers all the services and. | |
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Registers all the services and.
Definition at line 29 of file SendAutoselectMessage.cpp.