Class EmptyControllerHandle
Defined in File empty_controller_handle.hpp
Inheritance Relationships
Base Type
public moveit_controller_manager::MoveItControllerHandle
Class Documentation
-
class EmptyControllerHandle : public moveit_controller_manager::MoveItControllerHandle
Public Functions
-
inline EmptyControllerHandle(const std::string &name, const std::string &logger_name)
-
inline bool sendTrajectory(const moveit_msgs::msg::RobotTrajectory &trajectory) override
-
inline bool cancelExecution() override
-
inline bool waitForExecution(const rclcpp::Duration&) override
Function called when the TrajectoryExecutionManager waits for a trajectory to finish.
- Returns:
Always returns true because a trajectory is never in progress.
-
inline moveit_controller_manager::ExecutionStatus getLastExecutionStatus() override
Gets the last trajectory execution status.
- Returns:
Always returns ExecutionStatus::FAILED.
-
inline EmptyControllerHandle(const std::string &name, const std::string &logger_name)