Public Member Functions | |
| Pr2GripperAction (ros::NodeHandle &n) | |
| ~Pr2GripperAction () | |
Private Types | |
| typedef actionlib::ActionServer< pr2_controllers_msgs::Pr2GripperCommandAction > | GAS |
| typedef GAS::GoalHandle | GoalHandle |
Private Member Functions | |
| void | cancelCB (GoalHandle gh) |
| void | controllerStateCB (const pr2_controllers_msgs::JointControllerStateConstPtr &msg) |
| void | goalCB (GoalHandle gh) |
| void | watchdog (const ros::TimerEvent &e) |
Private Attributes | |
| GAS | action_server_ |
| GoalHandle | active_goal_ |
| ros::Time | goal_received_ |
| double | goal_threshold_ |
| bool | has_active_goal_ |
| pr2_controllers_msgs::JointControllerStateConstPtr | last_controller_state_ |
| ros::Time | last_movement_time_ |
| double | min_error_seen_ |
| ros::NodeHandle | node_ |
| ros::Publisher | pub_controller_command_ |
| double | stall_timeout_ |
| double | stall_velocity_threshold_ |
| ros::Subscriber | sub_controller_state_ |
| ros::Timer | watchdog_timer_ |
Definition at line 41 of file pr2_gripper_action.cpp.
|
private |
Definition at line 44 of file pr2_gripper_action.cpp.
|
private |
Definition at line 45 of file pr2_gripper_action.cpp.
|
inline |
Definition at line 47 of file pr2_gripper_action.cpp.
|
inline |
Definition at line 70 of file pr2_gripper_action.cpp.
|
inlineprivate |
Definition at line 145 of file pr2_gripper_action.cpp.
|
inlineprivate |
Definition at line 167 of file pr2_gripper_action.cpp.
|
inlineprivate |
Definition at line 124 of file pr2_gripper_action.cpp.
|
inlineprivate |
Definition at line 95 of file pr2_gripper_action.cpp.
|
private |
Definition at line 80 of file pr2_gripper_action.cpp.
|
private |
Definition at line 86 of file pr2_gripper_action.cpp.
|
private |
Definition at line 87 of file pr2_gripper_action.cpp.
|
private |
Definition at line 90 of file pr2_gripper_action.cpp.
|
private |
Definition at line 85 of file pr2_gripper_action.cpp.
|
private |
Definition at line 166 of file pr2_gripper_action.cpp.
|
private |
Definition at line 93 of file pr2_gripper_action.cpp.
|
private |
Definition at line 89 of file pr2_gripper_action.cpp.
|
private |
Definition at line 79 of file pr2_gripper_action.cpp.
|
private |
Definition at line 81 of file pr2_gripper_action.cpp.
|
private |
Definition at line 92 of file pr2_gripper_action.cpp.
|
private |
Definition at line 91 of file pr2_gripper_action.cpp.
|
private |
Definition at line 82 of file pr2_gripper_action.cpp.
|
private |
Definition at line 83 of file pr2_gripper_action.cpp.