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 40 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 43 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 44 of file pr2_gripper_sensor_action.cpp.
|
inline |
Definition at line 47 of file pr2_gripper_sensor_action.cpp.
|
inline |
Definition at line 69 of file pr2_gripper_sensor_action.cpp.
|
inlineprivate |
Definition at line 144 of file pr2_gripper_sensor_action.cpp.
|
inlineprivate |
Definition at line 176 of file pr2_gripper_sensor_action.cpp.
|
inlineprivate |
Definition at line 123 of file pr2_gripper_sensor_action.cpp.
|
inlineprivate |
Definition at line 94 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 79 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 85 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 86 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 89 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 84 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 175 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 92 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 88 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 78 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 80 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 91 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 90 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 81 of file pr2_gripper_sensor_action.cpp.
|
private |
Definition at line 82 of file pr2_gripper_sensor_action.cpp.