#include <OpenNIConfig.h>
Public Member Functions | |
| virtual void | calcLevel (uint32_t &comb_level, const OpenNIConfig &config1, const OpenNIConfig &config2) const |
| template<> | |
| void | clamp (OpenNIConfig &config, const OpenNIConfig &max, const OpenNIConfig &min) const |
| virtual void | clamp (OpenNIConfig &config, const OpenNIConfig &max, const OpenNIConfig &min) const |
| virtual bool | fromMessage (const dynamic_reconfigure::Config &msg, OpenNIConfig &config) const |
| virtual void | fromServer (const ros::NodeHandle &nh, OpenNIConfig &config) const |
| ParamDescription (std::string name, std::string type, uint32_t level, std::string description, std::string edit_method, T OpenNIConfig::*f) | |
| virtual void | toMessage (dynamic_reconfigure::Config &msg, const OpenNIConfig &config) const |
| virtual void | toServer (const ros::NodeHandle &nh, const OpenNIConfig &config) const |
Public Attributes | |
| TOpenNIConfig::* | field |
Definition at line 87 of file OpenNIConfig.h.
| openni_camera_unstable::OpenNIConfig::ParamDescription< T >::ParamDescription | ( | std::string | name, | |
| std::string | type, | |||
| uint32_t | level, | |||
| std::string | description, | |||
| std::string | edit_method, | |||
| T OpenNIConfig::* | f | |||
| ) | [inline] |
Definition at line 90 of file OpenNIConfig.h.
| virtual void openni_camera_unstable::OpenNIConfig::ParamDescription< T >::calcLevel | ( | uint32_t & | comb_level, | |
| const OpenNIConfig & | config1, | |||
| const OpenNIConfig & | config2 | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 107 of file OpenNIConfig.h.
| void openni_camera_unstable::OpenNIConfig::ParamDescription< std::string >::clamp | ( | OpenNIConfig & | config, | |
| const OpenNIConfig & | max, | |||
| const OpenNIConfig & | min | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 235 of file OpenNIConfig.h.
| virtual void openni_camera_unstable::OpenNIConfig::ParamDescription< T >::clamp | ( | OpenNIConfig & | config, | |
| const OpenNIConfig & | max, | |||
| const OpenNIConfig & | min | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 98 of file OpenNIConfig.h.
| virtual bool openni_camera_unstable::OpenNIConfig::ParamDescription< T >::fromMessage | ( | const dynamic_reconfigure::Config & | msg, | |
| OpenNIConfig & | config | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 123 of file OpenNIConfig.h.
| virtual void openni_camera_unstable::OpenNIConfig::ParamDescription< T >::fromServer | ( | const ros::NodeHandle & | nh, | |
| OpenNIConfig & | config | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 113 of file OpenNIConfig.h.
| virtual void openni_camera_unstable::OpenNIConfig::ParamDescription< T >::toMessage | ( | dynamic_reconfigure::Config & | msg, | |
| const OpenNIConfig & | config | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 128 of file OpenNIConfig.h.
| virtual void openni_camera_unstable::OpenNIConfig::ParamDescription< T >::toServer | ( | const ros::NodeHandle & | nh, | |
| const OpenNIConfig & | config | |||
| ) | const [inline, virtual] |
Implements openni_camera_unstable::OpenNIConfig::AbstractParamDescription.
Definition at line 118 of file OpenNIConfig.h.
| TOpenNIConfig::* openni_camera_unstable::OpenNIConfig::ParamDescription< T >::field |
Definition at line 96 of file OpenNIConfig.h.