Public Member Functions | Private Member Functions | Private Attributes | List of all members
thormang3::MotionModuleTutorial Class Reference

#include <motion_module_tutorial.h>

Inheritance diagram for thormang3::MotionModuleTutorial:
Inheritance graph
[legend]

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 >
Singletonoperator= (Singleton const &)
 
 Singleton (Singleton const &)
 
 Singleton ()
 
- Protected Attributes inherited from robotis_framework::MotionModule
ControlMode control_mode_
 
bool enable_
 
std::string module_name_
 

Detailed Description

Definition at line 30 of file motion_module_tutorial.h.

Constructor & Destructor Documentation

MotionModuleTutorial::MotionModuleTutorial ( )

Definition at line 22 of file motion_module_tutorial.cpp.

MotionModuleTutorial::~MotionModuleTutorial ( )
virtual

Definition at line 34 of file motion_module_tutorial.cpp.

Member Function Documentation

void MotionModuleTutorial::initialize ( const int  control_cycle_msec,
robotis_framework::Robot robot 
)
virtual

Implements robotis_framework::MotionModule.

Definition at line 39 of file motion_module_tutorial.cpp.

bool MotionModuleTutorial::isRunning ( )
virtual

Implements robotis_framework::MotionModule.

Definition at line 95 of file motion_module_tutorial.cpp.

void MotionModuleTutorial::process ( std::map< std::string, robotis_framework::Dynamixel * >  dxls,
std::map< std::string, double >  sensors 
)
virtual

Implements robotis_framework::MotionModule.

Definition at line 70 of file motion_module_tutorial.cpp.

void MotionModuleTutorial::queueThread ( )
private

Definition at line 45 of file motion_module_tutorial.cpp.

void MotionModuleTutorial::stop ( )
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.

Member Data Documentation

int thormang3::MotionModuleTutorial::control_cycle_msec_
private

Definition at line 35 of file motion_module_tutorial.h.

ros::Publisher thormang3::MotionModuleTutorial::pub1_
private

Definition at line 40 of file motion_module_tutorial.h.

boost::thread thormang3::MotionModuleTutorial::queue_thread_
private

Definition at line 36 of file motion_module_tutorial.h.

ros::Subscriber thormang3::MotionModuleTutorial::sub1_
private

Definition at line 39 of file motion_module_tutorial.h.


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


motion_module_tutorial
Author(s): Zerom , SCH , Kayman
autogenerated on Mon Jun 10 2019 15:37:41