MapModel.h
Go to the documentation of this file.
00001 // SVN $HeadURL$
00002 // SVN $Id$
00003 
00004 /*
00005  * 6D localization for humanoid robots
00006  *
00007  * Copyright 2009-2012 Armin Hornung, University of Freiburg
00008  * http://www.ros.org/wiki/humanoid_localization
00009  *
00010  *
00011  * This program is free software: you can redistribute it and/or modify
00012  * it under the terms of the GNU General Public License as published by
00013  * the Free Software Foundation, version 3.
00014  *
00015  * This program is distributed in the hope that it will be useful,
00016  * but WITHOUT ANY WARRANTY; without even the implied warranty of
00017  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.  See the
00018  * GNU General Public License for more details.
00019  *
00020  * You should have received a copy of the GNU General Public License
00021  * along with this program.  If not, see <http://www.gnu.org/licenses/>.
00022  */
00023 
00024 #ifndef HUMANOID_LOCALIZATION_MAPMODEL_H_
00025 #define HUMANOID_LOCALIZATION_MAPMODEL_H_
00026 
00027 #include <omp.h>
00028 #include <ros/ros.h>
00029 #include <octomap_msgs/conversions.h>
00030 #include <octomap_msgs/GetOctomap.h>
00031 #include <octomap_ros/conversions.h>
00032 
00033 #include <humanoid_localization/humanoid_localization_defs.h>
00034 
00035 namespace humanoid_localization{
00036 
00037 class MapModel{
00038 public:
00039   MapModel(ros::NodeHandle* nh);
00040   virtual ~MapModel();
00041 
00042   //void setMap(boost::shared_ptr<octomap::OcTree> map);
00043   boost::shared_ptr<octomap::OcTree> getMap() const;
00044 
00050   virtual void verifyPoses(Particles& particles);
00051 
00052   virtual void initGlobal(Particles& particles,
00053                           double z, double roll, double pitch,
00054                           const Vector6d& initNoise,
00055                           UniformGeneratorT& rngUniform, NormalGeneratorT& rngNormal);
00056 
00059   virtual bool isOccupied(const octomap::point3d& position) const;
00060   virtual bool isOccupied(octomap::OcTreeNode* node) const = 0;
00061   virtual double getFloorHeight(const tf::Transform& pose) const = 0;
00062 
00071   void getHeightlist(double x, double y, double totalHeight, std::vector<double>& heights);
00072 
00073 
00074 protected:
00075   boost::shared_ptr<octomap::OcTree> m_map;
00076 
00077   double m_motionMeanZ;
00078   double m_motionRangeZ;
00079   double m_motionRangeRoll;
00080   double m_motionRangePitch;
00081   double m_motionObstacleDist;
00082 
00083 };
00084 
00085 
00086 class DistanceMap : public MapModel{
00087 public:
00088   DistanceMap(ros::NodeHandle* nh);
00089   virtual ~DistanceMap();
00090 
00091   virtual bool isOccupied(octomap::OcTreeNode* node) const;
00092   virtual double getFloorHeight(const tf::Transform& pose) const;
00093 
00094 };
00095 
00096 
00097 class OccupancyMap : public MapModel{
00098 public:
00099   OccupancyMap(ros::NodeHandle* nh);
00100   virtual ~OccupancyMap();
00101 
00102   virtual bool isOccupied(octomap::OcTreeNode* node) const;
00103   virtual double getFloorHeight(const tf::Transform& pose) const;
00104 };
00105 
00106 }
00107 #endif


humanoid_localization
Author(s): Armin Hornung, Stefan Osswald, Daniel Maier
autogenerated on Sat Jun 8 2019 20:21:10