#include <wg06.h>
Public Member Functions | |
const double & | calibration_coeff (unsigned row, unsigned col) const |
double & | calibration_coeff (unsigned row, unsigned col) |
FTParamsInternal () | |
const double & | gain (unsigned ch_num) const |
double & | gain (unsigned ch_num) |
bool | getDoubleArray (XmlRpc::XmlRpcValue params, const char *name, double *results, unsigned len) |
bool | getRosParams (ros::NodeHandle nh) |
Grabs ft rosparams from a given node hande namespace. | |
const double & | offset (unsigned ch_num) const |
double & | offset (unsigned ch_num) |
void | print () const |
Public Attributes | |
double | calibration_coeff_ [36] |
double | gains_ [6] |
double | offsets_ [6] |
const double& FTParamsInternal::calibration_coeff | ( | unsigned | row, |
unsigned | col | ||
) | const [inline] |
double& FTParamsInternal::calibration_coeff | ( | unsigned | row, |
unsigned | col | ||
) | [inline] |
const double& FTParamsInternal::gain | ( | unsigned | ch_num | ) | const [inline] |
double& FTParamsInternal::gain | ( | unsigned | ch_num | ) | [inline] |
bool FTParamsInternal::getDoubleArray | ( | XmlRpc::XmlRpcValue | params, |
const char * | name, | ||
double * | results, | ||
unsigned | len | ||
) |
bool FTParamsInternal::getRosParams | ( | ros::NodeHandle | nh | ) |
const double& FTParamsInternal::offset | ( | unsigned | ch_num | ) | const [inline] |
double& FTParamsInternal::offset | ( | unsigned | ch_num | ) | [inline] |
void FTParamsInternal::print | ( | ) | const |
double FTParamsInternal::calibration_coeff_[36] |
double FTParamsInternal::gains_[6] |
double FTParamsInternal::offsets_[6] |