#include <vector>
#include <fstream>
#include <sstream>
#include <time.h>
#include <iostream>
#include <iomanip>
#include "cv_bridge/CvBridge.h"
#include "opencv/cxcore.h"
#include "opencv/cv.h"
#include "opencv/highgui.h"
#include "ros/ros.h"
#include "ros/callback_queue.h"
#include "stereo_msgs/DisparityImage.h"
#include "sensor_msgs/CameraInfo.h"
#include "sensor_msgs/Image.h"
#include "sensor_msgs/PointCloud.h"
#include "geometry_msgs/Point32.h"
#include "geometry_msgs/PointStamped.h"
#include "door_msgs/Door.h"
#include "visualization_msgs/Marker.h"
#include "door_handle_detector/DoorsDetector.h"
#include "std_srvs/Empty.h"
#include <string>
#include <tf/transform_listener.h>
#include <topic_synchronizer2/topic_synchronizer.h>
#include <boost/thread.hpp>
Go to the source code of this file.
Classes | |
class | HandleDetector |
class | IndexedIplImage< T > |
struct | HandleDetector::Stats |
Functions | |
int | main (int argc, char **argv) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 1095 of file handle_detector_vision.cpp.