Public Member Functions | |
| ArmThrowNode () | |
| void | closeGripper () |
| void | openGripper () |
| void | preThrowCmd () |
| void | run () |
| void | throwCmd () |
| void | throwProcess () |
Private Member Functions | |
| void | activeCb () |
| void | doneCb (const actionlib::SimpleClientGoalState &state, const control_msgs::FollowJointTrajectoryResultConstPtr &result) |
| void | feedbackCb (const control_msgs::FollowJointTrajectoryFeedbackConstPtr &feedback) |
| bool | setArmCmd (double pos) |
| control_msgs::FollowJointTrajectoryGoal | setGoalTja (double pos) |
| bool | setGripperCmd (double pos, double effort=0) |
Private Attributes | |
| bool | _alreadyOpen |
| ArmClient | _armClient |
| ros::Subscriber | _feedbackListener |
| GripperClient | _gripperClient |
| bool | _needToOpen |
| ros::NodeHandle | _nodeHandle |
| ros::AsyncSpinner | _spinner |
Definition at line 19 of file arm_trajectory_demo.cpp.
| ArmThrowNode::ArmThrowNode | ( | ) | [inline] |
Definition at line 85 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::activeCb | ( | ) | [inline, private] |
Definition at line 39 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::closeGripper | ( | ) | [inline] |
Definition at line 127 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::doneCb | ( | const actionlib::SimpleClientGoalState & | state, |
| const control_msgs::FollowJointTrajectoryResultConstPtr & | result | ||
| ) | [inline, private] |
Definition at line 28 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::feedbackCb | ( | const control_msgs::FollowJointTrajectoryFeedbackConstPtr & | feedback | ) | [inline, private] |
Definition at line 32 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::openGripper | ( | ) | [inline] |
Definition at line 123 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::preThrowCmd | ( | ) | [inline] |
Definition at line 132 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::run | ( | ) | [inline] |
Definition at line 98 of file arm_trajectory_demo.cpp.
| bool ArmThrowNode::setArmCmd | ( | double | pos | ) | [inline, private] |
Definition at line 75 of file arm_trajectory_demo.cpp.
| control_msgs::FollowJointTrajectoryGoal ArmThrowNode::setGoalTja | ( | double | pos | ) | [inline, private] |
Definition at line 55 of file arm_trajectory_demo.cpp.
| bool ArmThrowNode::setGripperCmd | ( | double | pos, |
| double | effort = 0 |
||
| ) | [inline, private] |
Definition at line 43 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::throwCmd | ( | ) | [inline] |
Definition at line 136 of file arm_trajectory_demo.cpp.
| void ArmThrowNode::throwProcess | ( | ) | [inline] |
Definition at line 112 of file arm_trajectory_demo.cpp.
bool ArmThrowNode::_alreadyOpen [private] |
Definition at line 27 of file arm_trajectory_demo.cpp.
ArmClient ArmThrowNode::_armClient [private] |
Definition at line 24 of file arm_trajectory_demo.cpp.
Definition at line 23 of file arm_trajectory_demo.cpp.
GripperClient ArmThrowNode::_gripperClient [private] |
Definition at line 25 of file arm_trajectory_demo.cpp.
bool ArmThrowNode::_needToOpen [private] |
Definition at line 26 of file arm_trajectory_demo.cpp.
ros::NodeHandle ArmThrowNode::_nodeHandle [private] |
Definition at line 21 of file arm_trajectory_demo.cpp.
ros::AsyncSpinner ArmThrowNode::_spinner [private] |
Definition at line 22 of file arm_trajectory_demo.cpp.