Public Types | Public Member Functions | Private Member Functions | Private Attributes | List of all members
dynamic_reconfigure::Server< ConfigType > Class Template Reference

#include <server.h>

Public Types

typedef std::function< void(ConfigType &, uint32_t level)> CallbackType
 

Public Member Functions

void clearCallback ()
 
void getConfigDefault (ConfigType &config)
 
void getConfigMax (ConfigType &config)
 
void getConfigMin (ConfigType &config)
 
 Server (boost::recursive_mutex &mutex, const ros::NodeHandle &nh=ros::NodeHandle("~"))
 
 Server (const ros::NodeHandle &nh=ros::NodeHandle("~"))
 
void setCallback (const CallbackType &callback)
 
void setConfigDefault (const ConfigType &config)
 
void setConfigMax (const ConfigType &config)
 
void setConfigMin (const ConfigType &config)
 
void updateConfig (const ConfigType &config)
 

Private Member Functions

void callCallback (ConfigType &config, int level)
 
void init ()
 
void PublishDescription ()
 
bool setConfigCallback (dynamic_reconfigure::Reconfigure::Request &req, dynamic_reconfigure::Reconfigure::Response &rsp)
 
void updateConfigInternal (const ConfigType &config)
 

Private Attributes

CallbackType callback_
 
ConfigType config_
 
ConfigType default_
 
ros::Publisher descr_pub_
 
ConfigType max_
 
ConfigType min_
 
boost::recursive_mutex & mutex_
 
ros::NodeHandle node_handle_
 
boost::recursive_mutex own_mutex_
 
bool own_mutex_warn_
 
ros::ServiceServer set_service_
 
ros::Publisher update_pub_
 

Detailed Description

template<class ConfigType>
class dynamic_reconfigure::Server< ConfigType >

Keeps track of the reconfigure callback function.

Definition at line 65 of file server.h.

Member Typedef Documentation

◆ CallbackType

template<class ConfigType >
typedef std::function<void(ConfigType &, uint32_t level)> dynamic_reconfigure::Server< ConfigType >::CallbackType

Definition at line 84 of file server.h.

Constructor & Destructor Documentation

◆ Server() [1/2]

template<class ConfigType >
dynamic_reconfigure::Server< ConfigType >::Server ( const ros::NodeHandle nh = ros::NodeHandle("~"))
inline

Definition at line 68 of file server.h.

◆ Server() [2/2]

template<class ConfigType >
dynamic_reconfigure::Server< ConfigType >::Server ( boost::recursive_mutex &  mutex,
const ros::NodeHandle nh = ros::NodeHandle("~") 
)
inline

Definition at line 76 of file server.h.

Member Function Documentation

◆ callCallback()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::callCallback ( ConfigType &  config,
int  level 
)
inlineprivate
Todo:
kill this line.

Definition at line 196 of file server.h.

◆ clearCallback()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::clearCallback ( )
inline

Definition at line 94 of file server.h.

◆ getConfigDefault()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::getConfigDefault ( ConfigType &  config)
inline

Definition at line 121 of file server.h.

◆ getConfigMax()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::getConfigMax ( ConfigType &  config)
inline

Definition at line 111 of file server.h.

◆ getConfigMin()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::getConfigMin ( ConfigType &  config)
inline

Definition at line 116 of file server.h.

◆ init()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::init ( )
inlineprivate

Definition at line 175 of file server.h.

◆ PublishDescription()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::PublishDescription ( )
inlineprivate

Definition at line 161 of file server.h.

◆ setCallback()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::setCallback ( const CallbackType callback)
inline

Definition at line 86 of file server.h.

◆ setConfigCallback()

template<class ConfigType >
bool dynamic_reconfigure::Server< ConfigType >::setConfigCallback ( dynamic_reconfigure::Reconfigure::Request req,
dynamic_reconfigure::Reconfigure::Response rsp 
)
inlineprivate

Definition at line 214 of file server.h.

◆ setConfigDefault()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::setConfigDefault ( const ConfigType &  config)
inline

Definition at line 138 of file server.h.

◆ setConfigMax()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::setConfigMax ( const ConfigType &  config)
inline

Definition at line 126 of file server.h.

◆ setConfigMin()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::setConfigMin ( const ConfigType &  config)
inline

Definition at line 132 of file server.h.

◆ updateConfig()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::updateConfig ( const ConfigType &  config)
inline

Definition at line 100 of file server.h.

◆ updateConfigInternal()

template<class ConfigType >
void dynamic_reconfigure::Server< ConfigType >::updateConfigInternal ( const ConfigType &  config)
inlineprivate

Definition at line 231 of file server.h.

Member Data Documentation

◆ callback_

template<class ConfigType >
CallbackType dynamic_reconfigure::Server< ConfigType >::callback_
private

Definition at line 150 of file server.h.

◆ config_

template<class ConfigType >
ConfigType dynamic_reconfigure::Server< ConfigType >::config_
private

Definition at line 151 of file server.h.

◆ default_

template<class ConfigType >
ConfigType dynamic_reconfigure::Server< ConfigType >::default_
private

Definition at line 154 of file server.h.

◆ descr_pub_

template<class ConfigType >
ros::Publisher dynamic_reconfigure::Server< ConfigType >::descr_pub_
private

Definition at line 149 of file server.h.

◆ max_

template<class ConfigType >
ConfigType dynamic_reconfigure::Server< ConfigType >::max_
private

Definition at line 153 of file server.h.

◆ min_

template<class ConfigType >
ConfigType dynamic_reconfigure::Server< ConfigType >::min_
private

Definition at line 152 of file server.h.

◆ mutex_

template<class ConfigType >
boost::recursive_mutex& dynamic_reconfigure::Server< ConfigType >::mutex_
private

Definition at line 155 of file server.h.

◆ node_handle_

template<class ConfigType >
ros::NodeHandle dynamic_reconfigure::Server< ConfigType >::node_handle_
private

Definition at line 146 of file server.h.

◆ own_mutex_

template<class ConfigType >
boost::recursive_mutex dynamic_reconfigure::Server< ConfigType >::own_mutex_
private

Definition at line 156 of file server.h.

◆ own_mutex_warn_

template<class ConfigType >
bool dynamic_reconfigure::Server< ConfigType >::own_mutex_warn_
private

Definition at line 157 of file server.h.

◆ set_service_

template<class ConfigType >
ros::ServiceServer dynamic_reconfigure::Server< ConfigType >::set_service_
private

Definition at line 147 of file server.h.

◆ update_pub_

template<class ConfigType >
ros::Publisher dynamic_reconfigure::Server< ConfigType >::update_pub_
private

Definition at line 148 of file server.h.


The documentation for this class was generated from the following file:


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:15