#include <stdio.h>#include <iostream>#include <cstdio>#include <boost/filesystem.hpp>#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include "opencv2/core/core.hpp"#include "opencv2/features2d/features2d.hpp"#include "opencv2/highgui/highgui.hpp"#include "opencv2/calib3d/calib3d.hpp"#include "opencv2/nonfree/nonfree.hpp"#include "opencv2/objdetect/objdetect.hpp"#include "opencv2/imgproc/imgproc.hpp"#include "ros/ros.h"#include "std_msgs/String.h"#include "bwi_scavenger/ObjectDetection.h"
Go to the source code of this file.
Functions | |
| void | callback (const sensor_msgs::ImageConstPtr &msg) |
| bool | callback_detection (bwi_scavenger::ObjectDetection::Request &req, bwi_scavenger::ObjectDetection::Response &res) |
| int | main (int argc, char **argv) |
Variables | |
| cv_bridge::CvImageConstPtr | cv_ptr |
| std::string | default_dir = "/home/bwi/shiqi/" |
| std::string | directory |
| std::string | file |
| Mat | frame |
| std::string | name |
| void callback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 33 of file object_detection.cpp.
| bool callback_detection | ( | bwi_scavenger::ObjectDetection::Request & | req, |
| bwi_scavenger::ObjectDetection::Response & | res | ||
| ) |
Definition at line 40 of file object_detection.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 189 of file object_detection.cpp.
Definition at line 26 of file object_detection.cpp.
| std::string default_dir = "/home/bwi/shiqi/" |
Definition at line 30 of file object_detection.cpp.
| std::string directory |
Definition at line 29 of file object_detection.cpp.
| std::string file |
Definition at line 29 of file object_detection.cpp.
| Mat frame |
Definition at line 27 of file object_detection.cpp.
| std::string name |
Definition at line 29 of file object_detection.cpp.