, including all inherited members.
active_handles_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
allowed_execution_duration_scaling_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
allowed_goal_duration_margin_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
areControllersActive(const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
checkControllerCombination(std::vector< std::string > &controllers, const std::set< std::string > &actuated_joints) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
clear() | trajectory_execution_manager::TrajectoryExecutionManager | |
configure(TrajectoryExecutionContext &context, const moveit_msgs::RobotTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
continuous_execution_condition_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
continuous_execution_mutex_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
continuous_execution_queue_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
continuous_execution_thread_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
continuousExecutionThread() | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
controller_manager_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
controller_manager_loader_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
current_context_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
distributeTrajectory(const moveit_msgs::RobotTrajectory &trajectory, const std::vector< std::string > &controllers, std::vector< moveit_msgs::RobotTrajectory > &parts) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
enableExecutionDurationMonitoring(bool flag) | trajectory_execution_manager::TrajectoryExecutionManager | |
ensureActiveController(const std::string &controller) | trajectory_execution_manager::TrajectoryExecutionManager | |
ensureActiveControllers(const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
ensureActiveControllersForGroup(const std::string &group) | trajectory_execution_manager::TrajectoryExecutionManager | |
ensureActiveControllersForJoints(const std::vector< std::string > &joints) | trajectory_execution_manager::TrajectoryExecutionManager | |
event_topic_subscriber_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execute(const ExecutionCompleteCallback &callback=ExecutionCompleteCallback(), bool auto_clear=true) | trajectory_execution_manager::TrajectoryExecutionManager | |
execute(const ExecutionCompleteCallback &callback, const PathSegmentCompleteCallback &part_callback, bool auto_clear=true) | trajectory_execution_manager::TrajectoryExecutionManager | |
executeAndWait(bool auto_clear=true) | trajectory_execution_manager::TrajectoryExecutionManager | |
executePart(std::size_t part_index) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
executeThread(const ExecutionCompleteCallback &callback, const PathSegmentCompleteCallback &part_callback, bool auto_clear) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execution_complete_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execution_complete_condition_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execution_duration_monitoring_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
EXECUTION_EVENT_TOPIC | trajectory_execution_manager::TrajectoryExecutionManager | [static] |
execution_state_mutex_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execution_thread_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
execution_velocity_scaling_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
ExecutionCompleteCallback typedef | trajectory_execution_manager::TrajectoryExecutionManager | |
findControllers(const std::set< std::string > &actuated_joints, std::size_t controller_count, const std::vector< std::string > &available_controllers, std::vector< std::string > &selected_controllers) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
generateControllerCombination(std::size_t start_index, std::size_t controller_count, const std::vector< std::string > &available_controllers, std::vector< std::string > &selected_controllers, std::vector< std::vector< std::string > > &selected_options, const std::set< std::string > &actuated_joints) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
getControllerManager() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getCurrentExpectedTrajectoryIndex() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getLastExecutionStatus() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getTrajectories() const | trajectory_execution_manager::TrajectoryExecutionManager | |
initialize() | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
isControllerActive(const std::string &controller) | trajectory_execution_manager::TrajectoryExecutionManager | |
isManagingControllers() const | trajectory_execution_manager::TrajectoryExecutionManager | |
known_controllers_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
last_execution_status_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
manage_controllers_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
node_handle_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
PathSegmentCompleteCallback typedef | trajectory_execution_manager::TrajectoryExecutionManager | |
processEvent(const std::string &event) | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const moveit_msgs::RobotTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const trajectory_msgs::JointTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const trajectory_msgs::JointTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const moveit_msgs::RobotTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const moveit_msgs::RobotTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const trajectory_msgs::JointTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const sensor_msgs::JointState &state, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const trajectory_msgs::JointTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const moveit_msgs::RobotTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
pushAndExecute(const sensor_msgs::JointState &state, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
receiveEvent(const std_msgs::StringConstPtr &event) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
reconfigure_impl_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
reloadControllerInformation() | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
robot_model_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
root_node_handle_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
run_continuous_execution_thread_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
selectControllers(const std::set< std::string > &actuated_joints, const std::vector< std::string > &available_controllers, std::vector< std::string > &selected_controllers) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
setAllowedExecutionDurationScaling(double scaling) | trajectory_execution_manager::TrajectoryExecutionManager | |
setExecutionVelocityScaling(double scaling) | trajectory_execution_manager::TrajectoryExecutionManager | |
stop_continuous_execution_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
stopExecution(bool auto_clear=true) | trajectory_execution_manager::TrajectoryExecutionManager | |
stopExecutionInternal() | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
time_index_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
time_index_mutex_ | trajectory_execution_manager::TrajectoryExecutionManager | [mutable, private] |
trajectories_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
TrajectoryExecutionManager(const robot_model::RobotModelConstPtr &kmodel) | trajectory_execution_manager::TrajectoryExecutionManager | |
TrajectoryExecutionManager(const robot_model::RobotModelConstPtr &kmodel, bool manage_controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
updateControllersState(const ros::Duration &age) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
updateControllerState(const std::string &controller, const ros::Duration &age) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
updateControllerState(ControllerInformation &ci, const ros::Duration &age) | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
verbose_ | trajectory_execution_manager::TrajectoryExecutionManager | [private] |
waitForExecution() | trajectory_execution_manager::TrajectoryExecutionManager | |
~TrajectoryExecutionManager() | trajectory_execution_manager::TrajectoryExecutionManager | |