, including all inherited members.
_addNewStateToTrajectory(const ros::Time &time, const std::map< std::string, double > &joint_positions, const std::map< std::string, double > &joint_velocities, trajectory_msgs::JointTrajectory &trajectory) | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
addNewStateToRecordedTrajectory(const ros::Time &time, const std::map< std::string, double > &joint_positions, const std::map< std::string, double > &joint_velocities) | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
cancelExecution() | Pr2GripperTrajectoryControllerHandler | [inline, virtual] |
combineGroupAndControllerNames(const std::string &group_name, const std::string &controller_name) | trajectory_execution_monitor::TrajectoryControllerHandler | [inline, static] |
controller_name_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
controller_state_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
controllerActiveCallback() | Pr2GripperTrajectoryControllerHandler | [inline] |
controllerDoneCallback(const actionlib::SimpleClientGoalState &state, const pr2_controllers_msgs::Pr2GripperCommandResultConstPtr &result) | Pr2GripperTrajectoryControllerHandler | [inline] |
controllerFeedbackCallback(const pr2_controllers_msgs::Pr2GripperCommandFeedbackConstPtr &feedback) | Pr2GripperTrajectoryControllerHandler | [inline] |
DEFAULT_GRIPPER_OBJECT_PRESENCE_THRESHOLD | Pr2GripperTrajectoryControllerHandler | [static] |
disableOvershoot() | trajectory_execution_monitor::TrajectoryControllerHandler | |
done() | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
doneDelayed() | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
enableOvershoot(double max_overshoot_velocity_epsilon, ros::Duration min_overshoot_time, ros::Duration max_overshoot_time) | Pr2GripperTrajectoryControllerHandler | [inline] |
executeTrajectory(const trajectory_msgs::JointTrajectory &trajectory, boost::shared_ptr< trajectory_execution_monitor::TrajectoryRecorder > &recorder, const trajectory_execution_monitor::TrajectoryFinishedCallbackFunction &traj_callback) | Pr2GripperTrajectoryControllerHandler | [inline, virtual] |
findClosestIndex(ros::Duration time_from_start) | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
getControllerName() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
getGroupControllerComboName() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
getGroupName() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
getLastGoalTrajectory() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
getLastOvershootTrajectory() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
getLastRecordedTrajectory() const | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
goal_trajectory_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
GRIPPER_CLOSED | Pr2GripperTrajectoryControllerHandler | [static] |
GRIPPER_OPEN | Pr2GripperTrajectoryControllerHandler | [static] |
group_controller_combo_name_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
group_name_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
initializeOvershootTrajectory() | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
initializeRecordedTrajectory(const trajectory_msgs::JointTrajectory &goal_trajectory) | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
max_overshoot_time_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
max_overshoot_velocity_epsilon_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
min_overshoot_time_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
monitor_overshoot_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
nh_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
overshoot_trajectory_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
pr2_gripper_action_client_ | Pr2GripperTrajectoryControllerHandler | [protected] |
Pr2GripperTrajectoryControllerHandler(const std::string &group_name, const std::string &controller_name) | Pr2GripperTrajectoryControllerHandler | [inline] |
recorded_trajectory_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
recorder_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
setMaximumExecutionTime(ros::Duration max_execution_time) | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
timeout(const ros::TimerEvent &event) | trajectory_execution_monitor::TrajectoryControllerHandler | |
timeout_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
timer_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
trajectory_finished_callback_ | trajectory_execution_monitor::TrajectoryControllerHandler | [protected] |
TrajectoryControllerHandler(const std::string &group_name, const std::string &controller_name) | trajectory_execution_monitor::TrajectoryControllerHandler | [inline] |
~TrajectoryControllerHandler() | trajectory_execution_monitor::TrajectoryControllerHandler | [inline, virtual] |