Classes | Functions | Variables
JointCommandFinger_Test.cpp File Reference
#include <gtest/gtest.h>
#include <boost/shared_ptr.hpp>
#include <boost/make_shared.hpp>
#include "robot_instance/RobotInstanceFactory.h"
#include "robot_instance/CoeffMapLoader.h"
#include "robodyn_mechanisms/JointCommandFinger.h"
#include <ros/package.h>
#include "r2_msgs/JointControlData.h"
Include dependency graph for JointCommandFinger_Test.cpp:

Go to the source code of this file.

Classes

class  JointCommandFingerTest

Functions

std::vector< std::string > getActuatorNames (std::string mechanism)
std::vector< std::string > getAllJointNames (std::string mechanism)
bool getBoolParam (std::string paramName, bool &value)
float getBrainstemCoeff (std::string item)
std::string getCommandFile (std::string mechanism)
bool getDoubleParam (std::string paramName, double &value)
float getInt16 (std::string item)
bool getIntParam (std::string paramName, int &value)
std::vector< std::string > getJointNames (std::string mechanism)
float getLiveCoeff (std::string coeff)
float getMotorCoeff (std::string item)
bool getStringParam (std::string paramName, std::string &value)
float getUint16 (std::string item)
bool hasLiveCoeff (std::string coeff)
bool hasParam (std::string paramName)
int main (int argc, char **argv)
void setBoolParam (std::string paramName, bool value)
void setDoubleParam (std::string paramName, double value)
void setInt16 (std::string item, int16_t value)
void setIntParam (std::string paramName, int value)
void setLiveCoeff (std::string coeff, float value)
void setStringParam (std::string paramName, std::string value)
void setUint16 (std::string item, uint16_t value)
 TEST_F (JointCommandFingerTest, Constructor)
 TEST_F (JointCommandFingerTest, updateMeasuredState)
 TEST_F (JointCommandFingerTest, getSimpleMeasuredState)
 TEST_F (JointCommandFingerTest, getCompleteMeasuredState)
 TEST_F (JointCommandFingerTest, setCommand)
 TEST_F (JointCommandFingerTest, getCapability)
void tubeTare (std::string mechanism, JointCommandInterface::IoFunctions &io)

Variables

CoeffMapPtr brainstemCoeffMap
RobotInstancePtr instance
CoeffMapPtr motorCoeffMap
std::map< std::string, int16_t > testInt16
std::map< std::string, float > testLiveCoeffs
ParamMap testParamMap
std::map< std::string, uint16_t > testUint16

Function Documentation

std::vector<std::string> getActuatorNames ( std::string  mechanism)

Definition at line 149 of file JointCommandFinger_Test.cpp.

std::vector<std::string> getAllJointNames ( std::string  mechanism)

Definition at line 144 of file JointCommandFinger_Test.cpp.

bool getBoolParam ( std::string  paramName,
bool &  value 
)

Definition at line 94 of file JointCommandFinger_Test.cpp.

float getBrainstemCoeff ( std::string  item)

Definition at line 56 of file JointCommandFinger_Test.cpp.

std::string getCommandFile ( std::string  mechanism)

Definition at line 154 of file JointCommandFinger_Test.cpp.

bool getDoubleParam ( std::string  paramName,
double &  value 
)

Definition at line 106 of file JointCommandFinger_Test.cpp.

float getInt16 ( std::string  item)

Definition at line 22 of file JointCommandFinger_Test.cpp.

bool getIntParam ( std::string  paramName,
int &  value 
)

Definition at line 112 of file JointCommandFinger_Test.cpp.

std::vector<std::string> getJointNames ( std::string  mechanism)

Definition at line 139 of file JointCommandFinger_Test.cpp.

float getLiveCoeff ( std::string  coeff)

Definition at line 71 of file JointCommandFinger_Test.cpp.

float getMotorCoeff ( std::string  item)

Definition at line 61 of file JointCommandFinger_Test.cpp.

bool getStringParam ( std::string  paramName,
std::string &  value 
)

Definition at line 100 of file JointCommandFinger_Test.cpp.

float getUint16 ( std::string  item)

Definition at line 34 of file JointCommandFinger_Test.cpp.

bool hasLiveCoeff ( std::string  coeff)

Definition at line 66 of file JointCommandFinger_Test.cpp.

bool hasParam ( std::string  paramName)

Definition at line 89 of file JointCommandFinger_Test.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 342 of file JointCommandFinger_Test.cpp.

void setBoolParam ( std::string  paramName,
bool  value 
)

Definition at line 118 of file JointCommandFinger_Test.cpp.

void setDoubleParam ( std::string  paramName,
double  value 
)

Definition at line 128 of file JointCommandFinger_Test.cpp.

void setInt16 ( std::string  item,
int16_t  value 
)

Definition at line 46 of file JointCommandFinger_Test.cpp.

void setIntParam ( std::string  paramName,
int  value 
)

Definition at line 133 of file JointCommandFinger_Test.cpp.

void setLiveCoeff ( std::string  coeff,
float  value 
)

Definition at line 84 of file JointCommandFinger_Test.cpp.

void setStringParam ( std::string  paramName,
std::string  value 
)

Definition at line 123 of file JointCommandFinger_Test.cpp.

void setUint16 ( std::string  item,
uint16_t  value 
)

Definition at line 51 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
Constructor   
)

Missing IO function definitions

Definition at line 259 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
updateMeasuredState   
)

Definition at line 267 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
getSimpleMeasuredState   
)

Definition at line 279 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
getCompleteMeasuredState   
)

Definition at line 294 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
setCommand   
)

Definition at line 307 of file JointCommandFinger_Test.cpp.

TEST_F ( JointCommandFingerTest  ,
getCapability   
)

Definition at line 327 of file JointCommandFinger_Test.cpp.

void tubeTare ( std::string  mechanism,
JointCommandInterface::IoFunctions io 
)

Definition at line 159 of file JointCommandFinger_Test.cpp.


Variable Documentation

CoeffMapPtr brainstemCoeffMap

Definition at line 18 of file JointCommandFinger_Test.cpp.

RobotInstancePtr instance

Definition at line 19 of file JointCommandFinger_Test.cpp.

CoeffMapPtr motorCoeffMap

Definition at line 17 of file JointCommandFinger_Test.cpp.

std::map<std::string, int16_t> testInt16

Definition at line 13 of file JointCommandFinger_Test.cpp.

std::map<std::string, float> testLiveCoeffs

Definition at line 15 of file JointCommandFinger_Test.cpp.

ParamMap testParamMap

Definition at line 16 of file JointCommandFinger_Test.cpp.

std::map<std::string, uint16_t> testUint16

Definition at line 14 of file JointCommandFinger_Test.cpp.



robodyn_mechanisms
Author(s):
autogenerated on Thu Jun 6 2019 21:22:49