#include <sensor_module_tutorial.h>

Public Member Functions | |
| void | initialize (const int control_cycle_msec, robotis_framework::Robot *robot) |
| void | process (std::map< std::string, robotis_framework::Dynamixel * > dxls, std::map< std::string, robotis_framework::Sensor * > sensors) |
| SensorModuleTutorial () | |
| void | topicCallback (const std_msgs::Int16::ConstPtr &msg) |
| virtual | ~SensorModuleTutorial () |
Public Member Functions inherited from robotis_framework::SensorModule | |
| std::string | getModuleName () |
| virtual | ~SensorModule () |
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< SensorModuleTutorial > | |
| static void | destroyInstance () |
| static T * | getInstance () |
Public Attributes inherited from robotis_framework::SensorModule | |
| std::map< std::string, double > | result_ |
Protected Member Functions inherited from robotis_framework::Singleton< SensorModuleTutorial > | |
| Singleton & | operator= (Singleton const &) |
| Singleton (Singleton const &) | |
| Singleton () | |
Protected Attributes inherited from robotis_framework::SensorModule | |
| std::string | module_name_ |
Definition at line 30 of file sensor_module_tutorial.h.
| SensorModuleTutorial::SensorModuleTutorial | ( | ) |
Definition at line 22 of file sensor_module_tutorial.cpp.
|
virtual |
Definition at line 30 of file sensor_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::SensorModule.
Definition at line 35 of file sensor_module_tutorial.cpp.
|
virtual |
Implements robotis_framework::SensorModule.
Definition at line 66 of file sensor_module_tutorial.cpp.
|
private |
Definition at line 41 of file sensor_module_tutorial.cpp.
| void SensorModuleTutorial::topicCallback | ( | const std_msgs::Int16::ConstPtr & | msg | ) |
Definition at line 59 of file sensor_module_tutorial.cpp.
|
private |
Definition at line 35 of file sensor_module_tutorial.h.
|
private |
Definition at line 40 of file sensor_module_tutorial.h.
|
private |
Definition at line 36 of file sensor_module_tutorial.h.
|
private |
Definition at line 39 of file sensor_module_tutorial.h.