EndpointModel.h
Go to the documentation of this file.
1 // SVN $HeadURL$
2 // SVN $Id$
3 
4 /*
5  * 6D localization for humanoid robots
6  *
7  * Copyright 2009-2012 Armin Hornung, University of Freiburg
8  * http://www.ros.org/wiki/humanoid_localization
9  *
10  *
11  * This program is free software: you can redistribute it and/or modify
12  * it under the terms of the GNU General Public License as published by
13  * the Free Software Foundation, version 3.
14  *
15  * This program is distributed in the hope that it will be useful,
16  * but WITHOUT ANY WARRANTY; without even the implied warranty of
17  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
18  * GNU General Public License for more details.
19  *
20  * You should have received a copy of the GNU General Public License
21  * along with this program. If not, see <http://www.gnu.org/licenses/>.
22  */
23 
24 #ifndef HUMANOID_LOCALIZATION_ENDPOINTMODEL_H_
25 #define HUMANOID_LOCALIZATION_ENDPOINTMODEL_H_
26 
27 #include <limits>
28 #include <cmath>
29 
30 #include <omp.h>
31 
32 #include <ros/ros.h>
33 #include <tf/transform_datatypes.h>
34 
36 #include <octomap/octomap.h>
38 #include <visualization_msgs/Marker.h>
39 
40 
43 public:
45  virtual ~EndpointModel();
46  virtual void integrateMeasurement(Particles& particles, const PointCloud& pc, const std::vector<float>& ranges, float max_range, const tf::Transform& baseToSensor);
47 
49 
50 protected:
51  bool getHeightError(const Particle& p, const tf::StampedTransform& footprintToBase, double& heightError) const;
52  void initDistanceMap();
53  double m_sigma;
56 };
57 
58 }
59 
60 #endif
bool getHeightError(const Particle &p, const tf::StampedTransform &footprintToBase, double &heightError) const
boost::mt19937 EngineT
Boost RNG engine:
Particle consists of a pose and a weight.
virtual void setMap(boost::shared_ptr< octomap::OcTree > map)
EndpointModel(ros::NodeHandle *nh, boost::shared_ptr< MapModel > mapModel, EngineT *rngEngine)
std::vector< Particle > Particles
boost::shared_ptr< DynamicEDTOctomap > m_distanceMap
Definition: EndpointModel.h:55
pcl::PointCloud< pcl::PointXYZ > PointCloud
virtual void integrateMeasurement(Particles &particles, const PointCloud &pc, const std::vector< float > &ranges, float max_range, const tf::Transform &baseToSensor)


humanoid_localization
Author(s): Armin Hornung, Stefan Osswald, Daniel Maier
autogenerated on Mon Jun 10 2019 13:38:31