Public Member Functions | Protected Member Functions | Private Member Functions | Private Attributes | List of all members
moveit_fake_controller_manager::ThreadedController Class Referenceabstract

#include <moveit_fake_controllers.h>

Inheritance diagram for moveit_fake_controller_manager::ThreadedController:
Inheritance graph
[legend]

Public Member Functions

bool cancelExecution () override
 
moveit_controller_manager::ExecutionStatus getLastExecutionStatus () override
 
bool sendTrajectory (const moveit_msgs::RobotTrajectory &t) override
 
 ThreadedController (const std::string &name, const std::vector< std::string > &joints, const ros::Publisher &pub)
 
bool waitForExecution (const ros::Duration &) override
 
 ~ThreadedController () override
 
- Public Member Functions inherited from moveit_fake_controller_manager::BaseFakeController
 BaseFakeController (const std::string &name, const std::vector< std::string > &joints, const ros::Publisher &pub)
 
void getJoints (std::vector< std::string > &joints) const
 
- Public Member Functions inherited from moveit_controller_manager::MoveItControllerHandle
const std::string & getName () const
 
 MoveItControllerHandle (const std::string &name)
 
virtual ~MoveItControllerHandle ()
 

Protected Member Functions

bool cancelled ()
 

Private Member Functions

virtual void cancelTrajectory ()
 
virtual void execTrajectory (const moveit_msgs::RobotTrajectory &t)=0
 

Private Attributes

bool cancel_
 
moveit_controller_manager::ExecutionStatus status_
 
boost::thread thread_
 

Additional Inherited Members

- Protected Attributes inherited from moveit_fake_controller_manager::BaseFakeController
std::vector< std::string > joints_
 
const ros::Publisherpub_
 
- Protected Attributes inherited from moveit_controller_manager::MoveItControllerHandle
std::string name_
 

Detailed Description

Definition at line 109 of file moveit_fake_controllers.h.

Constructor & Destructor Documentation

◆ ThreadedController()

moveit_fake_controller_manager::ThreadedController::ThreadedController ( const std::string &  name,
const std::vector< std::string > &  joints,
const ros::Publisher pub 
)

Definition at line 138 of file moveit_fake_controllers.cpp.

◆ ~ThreadedController()

moveit_fake_controller_manager::ThreadedController::~ThreadedController ( )
override

Definition at line 144 of file moveit_fake_controllers.cpp.

Member Function Documentation

◆ cancelExecution()

bool moveit_fake_controller_manager::ThreadedController::cancelExecution ( )
overridevirtual

◆ cancelled()

bool moveit_fake_controller_manager::ThreadedController::cancelled ( )
inlineprotected

Definition at line 121 of file moveit_fake_controllers.h.

◆ cancelTrajectory()

void moveit_fake_controller_manager::ThreadedController::cancelTrajectory ( )
privatevirtual

Definition at line 149 of file moveit_fake_controllers.cpp.

◆ execTrajectory()

virtual void moveit_fake_controller_manager::ThreadedController::execTrajectory ( const moveit_msgs::RobotTrajectory &  t)
privatepure virtual

◆ getLastExecutionStatus()

moveit_controller_manager::ExecutionStatus moveit_fake_controller_manager::ThreadedController::getLastExecutionStatus ( )
overridevirtual

◆ sendTrajectory()

bool moveit_fake_controller_manager::ThreadedController::sendTrajectory ( const moveit_msgs::RobotTrajectory &  t)
overridevirtual

◆ waitForExecution()

bool moveit_fake_controller_manager::ThreadedController::waitForExecution ( const ros::Duration )
overridevirtual

Member Data Documentation

◆ cancel_

bool moveit_fake_controller_manager::ThreadedController::cancel_
private

Definition at line 132 of file moveit_fake_controllers.h.

◆ status_

moveit_controller_manager::ExecutionStatus moveit_fake_controller_manager::ThreadedController::status_
private

Definition at line 133 of file moveit_fake_controllers.h.

◆ thread_

boost::thread moveit_fake_controller_manager::ThreadedController::thread_
private

Definition at line 131 of file moveit_fake_controllers.h.


The documentation for this class was generated from the following files:


moveit_fake_controller_manager
Author(s): Ioan Sucan
autogenerated on Sat May 3 2025 02:26:28