ar_poseConfig.h
Go to the documentation of this file.
00001 //#line 2 "/opt/ros/electric/stacks/driver_common/dynamic_reconfigure/templates/ConfigType.h"
00002 // *********************************************************
00003 // 
00004 // File autogenerated for the ar_pose package 
00005 // by the dynamic_reconfigure package.
00006 // Please do not edit.
00007 // 
00008 // ********************************************************/
00009 
00010 /***********************************************************
00011  * Software License Agreement (BSD License)
00012  *
00013  *  Copyright (c) 2008, Willow Garage, Inc.
00014  *  All rights reserved.
00015  *
00016  *  Redistribution and use in source and binary forms, with or without
00017  *  modification, are permitted provided that the following conditions
00018  *  are met:
00019  *
00020  *   * Redistributions of source code must retain the above copyright
00021  *     notice, this list of conditions and the following disclaimer.
00022  *   * Redistributions in binary form must reproduce the above
00023  *     copyright notice, this list of conditions and the following
00024  *     disclaimer in the documentation and/or other materials provided
00025  *     with the distribution.
00026  *   * Neither the name of the Willow Garage nor the names of its
00027  *     contributors may be used to endorse or promote products derived
00028  *     from this software without specific prior written permission.
00029  *
00030  *  THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
00031  *  "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
00032  *  LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
00033  *  FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
00034  *  COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
00035  *  INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
00036  *  BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
00037  *  LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
00038  *  CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
00039  *  LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
00040  *  ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
00041  *  POSSIBILITY OF SUCH DAMAGE.
00042  ***********************************************************/
00043 
00044 // Author: Blaise Gassend
00045 
00046 
00047 #ifndef __ar_pose__AR_POSECONFIG_H__
00048 #define __ar_pose__AR_POSECONFIG_H__
00049 
00050 #include <dynamic_reconfigure/config_tools.h>
00051 #include <limits>
00052 #include <ros/node_handle.h>
00053 #include <dynamic_reconfigure/ConfigDescription.h>
00054 #include <dynamic_reconfigure/ParamDescription.h>
00055 #include <dynamic_reconfigure/config_init_mutex.h>
00056 
00057 namespace ar_pose
00058 {
00059   class ar_poseConfigStatics;
00060   
00061   class ar_poseConfig
00062   {
00063   public:
00064     class AbstractParamDescription : public dynamic_reconfigure::ParamDescription
00065     {
00066     public:
00067       AbstractParamDescription(std::string n, std::string t, uint32_t l, 
00068           std::string d, std::string e)
00069       {
00070         name = n;
00071         type = t;
00072         level = l;
00073         description = d;
00074         edit_method = e;
00075       }
00076       
00077       virtual void clamp(ar_poseConfig &config, const ar_poseConfig &max, const ar_poseConfig &min) const = 0;
00078       virtual void calcLevel(uint32_t &level, const ar_poseConfig &config1, const ar_poseConfig &config2) const = 0;
00079       virtual void fromServer(const ros::NodeHandle &nh, ar_poseConfig &config) const = 0;
00080       virtual void toServer(const ros::NodeHandle &nh, const ar_poseConfig &config) const = 0;
00081       virtual bool fromMessage(const dynamic_reconfigure::Config &msg, ar_poseConfig &config) const = 0;
00082       virtual void toMessage(dynamic_reconfigure::Config &msg, const ar_poseConfig &config) const = 0;
00083     };
00084 
00085     typedef boost::shared_ptr<AbstractParamDescription> AbstractParamDescriptionPtr;
00086     typedef boost::shared_ptr<const AbstractParamDescription> AbstractParamDescriptionConstPtr;
00087     
00088     template <class T>
00089     class ParamDescription : public AbstractParamDescription
00090     {
00091     public:
00092       ParamDescription(std::string name, std::string type, uint32_t level, 
00093           std::string description, std::string edit_method, T ar_poseConfig::* f) :
00094         AbstractParamDescription(name, type, level, description, edit_method),
00095         field(f)
00096       {}
00097 
00098       T (ar_poseConfig::* field);
00099 
00100       virtual void clamp(ar_poseConfig &config, const ar_poseConfig &max, const ar_poseConfig &min) const
00101       {
00102         if (config.*field > max.*field)
00103           config.*field = max.*field;
00104         
00105         if (config.*field < min.*field)
00106           config.*field = min.*field;
00107       }
00108 
00109       virtual void calcLevel(uint32_t &comb_level, const ar_poseConfig &config1, const ar_poseConfig &config2) const
00110       {
00111         if (config1.*field != config2.*field)
00112           comb_level |= level;
00113       }
00114 
00115       virtual void fromServer(const ros::NodeHandle &nh, ar_poseConfig &config) const
00116       {
00117         nh.getParam(name, config.*field);
00118       }
00119 
00120       virtual void toServer(const ros::NodeHandle &nh, const ar_poseConfig &config) const
00121       {
00122         nh.setParam(name, config.*field);
00123       }
00124 
00125       virtual bool fromMessage(const dynamic_reconfigure::Config &msg, ar_poseConfig &config) const
00126       {
00127         return dynamic_reconfigure::ConfigTools::getParameter(msg, name, config.*field);
00128       }
00129 
00130       virtual void toMessage(dynamic_reconfigure::Config &msg, const ar_poseConfig &config) const
00131       {
00132         dynamic_reconfigure::ConfigTools::appendParameter(msg, name, config.*field);
00133       }
00134     };
00135 
00136 //#line 43 "cfg/ar_pose_config.cfg"
00137       int window_size;
00138 //#line 44 "cfg/ar_pose_config.cfg"
00139       double k;
00140 //#line 45 "cfg/ar_pose_config.cfg"
00141       bool enable_hist;
00142 //#line 46 "cfg/ar_pose_config.cfg"
00143       bool enable_thresholded;
00144 //#line 138 "/opt/ros/electric/stacks/driver_common/dynamic_reconfigure/templates/ConfigType.h"
00145 
00146     bool __fromMessage__(dynamic_reconfigure::Config &msg)
00147     {
00148       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00149       int count = 0;
00150       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00151         if ((*i)->fromMessage(msg, *this))
00152           count++;
00153       if (count != dynamic_reconfigure::ConfigTools::size(msg))
00154       {
00155         ROS_ERROR("ar_poseConfig::__fromMessage__ called with an unexpected parameter.");
00156         ROS_ERROR("Booleans:");
00157         for (unsigned int i = 0; i < msg.bools.size(); i++)
00158           ROS_ERROR("  %s", msg.bools[i].name.c_str());
00159         ROS_ERROR("Integers:");
00160         for (unsigned int i = 0; i < msg.ints.size(); i++)
00161           ROS_ERROR("  %s", msg.ints[i].name.c_str());
00162         ROS_ERROR("Doubles:");
00163         for (unsigned int i = 0; i < msg.doubles.size(); i++)
00164           ROS_ERROR("  %s", msg.doubles[i].name.c_str());
00165         ROS_ERROR("Strings:");
00166         for (unsigned int i = 0; i < msg.strs.size(); i++)
00167           ROS_ERROR("  %s", msg.strs[i].name.c_str());
00168         // @todo Check that there are no duplicates. Make this error more
00169         // explicit.
00170         return false;
00171       }
00172       return true;
00173     }
00174 
00175     // This version of __toMessage__ is used during initialization of
00176     // statics when __getParamDescriptions__ can't be called yet.
00177     void __toMessage__(dynamic_reconfigure::Config &msg, const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__) const
00178     {
00179       dynamic_reconfigure::ConfigTools::clear(msg);
00180       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00181         (*i)->toMessage(msg, *this);
00182     }
00183     
00184     void __toMessage__(dynamic_reconfigure::Config &msg) const
00185     {
00186       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00187       __toMessage__(msg, __param_descriptions__);
00188     }
00189     
00190     void __toServer__(const ros::NodeHandle &nh) const
00191     {
00192       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00193       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00194         (*i)->toServer(nh, *this);
00195     }
00196 
00197     void __fromServer__(const ros::NodeHandle &nh)
00198     {
00199       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00200       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00201         (*i)->fromServer(nh, *this);
00202     }
00203 
00204     void __clamp__()
00205     {
00206       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00207       const ar_poseConfig &__max__ = __getMax__();
00208       const ar_poseConfig &__min__ = __getMin__();
00209       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00210         (*i)->clamp(*this, __max__, __min__);
00211     }
00212 
00213     uint32_t __level__(const ar_poseConfig &config) const
00214     {
00215       const std::vector<AbstractParamDescriptionConstPtr> &__param_descriptions__ = __getParamDescriptions__();
00216       uint32_t level = 0;
00217       for (std::vector<AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00218         (*i)->calcLevel(level, config, *this);
00219       return level;
00220     }
00221     
00222     static const dynamic_reconfigure::ConfigDescription &__getDescriptionMessage__();
00223     static const ar_poseConfig &__getDefault__();
00224     static const ar_poseConfig &__getMax__();
00225     static const ar_poseConfig &__getMin__();
00226     static const std::vector<AbstractParamDescriptionConstPtr> &__getParamDescriptions__();
00227     
00228   private:
00229     static const ar_poseConfigStatics *__get_statics__();
00230   };
00231   
00232   template <> // Max and min are ignored for strings.
00233   inline void ar_poseConfig::ParamDescription<std::string>::clamp(ar_poseConfig &config, const ar_poseConfig &max, const ar_poseConfig &min) const
00234   {
00235     return;
00236   }
00237 
00238   class ar_poseConfigStatics
00239   {
00240     friend class ar_poseConfig;
00241     
00242     ar_poseConfigStatics()
00243     {
00244 //#line 43 "cfg/ar_pose_config.cfg"
00245       __min__.window_size = 5;
00246 //#line 43 "cfg/ar_pose_config.cfg"
00247       __max__.window_size = 500;
00248 //#line 43 "cfg/ar_pose_config.cfg"
00249       __default__.window_size = 50;
00250 //#line 43 "cfg/ar_pose_config.cfg"
00251       __param_descriptions__.push_back(ar_poseConfig::AbstractParamDescriptionConstPtr(new ar_poseConfig::ParamDescription<int>("window_size", "int", 0, "Local threshold windo size", "", &ar_poseConfig::window_size)));
00252 //#line 44 "cfg/ar_pose_config.cfg"
00253       __min__.k = 0.0;
00254 //#line 44 "cfg/ar_pose_config.cfg"
00255       __max__.k = 0.1;
00256 //#line 44 "cfg/ar_pose_config.cfg"
00257       __default__.k = 0.06;
00258 //#line 44 "cfg/ar_pose_config.cfg"
00259       __param_descriptions__.push_back(ar_poseConfig::AbstractParamDescriptionConstPtr(new ar_poseConfig::ParamDescription<double>("k", "double", 0, "Multiplicative constant for local deviation", "", &ar_poseConfig::k)));
00260 //#line 45 "cfg/ar_pose_config.cfg"
00261       __min__.enable_hist = 0;
00262 //#line 45 "cfg/ar_pose_config.cfg"
00263       __max__.enable_hist = 1;
00264 //#line 45 "cfg/ar_pose_config.cfg"
00265       __default__.enable_hist = 0;
00266 //#line 45 "cfg/ar_pose_config.cfg"
00267       __param_descriptions__.push_back(ar_poseConfig::AbstractParamDescriptionConstPtr(new ar_poseConfig::ParamDescription<bool>("enable_hist", "bool", 0, "Enable histogram publication", "", &ar_poseConfig::enable_hist)));
00268 //#line 46 "cfg/ar_pose_config.cfg"
00269       __min__.enable_thresholded = 0;
00270 //#line 46 "cfg/ar_pose_config.cfg"
00271       __max__.enable_thresholded = 1;
00272 //#line 46 "cfg/ar_pose_config.cfg"
00273       __default__.enable_thresholded = 0;
00274 //#line 46 "cfg/ar_pose_config.cfg"
00275       __param_descriptions__.push_back(ar_poseConfig::AbstractParamDescriptionConstPtr(new ar_poseConfig::ParamDescription<bool>("enable_thresholded", "bool", 0, "Enable binarizaed image publication", "", &ar_poseConfig::enable_thresholded)));
00276 //#line 239 "/opt/ros/electric/stacks/driver_common/dynamic_reconfigure/templates/ConfigType.h"
00277     
00278       for (std::vector<ar_poseConfig::AbstractParamDescriptionConstPtr>::const_iterator i = __param_descriptions__.begin(); i != __param_descriptions__.end(); i++)
00279         __description_message__.parameters.push_back(**i);
00280       __max__.__toMessage__(__description_message__.max, __param_descriptions__); 
00281       __min__.__toMessage__(__description_message__.min, __param_descriptions__); 
00282       __default__.__toMessage__(__description_message__.dflt, __param_descriptions__); 
00283     }
00284     std::vector<ar_poseConfig::AbstractParamDescriptionConstPtr> __param_descriptions__;
00285     ar_poseConfig __max__;
00286     ar_poseConfig __min__;
00287     ar_poseConfig __default__;
00288     dynamic_reconfigure::ConfigDescription __description_message__;
00289     static const ar_poseConfigStatics *get_instance()
00290     {
00291       // Split this off in a separate function because I know that
00292       // instance will get initialized the first time get_instance is
00293       // called, and I am guaranteeing that get_instance gets called at
00294       // most once.
00295       static ar_poseConfigStatics instance;
00296       return &instance;
00297     }
00298   };
00299 
00300   inline const dynamic_reconfigure::ConfigDescription &ar_poseConfig::__getDescriptionMessage__() 
00301   {
00302     return __get_statics__()->__description_message__;
00303   }
00304 
00305   inline const ar_poseConfig &ar_poseConfig::__getDefault__()
00306   {
00307     return __get_statics__()->__default__;
00308   }
00309   
00310   inline const ar_poseConfig &ar_poseConfig::__getMax__()
00311   {
00312     return __get_statics__()->__max__;
00313   }
00314   
00315   inline const ar_poseConfig &ar_poseConfig::__getMin__()
00316   {
00317     return __get_statics__()->__min__;
00318   }
00319   
00320   inline const std::vector<ar_poseConfig::AbstractParamDescriptionConstPtr> &ar_poseConfig::__getParamDescriptions__()
00321   {
00322     return __get_statics__()->__param_descriptions__;
00323   }
00324 
00325   inline const ar_poseConfigStatics *ar_poseConfig::__get_statics__()
00326   {
00327     const static ar_poseConfigStatics *statics;
00328   
00329     if (statics) // Common case
00330       return statics;
00331 
00332     boost::mutex::scoped_lock lock(dynamic_reconfigure::__init_mutex__);
00333 
00334     if (statics) // In case we lost a race.
00335       return statics;
00336 
00337     statics = ar_poseConfigStatics::get_instance();
00338     
00339     return statics;
00340   }
00341 
00342 
00343 }
00344 
00345 #endif // __AR_POSERECONFIGURATOR_H__
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends Defines


ar_pose_old
Author(s): Ivan Dryanovski, William Morris, Gautier Dumonteil et al.
autogenerated on Fri Jan 25 2013 12:35:34