#include <ros/ros.h>#include <actionlib/server/simple_action_server.h>#include <pr2_plugs_msgs/VisionOutletDetectionAction.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "actionlib_msgs/GoalID.h"#include "geometry_msgs/PoseStamped.h"#include "geometry_msgs/Vector3Stamped.h"#include "actionlib_msgs/GoalStatus.h"#include <stdexcept>#include "sensor_msgs/Image.h"#include <assert.h>#include <stdlib.h>#include <string.h>#include <float.h>#include <stdint.h>#include <math.h>#include "opencv2/core/types_c.h"#include <limits.h>#include "opencv2/core/core_c.h"#include "opencv2/core/core.hpp"#include "opencv2/imgproc/types_c.h"#include "opencv2/imgproc/imgproc_c.h"#include "opencv2/flann/flann.hpp"#include <boost/noncopyable.hpp>#include <boost/function.hpp>#include "image_transport/exception.h"#include "image_transport/loader_fwds.h"#include "image_transport/single_subscriber_publisher.h"#include <sensor_msgs/CameraInfo.h>#include "image_transport/transport_hints.h"#include <opencv/cv.h>#include <tf/transform_listener.h>#include "tf/tf.h"#include "tf/tfMessage.h"#include <map>#include <cv.h>#include <iostream>#include <cstdio>#include "one_way_descriptor.h"#include "one_way_descriptor_base.h"#include "features.h"#include "geometric_hash.h"#include <image_geometry/pinhole_camera_model.h>#include "outlet_pose_estimation/detail/outlet_tuple.h"
Go to the source code of this file.
Classes | |
| class | DetectOutletAction |
Functions | |
| bool | initFromParameters (Detector &detector, PoseEstimator &estimator) |
| int | main (int argc, char **argv) |
| bool initFromParameters | ( | Detector & | detector, | |
| PoseEstimator & | estimator | |||
| ) |
Definition at line 17 of file vision_detect_outlet.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 246 of file vision_detect_outlet.cpp.