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