#include <iri_base_algorithm/iri_base_algorithm.h>
#include <iri_wam_common_msgs/bhand_cmd.h>
#include <iri_wam_common_msgs/joints_move.h>
#include <iri_wam_common_msgs/wamInverseKinematics.h>
#include <actionlib/client/simple_action_client.h>
#include <iri_action_server/iri_action_server.h>
#include <iri_wam_common_msgs/SimpleBhandPickUpAction.h>
#include <iri_dynamixel_gripper/openAction.h>
#include <iri_dynamixel_gripper/closeAction.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseStamped.h>
#include <object_manipulation_msgs/GripperTranslation.h>
#include "grasp_generator.h"
#include "grasp_actions_alg.h"
Go to the source code of this file.
Classes | |
class | GraspActionsAlgNode |
IRI ROS Specific Algorithm Class. More... |