#include <iri_base_algorithm/iri_base_algorithm.h>#include "darwin_icra12_alg.h"#include <tf/transform_listener.h>#include <geometry_msgs/PoseStamped.h>#include <control_msgs/FollowJointTrajectoryAction.h>#include <move_base_msgs/MoveBaseAction.h>#include <actionlib/client/simple_action_client.h>#include <actionlib/client/terminal_state.h>#include <arm_navigation_msgs/MoveArmAction.h>

Go to the source code of this file.
Classes | |
| class | DarwinIcra12AlgNode |
| IRI ROS Specific Algorithm Class. More... | |
Enumerations | |
| enum | TStates { detect_object = 0, make_decision, move_robot, move_arms, open_gripper, close_gripper, cancel_motion } |
| enum TStates |
| detect_object | |
| make_decision | |
| move_robot | |
| move_arms | |
| open_gripper | |
| close_gripper | |
| cancel_motion |
Definition at line 44 of file darwin_icra12_alg_node.h.