#include <iri_base_algorithm/iri_base_algorithm.h>#include "tibi_coop_alg.h"#include <sensor_msgs/Joy.h>#include <iri_goal_database/get_goal.h>#include <tibi_dabo_msgs/guideGoalAction.h>#include <iri_action_server/iri_action_server.h>#include <tibi_dabo_msgs/guiAction.h>#include <move_base_msgs/MoveBaseAction.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 | TibiCoopAlgNode | 
| IRI ROS Specific Algorithm Class.  More... | |
Enumerations | |
| enum | car_cmds { car_none = -1, car_set_goal = 0 } | 
| enum | dabo_cmds { dabo_none = -1, dabo_set_goal = 0, dabo_car_done } | 
| enum | gui_cmds { gui_none = -1, gui_set_goal = 0, gui_cancel_goal } | 
| enum | joy_cmds { joy_none = -1, joy_cancel_goal = 0, joy_replan_goal, joy_teleop } | 
| enum | tibi_cmds { tibi_none = -1, tibi_set_goal = 0, tibi_car_done } | 
| enum | tibi_states {  tibi_idle, tibi_wait_bored, tibi_wait_intro, tibi_set_car_goal, tibi_wait_guiding, tibi_wait_no_car, tibi_delay, tibi_wait_done, tibi_wait_car, tibi_wait_dabo, tibi_wait_home, tibi_wait_car_home }  | 
| enum car_cmds | 
Definition at line 51 of file tibi_coop_alg_node.h.
| enum dabo_cmds | 
Definition at line 53 of file tibi_coop_alg_node.h.
| enum gui_cmds | 
Definition at line 49 of file tibi_coop_alg_node.h.
| enum joy_cmds | 
Definition at line 57 of file tibi_coop_alg_node.h.
| enum tibi_cmds | 
Definition at line 55 of file tibi_coop_alg_node.h.
| enum tibi_states | 
| tibi_idle | |
| tibi_wait_bored | |
| tibi_wait_intro | |
| tibi_set_car_goal | |
| tibi_wait_guiding | |
| tibi_wait_no_car | |
| tibi_delay | |
| tibi_wait_done | |
| tibi_wait_car | |
| tibi_wait_dabo | |
| tibi_wait_home | |
| tibi_wait_car_home | 
Definition at line 46 of file tibi_coop_alg_node.h.