#include <iri_base_algorithm/iri_base_algorithm.h>
#include "camera_object_detection_alg.h"
#include <image_transport/image_transport.h>
#include <image_geometry/pinhole_camera_model.h>
#include <trajectory_msgs/JointTrajectoryPoint.h>
#include <iri_perception_msgs/peopleTrackingArray.h>
#include <sensor_msgs/CameraInfo.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib/client/terminal_state.h>
#include <iri_nav_msgs/followTargetAction.h>
#include <geometry_msgs/PointStamped.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Classes | |
class | CameraObjectDetectionAlgNode |
IRI ROS Specific Algorithm Class. More... |