allowedExecutionDurationScaling() const | trajectory_execution_manager::TrajectoryExecutionManager | |
allowedGoalDurationMargin() const | trajectory_execution_manager::TrajectoryExecutionManager | |
allowedStartTolerance() const | trajectory_execution_manager::TrajectoryExecutionManager | |
areControllersActive(const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
clear() | trajectory_execution_manager::TrajectoryExecutionManager | |
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 | |
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 | |
EXECUTION_EVENT_TOPIC | trajectory_execution_manager::TrajectoryExecutionManager | static |
ExecutionCompleteCallback typedef | trajectory_execution_manager::TrajectoryExecutionManager | |
executionDurationMonitoring() const | trajectory_execution_manager::TrajectoryExecutionManager | |
executionVelocityScaling() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getControllerManager() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getControllerManagerNode() | trajectory_execution_manager::TrajectoryExecutionManager | inline |
getCurrentExpectedTrajectoryIndex() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getLastExecutionStatus() const | trajectory_execution_manager::TrajectoryExecutionManager | |
getTrajectories() const | trajectory_execution_manager::TrajectoryExecutionManager | |
isControllerActive(const std::string &controller) | trajectory_execution_manager::TrajectoryExecutionManager | |
isManagingControllers() const | trajectory_execution_manager::TrajectoryExecutionManager | |
PathSegmentCompleteCallback typedef | trajectory_execution_manager::TrajectoryExecutionManager | |
processEvent(const std::string &event) | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const moveit_msgs::msg::RobotTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const trajectory_msgs::msg::JointTrajectory &trajectory, const std::string &controller="") | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const trajectory_msgs::msg::JointTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
push(const moveit_msgs::msg::RobotTrajectory &trajectory, const std::vector< std::string > &controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
setAllowedExecutionDurationScaling(double scaling) | trajectory_execution_manager::TrajectoryExecutionManager | |
setAllowedGoalDurationMargin(double margin) | trajectory_execution_manager::TrajectoryExecutionManager | |
setAllowedStartTolerance(double tolerance) | trajectory_execution_manager::TrajectoryExecutionManager | |
setExecutionVelocityScaling(double scaling) | trajectory_execution_manager::TrajectoryExecutionManager | |
setWaitForTrajectoryCompletion(bool flag) | trajectory_execution_manager::TrajectoryExecutionManager | |
stopExecution(bool auto_clear=true) | trajectory_execution_manager::TrajectoryExecutionManager | |
TrajectoryExecutionManager(const rclcpp::Node::SharedPtr &node, const moveit::core::RobotModelConstPtr &robot_model, const planning_scene_monitor::CurrentStateMonitorPtr &csm) | trajectory_execution_manager::TrajectoryExecutionManager | |
TrajectoryExecutionManager(const rclcpp::Node::SharedPtr &node, const moveit::core::RobotModelConstPtr &robot_model, const planning_scene_monitor::CurrentStateMonitorPtr &csm, bool manage_controllers) | trajectory_execution_manager::TrajectoryExecutionManager | |
waitForExecution() | trajectory_execution_manager::TrajectoryExecutionManager | |
waitForTrajectoryCompletion() const | trajectory_execution_manager::TrajectoryExecutionManager | |
~TrajectoryExecutionManager() | trajectory_execution_manager::TrajectoryExecutionManager | |