Public Member Functions | |
void | initialize () |
void | reset () |
Values () | |
Public Attributes | |
RTT::PropertyBag | bag_ |
bool | bool_ |
char | char_ |
double | double_ |
Eigen::VectorXd | eigenvector_double_ |
Eigen::VectorXf | eigenvector_float_ |
float | float_ |
int | int_ |
std::string | string_ |
unsigned char | uchar_ |
unsigned int | uint_ |
std::vector< bool > | v_bool_ |
std::vector< char > | v_char_ |
std::vector< double > | v_double_ |
std::vector< float > | v_float_ |
std::vector< int > | v_int_ |
std::vector< std::string > | v_string_ |
std::vector< unsigned char > | v_uchar_ |
std::vector< unsigned int > | v_uint_ |
geometry_msgs::Vector3 | vector3_ |
Definition at line 105 of file param_tests.cpp.
|
inline |
Definition at line 133 of file param_tests.cpp.
|
inline |
Definition at line 137 of file param_tests.cpp.
|
inline |
Definition at line 171 of file param_tests.cpp.
RTT::PropertyBag ParamTest::Values::bag_ |
Definition at line 130 of file param_tests.cpp.
bool ParamTest::Values::bool_ |
Definition at line 114 of file param_tests.cpp.
char ParamTest::Values::char_ |
Definition at line 112 of file param_tests.cpp.
double ParamTest::Values::double_ |
Definition at line 108 of file param_tests.cpp.
Eigen::VectorXd ParamTest::Values::eigenvector_double_ |
Definition at line 126 of file param_tests.cpp.
Eigen::VectorXf ParamTest::Values::eigenvector_float_ |
Definition at line 127 of file param_tests.cpp.
float ParamTest::Values::float_ |
Definition at line 109 of file param_tests.cpp.
int ParamTest::Values::int_ |
Definition at line 110 of file param_tests.cpp.
std::string ParamTest::Values::string_ |
Definition at line 107 of file param_tests.cpp.
unsigned char ParamTest::Values::uchar_ |
Definition at line 113 of file param_tests.cpp.
unsigned int ParamTest::Values::uint_ |
Definition at line 111 of file param_tests.cpp.
std::vector<bool> ParamTest::Values::v_bool_ |
Definition at line 124 of file param_tests.cpp.
std::vector<char> ParamTest::Values::v_char_ |
Definition at line 122 of file param_tests.cpp.
std::vector<double> ParamTest::Values::v_double_ |
Definition at line 118 of file param_tests.cpp.
std::vector<float> ParamTest::Values::v_float_ |
Definition at line 119 of file param_tests.cpp.
std::vector<int> ParamTest::Values::v_int_ |
Definition at line 120 of file param_tests.cpp.
std::vector<std::string> ParamTest::Values::v_string_ |
Definition at line 117 of file param_tests.cpp.
std::vector<unsigned char> ParamTest::Values::v_uchar_ |
Definition at line 123 of file param_tests.cpp.
std::vector<unsigned int> ParamTest::Values::v_uint_ |
Definition at line 121 of file param_tests.cpp.
geometry_msgs::Vector3 ParamTest::Values::vector3_ |
Definition at line 131 of file param_tests.cpp.