#include <string>#include <vector>#include <time.h>#include <boost/bind.hpp>#include <boost/function.hpp>#include <boost/thread/mutex.hpp>#include <boost/thread/thread.hpp>#include <opencv2/imgproc/imgproc.hpp>#include <ros/ros.h>#include <ros/callback_queue.h>#include <ros/advertise_service_options.h>#include <ros/package.h>#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <sensor_msgs/Image.h>#include "rail_object_detection_msgs/Detections.h"#include "rail_object_detection_msgs/Object.h"#include "rail_object_detection_msgs/SceneQuery.h"#include "rail_object_detection_msgs/ImageQuery.h"#include "detector.h"

Go to the source code of this file.
Classes | |
| struct | rail_object_detector::darknet_object |
| class | rail_object_detector::DarknetDetector |
| struct | rail_object_detector::network |
Namespaces | |
| namespace | rail_object_detector |
Typedefs | |
| typedef struct rail_object_detector::darknet_object | rail_object_detector::darknet_object |
| typedef struct layer | rail_object_detector::layer |
| typedef struct rail_object_detector::network | rail_object_detector::network |
| typedef struct tree | rail_object_detector::tree |
Enumerations | |
| enum | rail_object_detector::learning_rate_policy { rail_object_detector::CONSTANT, rail_object_detector::STEP, rail_object_detector::EXP, rail_object_detector::POLY, rail_object_detector::STEPS, rail_object_detector::SIG, rail_object_detector::RANDOM } |