#include <moveit_fake_controllers.h>

Public Member Functions | |
| ViaPointController (const std::string &name, const std::vector< std::string > &joints, const ros::Publisher &pub) | |
| ~ViaPointController () | |
Protected Member Functions | |
| virtual void | execTrajectory (const moveit_msgs::RobotTrajectory &t) |
Definition at line 104 of file moveit_fake_controllers.h.
| moveit_fake_controller_manager::ViaPointController::ViaPointController | ( | const std::string & | name, |
| const std::vector< std::string > & | joints, | ||
| const ros::Publisher & | pub | ||
| ) |
Definition at line 153 of file moveit_fake_controllers.cpp.
Definition at line 159 of file moveit_fake_controllers.cpp.
| void moveit_fake_controller_manager::ViaPointController::execTrajectory | ( | const moveit_msgs::RobotTrajectory & | t | ) | [protected, virtual] |
Implements moveit_fake_controller_manager::ThreadedController.
Definition at line 163 of file moveit_fake_controllers.cpp.