#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 41 of file test_component.hpp.
|
inline |
Definition at line 42 of file test_component.hpp.
| RTT::PropertyBag Properties::bag_param |
Definition at line 64 of file test_component.hpp.
| bool Properties::bool_param |
Definition at line 57 of file test_component.hpp.
| double Properties::double_param |
Definition at line 55 of file test_component.hpp.
| float Properties::float_param |
Definition at line 60 of file test_component.hpp.
| int Properties::int_param |
Definition at line 54 of file test_component.hpp.
| std::string Properties::str_param |
Definition at line 56 of file test_component.hpp.
| std::string Properties::str_param_in_bag |
Definition at line 65 of file test_component.hpp.
| unsigned int Properties::uint_param |
Definition at line 61 of file test_component.hpp.
| geometry_msgs::Vector3 Properties::vector3_param |
Definition at line 68 of file test_component.hpp.