#include <iri_base_algorithm/iri_base_algorithm.h>
#include "people_follower_alg.h"
#include <geometry_msgs/PoseStamped.h>
#include <iri_people_tracking/peopleTrackingArray.h>
#include <iri_action_server/iri_action_server.h>
#include <iri_nav_msgs/followTargetAction.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib/client/terminal_state.h>
#include <move_base_msgs/MoveBaseAction.h>
#include "eventserver.h"
Go to the source code of this file.
Classes | |
class | PeopleFollowerAlgNode |
IRI ROS Specific Algorithm Class. More... |