#include <WGE100CameraConfig.h>

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