#include <hardware_interface.h>
Public Attributes | |
std::string | frame_id_ |
Frame id of accelerometer. | |
std::vector < geometry_msgs::Vector3 > | samples_ |
A vector of samples taken from the accelerometer (in m/s/s) since the last iteration of the control loop (oldest samples first). |
Definition at line 195 of file hardware_interface.h.
Frame id of accelerometer.
Definition at line 198 of file hardware_interface.h.
std::vector<geometry_msgs::Vector3> pr2_hardware_interface::AccelerometerState::samples_ |
A vector of samples taken from the accelerometer (in m/s/s) since the last iteration of the control loop (oldest samples first).
Definition at line 199 of file hardware_interface.h.