#include <motion_module_tutorial.h>
Public Member Functions | |
void | initialize (const int control_cycle_msec, robotis_framework::Robot *robot) |
bool | isRunning () |
MotionModuleTutorial () | |
void | process (std::map< std::string, robotis_framework::Dynamixel * > dxls, std::map< std::string, double > sensors) |
void | stop () |
void | topicCallback (const std_msgs::Int16::ConstPtr &msg) |
virtual | ~MotionModuleTutorial () |
Public Member Functions inherited from robotis_framework::MotionModule | |
ControlMode | getControlMode () |
bool | getModuleEnable () |
std::string | getModuleName () |
virtual void | onModuleDisable () |
virtual void | onModuleEnable () |
void | setModuleEnable (bool enable) |
virtual | ~MotionModule () |
Private Member Functions | |
void | queueThread () |
Private Attributes | |
int | control_cycle_msec_ |
ros::Publisher | pub1_ |
boost::thread | queue_thread_ |
ros::Subscriber | sub1_ |
Additional Inherited Members | |
Static Public Member Functions inherited from robotis_framework::Singleton< MotionModuleTutorial > | |
static void | destroyInstance () |
static T * | getInstance () |
Public Attributes inherited from robotis_framework::MotionModule | |
std::map< std::string, DynamixelState * > | result_ |
Protected Member Functions inherited from robotis_framework::Singleton< MotionModuleTutorial > | |
Singleton & | operator= (Singleton const &) |
Singleton (Singleton const &) | |
Singleton () | |
Protected Attributes inherited from robotis_framework::MotionModule | |
ControlMode | control_mode_ |
bool | enable_ |
std::string | module_name_ |
Definition at line 30 of file motion_module_tutorial.h.
MotionModuleTutorial::MotionModuleTutorial | ( | ) |
Definition at line 22 of file motion_module_tutorial.cpp.
|
virtual |
Definition at line 34 of file motion_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::MotionModule.
Definition at line 39 of file motion_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::MotionModule.
Definition at line 95 of file motion_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::MotionModule.
Definition at line 70 of file motion_module_tutorial.cpp.
|
private |
Definition at line 45 of file motion_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::MotionModule.
Definition at line 90 of file motion_module_tutorial.cpp.
void MotionModuleTutorial::topicCallback | ( | const std_msgs::Int16::ConstPtr & | msg | ) |
Definition at line 63 of file motion_module_tutorial.cpp.
|
private |
Definition at line 35 of file motion_module_tutorial.h.
|
private |
Definition at line 40 of file motion_module_tutorial.h.
|
private |
Definition at line 36 of file motion_module_tutorial.h.
|
private |
Definition at line 39 of file motion_module_tutorial.h.