#include <RectifyConfig.h>

Public Member Functions | |
| virtual void | calcLevel (uint32_t &comb_level, const RectifyConfig &config1, const RectifyConfig &config2) const |
| template<> | |
| void | clamp (RectifyConfig &config, const RectifyConfig &max, const RectifyConfig &min) const |
| virtual void | clamp (RectifyConfig &config, const RectifyConfig &max, const RectifyConfig &min) const |
| virtual bool | fromMessage (const dynamic_reconfigure::Config &msg, RectifyConfig &config) const |
| virtual void | fromServer (const ros::NodeHandle &nh, RectifyConfig &config) const |
| ParamDescription (std::string name, std::string type, uint32_t level, std::string description, std::string edit_method, T RectifyConfig::*f) | |
| virtual void | toMessage (dynamic_reconfigure::Config &msg, const RectifyConfig &config) const |
| virtual void | toServer (const ros::NodeHandle &nh, const RectifyConfig &config) const |
Public Attributes | |
| TRectifyConfig::* | field |
Definition at line 89 of file RectifyConfig.h.
| image_proc::RectifyConfig::ParamDescription< T >::ParamDescription | ( | std::string | name, | |
| std::string | type, | |||
| uint32_t | level, | |||
| std::string | description, | |||
| std::string | edit_method, | |||
| T RectifyConfig::* | f | |||
| ) | [inline] |
Definition at line 92 of file RectifyConfig.h.
| virtual void image_proc::RectifyConfig::ParamDescription< T >::calcLevel | ( | uint32_t & | comb_level, | |
| const RectifyConfig & | config1, | |||
| const RectifyConfig & | config2 | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 109 of file RectifyConfig.h.
| void image_proc::RectifyConfig::ParamDescription< std::string >::clamp | ( | RectifyConfig & | config, | |
| const RectifyConfig & | max, | |||
| const RectifyConfig & | min | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 227 of file RectifyConfig.h.
| virtual void image_proc::RectifyConfig::ParamDescription< T >::clamp | ( | RectifyConfig & | config, | |
| const RectifyConfig & | max, | |||
| const RectifyConfig & | min | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 100 of file RectifyConfig.h.
| virtual bool image_proc::RectifyConfig::ParamDescription< T >::fromMessage | ( | const dynamic_reconfigure::Config & | msg, | |
| RectifyConfig & | config | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 125 of file RectifyConfig.h.
| virtual void image_proc::RectifyConfig::ParamDescription< T >::fromServer | ( | const ros::NodeHandle & | nh, | |
| RectifyConfig & | config | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 115 of file RectifyConfig.h.
| virtual void image_proc::RectifyConfig::ParamDescription< T >::toMessage | ( | dynamic_reconfigure::Config & | msg, | |
| const RectifyConfig & | config | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 130 of file RectifyConfig.h.
| virtual void image_proc::RectifyConfig::ParamDescription< T >::toServer | ( | const ros::NodeHandle & | nh, | |
| const RectifyConfig & | config | |||
| ) | const [inline, virtual] |
Implements image_proc::RectifyConfig::AbstractParamDescription.
Definition at line 120 of file RectifyConfig.h.
| TRectifyConfig::* image_proc::RectifyConfig::ParamDescription< T >::field |
Definition at line 98 of file RectifyConfig.h.