#include <test_component.hpp>
Public Member Functions | |
Properties () | |
Public Attributes | |
RTT::PropertyBag | bag_param |
bool | bool_param |
double | double_param |
float | float_param |
int | int_param |
std::string | str_param |
std::string | str_param_in_bag |
unsigned int | uint_param |
geometry_msgs::Vector3 | vector3_param |
Definition at line 19 of file test_component.hpp.
|
inline |
Definition at line 20 of file test_component.hpp.
RTT::PropertyBag Properties::bag_param |
Definition at line 42 of file test_component.hpp.
bool Properties::bool_param |
Definition at line 35 of file test_component.hpp.
double Properties::double_param |
Definition at line 33 of file test_component.hpp.
float Properties::float_param |
Definition at line 38 of file test_component.hpp.
int Properties::int_param |
Definition at line 32 of file test_component.hpp.
std::string Properties::str_param |
Definition at line 34 of file test_component.hpp.
std::string Properties::str_param_in_bag |
Definition at line 43 of file test_component.hpp.
unsigned int Properties::uint_param |
Definition at line 39 of file test_component.hpp.
geometry_msgs::Vector3 Properties::vector3_param |
Definition at line 46 of file test_component.hpp.