#include <ros/ros.h>#include <actionlib/server/simple_action_server.h>#include <pr2_plugs_msgs/VisionPlugDetectionAction.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 "actionlib_msgs/GoalStatus.h"#include <image_transport/image_transport.h>#include <tf/transform_listener.h>#include <cv_bridge/CvBridge.h>#include <tf/tf.h>#include <tf/transform_broadcaster.h>#include <visual_pose_estimation/object_detector.h>#include <visual_pose_estimation/pose_estimator.h>

Go to the source code of this file.
Classes | |
| class | DetectPlugAction |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 102 of file vision_detect_plug.cpp.