#include <iri_base_algorithm/iri_base_algorithm.h>
#include "convert_pose_alg.h"
#include "eventserver.h"
#include <iostream>
#include "stdlib.h"
#include "math.h"
#include <tf/transform_listener.h>
#include <geometry_msgs/Twist.h>
#include <sensor_msgs/JointState.h>
#include <std_msgs/Float64MultiArray.h>
#include <std_msgs/Int32.h>
#include <ar_pose/ARMarkers.h>
#include <geometry_msgs/PoseStamped.h>
#include <kinematics_msgs/GetPositionIK.h>
#include <iri_darwin_robot/tracking_headAction.h>
#include <control_msgs/FollowJointTrajectoryAction.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 | ConvertPoseAlgNode |
IRI ROS Specific Algorithm Class. More... | |
Enumerations | |
enum | TStates { initial_pose = 0, initial_angle, move_back, search_left_marker, transform_left_pose, search_right_marker, transform_right_pose, make_decision, make_decision2, open_gripper, take_connectors, take_connectors2, close_gripper, done, correct_position, tracking_angle, tracking_left, tracking_right, tracking, new_goal, go_forward, go_back, turn_right, turn_left, go_right, go_left } |
enum TStates |
Definition at line 54 of file convert_pose_alg_node.h.