Public Member Functions | |
AttachBoundingBoxServer () | |
bool | execute (const cotesys_ros_grasping::AttachBoundingBoxGoalConstPtr &goal) |
Private Attributes | |
boost::shared_ptr < actionlib::SimpleActionServer < cotesys_ros_grasping::AttachBoundingBoxAction > > | action_server_ |
ros::Publisher | attached_object_publisher_ |
std::string | default_object_name_ |
std::string | left_arm_name_ |
std::string | left_attach_link_ |
std::vector< std::string > | left_end_effector_links_ |
std::string | left_end_effector_planning_group_ |
double | link_to_gripper_x_diff_ |
double | link_to_gripper_y_diff_ |
double | link_to_gripper_z_diff_ |
ros::NodeHandle | priv_nh_ |
std::string | right_arm_name_ |
std::string | right_attach_link_ |
std::vector< std::string > | right_end_effector_links_ |
std::string | right_end_effector_planning_group_ |
ros::NodeHandle | root_nh_ |
tf::TransformListener | tf_ |
Definition at line 56 of file attach_bounding_box_server.cpp.
Definition at line 84 of file attach_bounding_box_server.cpp.
bool cotesys_ros_grasping::AttachBoundingBoxServer::execute | ( | const cotesys_ros_grasping::AttachBoundingBoxGoalConstPtr & | goal | ) |
Definition at line 145 of file attach_bounding_box_server.cpp.
boost::shared_ptr<actionlib::SimpleActionServer<cotesys_ros_grasping::AttachBoundingBoxAction> > cotesys_ros_grasping::AttachBoundingBoxServer::action_server_ [private] |
Definition at line 66 of file attach_bounding_box_server.cpp.
Definition at line 68 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::default_object_name_ [private] |
Definition at line 70 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::left_arm_name_ [private] |
Definition at line 71 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::left_attach_link_ [private] |
Definition at line 72 of file attach_bounding_box_server.cpp.
std::vector<std::string> cotesys_ros_grasping::AttachBoundingBoxServer::left_end_effector_links_ [private] |
Definition at line 74 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::left_end_effector_planning_group_ [private] |
Definition at line 77 of file attach_bounding_box_server.cpp.
Definition at line 79 of file attach_bounding_box_server.cpp.
Definition at line 79 of file attach_bounding_box_server.cpp.
Definition at line 79 of file attach_bounding_box_server.cpp.
Definition at line 67 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::right_arm_name_ [private] |
Definition at line 71 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::right_attach_link_ [private] |
Definition at line 72 of file attach_bounding_box_server.cpp.
std::vector<std::string> cotesys_ros_grasping::AttachBoundingBoxServer::right_end_effector_links_ [private] |
Definition at line 75 of file attach_bounding_box_server.cpp.
std::string cotesys_ros_grasping::AttachBoundingBoxServer::right_end_effector_planning_group_ [private] |
Definition at line 77 of file attach_bounding_box_server.cpp.
Definition at line 67 of file attach_bounding_box_server.cpp.
Definition at line 81 of file attach_bounding_box_server.cpp.