#include <hardware_interface.h>
Public Attributes | |
bool | good_ |
A vector of samples taken from force/torque sensor since the last iteration of the control loop (oldest samples first). More... | |
std::vector< geometry_msgs::Wrench > | samples_ |
Definition at line 220 of file hardware_interface.h.
bool pr2_hardware_interface::ForceTorqueState::good_ |
A vector of samples taken from force/torque sensor since the last iteration of the control loop (oldest samples first).
True if sensor is working properly. False if some type of error is detected.
Definition at line 223 of file hardware_interface.h.
std::vector<geometry_msgs::Wrench> pr2_hardware_interface::ForceTorqueState::samples_ |
Definition at line 225 of file hardware_interface.h.