Classes | Functions | Variables
JointCommandFactory_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/JointCommandFactory.h"
#include <ros/package.h>
Include dependency graph for JointCommandFactory_Test.cpp:

Go to the source code of this file.

Classes

class  JointCommandFactoryTest

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 getFloat (std::string item)
float getInt16 (std::string item)
uint32_t getInt32 (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)
uint32_t getUInt32 (std::string item)
bool hasBrainstemCoeff (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 setFloat (std::string item, float 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 (JointCommandFactoryTest, generate)

Variables

CoeffMapPtr brainstemCoeffMap
RobotInstancePtr instance
CoeffMapPtr motorCoeffMap
std::map< std::string, float > testFloats
std::map< std::string, int16_t > testInt16s
std::map< std::string, int32_t > testInt32s
std::map< std::string, float > testLiveCoeffs
ParamMap testParamMap
std::map< std::string, uint16_t > testUInt16s
std::map< std::string, uint32_t > testUInt32s

Function Documentation

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

Definition at line 156 of file JointCommandFactory_Test.cpp.

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

Definition at line 151 of file JointCommandFactory_Test.cpp.

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

Definition at line 102 of file JointCommandFactory_Test.cpp.

float getBrainstemCoeff ( std::string  item)

Definition at line 77 of file JointCommandFactory_Test.cpp.

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

Definition at line 161 of file JointCommandFactory_Test.cpp.

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

Definition at line 114 of file JointCommandFactory_Test.cpp.

float getFloat ( std::string  item)

Definition at line 22 of file JointCommandFactory_Test.cpp.

float getInt16 ( std::string  item)

Definition at line 32 of file JointCommandFactory_Test.cpp.

uint32_t getInt32 ( std::string  item)

Definition at line 47 of file JointCommandFactory_Test.cpp.

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

Definition at line 120 of file JointCommandFactory_Test.cpp.

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

Definition at line 146 of file JointCommandFactory_Test.cpp.

float getLiveCoeff ( std::string  coeff)

Definition at line 87 of file JointCommandFactory_Test.cpp.

float getMotorCoeff ( std::string  item)

Definition at line 62 of file JointCommandFactory_Test.cpp.

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

Definition at line 108 of file JointCommandFactory_Test.cpp.

float getUInt16 ( std::string  item)

Definition at line 37 of file JointCommandFactory_Test.cpp.

uint32_t getUInt32 ( std::string  item)

Definition at line 52 of file JointCommandFactory_Test.cpp.

bool hasBrainstemCoeff ( std::string  item)

Definition at line 67 of file JointCommandFactory_Test.cpp.

bool hasLiveCoeff ( std::string  coeff)

Definition at line 82 of file JointCommandFactory_Test.cpp.

bool hasParam ( std::string  paramName)

Definition at line 97 of file JointCommandFactory_Test.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 236 of file JointCommandFactory_Test.cpp.

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

Definition at line 126 of file JointCommandFactory_Test.cpp.

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

Definition at line 136 of file JointCommandFactory_Test.cpp.

void setFloat ( std::string  item,
float  value 
)

Definition at line 27 of file JointCommandFactory_Test.cpp.

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

Definition at line 57 of file JointCommandFactory_Test.cpp.

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

Definition at line 141 of file JointCommandFactory_Test.cpp.

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

Definition at line 92 of file JointCommandFactory_Test.cpp.

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

Definition at line 131 of file JointCommandFactory_Test.cpp.

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

Definition at line 42 of file JointCommandFactory_Test.cpp.

Definition at line 223 of file JointCommandFactory_Test.cpp.


Variable Documentation

CoeffMapPtr brainstemCoeffMap

Definition at line 19 of file JointCommandFactory_Test.cpp.

RobotInstancePtr instance

Definition at line 20 of file JointCommandFactory_Test.cpp.

CoeffMapPtr motorCoeffMap

Definition at line 18 of file JointCommandFactory_Test.cpp.

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

Definition at line 11 of file JointCommandFactory_Test.cpp.

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

Definition at line 12 of file JointCommandFactory_Test.cpp.

std::map<std::string, int32_t> testInt32s

Definition at line 14 of file JointCommandFactory_Test.cpp.

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

Definition at line 16 of file JointCommandFactory_Test.cpp.

ParamMap testParamMap

Definition at line 17 of file JointCommandFactory_Test.cpp.

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

Definition at line 13 of file JointCommandFactory_Test.cpp.

std::map<std::string, uint32_t> testUInt32s

Definition at line 15 of file JointCommandFactory_Test.cpp.



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