Public Attributes | List of all members
pr2_hardware_interface::AccelerometerState Class Reference

#include <hardware_interface.h>

Public Attributes

std::string frame_id_
 Frame id of accelerometer. More...
 
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). More...
 

Detailed Description

Definition at line 195 of file hardware_interface.h.

Member Data Documentation

std::string pr2_hardware_interface::AccelerometerState::frame_id_

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.


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


pr2_hardware_interface
Author(s): Eric Berger berger@willowgarage.com
autogenerated on Fri Jun 7 2019 22:04:17