#include <esc_test.h>
Public Member Functions | |
| ESCTest () | |
| void | init (ESCSystem *system) |
| void | spin () |
Protected Member Functions | |
| void | positionCallback (const std_msgs::Float32MultiArray::ConstPtr &msg) |
| void | publish () |
| void | velocityCallback (const std_msgs::Float32MultiArray::ConstPtr &msg) |
Protected Attributes | |
| ros::NodeHandle | nh_ |
| std::vector< float > | pos_ |
| ros::Subscriber | pos_sub_ |
| ros::Publisher | state_val_pub_ |
| ESCSystem * | system_ |
| ros::Publisher | val_pub_ |
| std::vector< float > | vel_ |
| ros::Subscriber | vel_sub_ |
Definition at line 5 of file esc_test.h.
| ESCTest::ESCTest | ( | ) | [inline] |
Definition at line 21 of file esc_test.h.
| void ESCTest::init | ( | ESCSystem * | system | ) |
Definition at line 31 of file esc_test.cpp.
| void ESCTest::positionCallback | ( | const std_msgs::Float32MultiArray::ConstPtr & | msg | ) | [protected] |
Definition at line 13 of file esc_test.cpp.
| void ESCTest::publish | ( | ) | [protected] |
Definition at line 19 of file esc_test.cpp.
| void ESCTest::spin | ( | ) |
Definition at line 43 of file esc_test.cpp.
| void ESCTest::velocityCallback | ( | const std_msgs::Float32MultiArray::ConstPtr & | msg | ) | [protected] |
Definition at line 7 of file esc_test.cpp.
ros::NodeHandle ESCTest::nh_ [protected] |
Definition at line 8 of file esc_test.h.
std::vector<float> ESCTest::pos_ [protected] |
Definition at line 13 of file esc_test.h.
ros::Subscriber ESCTest::pos_sub_ [protected] |
Definition at line 10 of file esc_test.h.
ros::Publisher ESCTest::state_val_pub_ [protected] |
Definition at line 9 of file esc_test.h.
ESCSystem* ESCTest::system_ [protected] |
Definition at line 12 of file esc_test.h.
ros::Publisher ESCTest::val_pub_ [protected] |
Definition at line 9 of file esc_test.h.
std::vector<float> ESCTest::vel_ [protected] |
Definition at line 13 of file esc_test.h.
ros::Subscriber ESCTest::vel_sub_ [protected] |
Definition at line 10 of file esc_test.h.