#include <iri_base_algorithm/iri_base_algorithm.h>
#include "tibi_dabo_haod_alg.h"
#include <trajectory_msgs/JointTrajectoryPoint.h>
#include <sensor_msgs/Joy.h>
#include <iri_human_assisted_object_detection/haod_learn.h>
#include <iri_human_assisted_object_detection/haod_detect.h>
#include <iri_human_assisted_object_detection/haod_init.h>
#include <iri_nav_msgs/followTargetAction.h>
#include <iri_action_server/iri_action_server.h>
#include <tibi_dabo_msgs/haodAction.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib/client/terminal_state.h>
#include <tibi_dabo_msgs/sequenceAction.h>
Go to the source code of this file.
Classes | |
class | TibiDaboHaodAlgNode |
IRI ROS Specific Algorithm Class. More... | |
Enumerations | |
enum | haod_states { haod_idle, haod_hri_intro, haod_init, haod_hri_init, haod_detect, haod_hri_help, haod_user_input, haod_learn, haod_hri_exit } |
enum | hri_actions { hri_intro = 0, hri_init = 1, hri_help = 2, hri_exit = 3 } |
enum | joy_actions { none, help, valid_det, invalid_det, end, force_end } |
enum | languages { catalan, english, spanish } |
enum haod_states |
haod_idle | |
haod_hri_intro | |
haod_init | |
haod_hri_init | |
haod_detect | |
haod_hri_help | |
haod_user_input | |
haod_learn | |
haod_hri_exit |
Definition at line 48 of file tibi_dabo_haod_alg_node.h.
enum hri_actions |
Definition at line 54 of file tibi_dabo_haod_alg_node.h.
enum joy_actions |
Definition at line 50 of file tibi_dabo_haod_alg_node.h.
enum languages |
Definition at line 52 of file tibi_dabo_haod_alg_node.h.