#include <limits>#include <cmath>#include <omp.h>#include <ros/ros.h>#include <tf/transform_datatypes.h>#include <pcl_ros/transforms.h>#include <humanoid_localization/humanoid_localization_defs.h>#include <humanoid_localization/MapModel.h>#include <octomap/octomap.h>#include <sensor_msgs/PointCloud2.h>

Go to the source code of this file.
Classes | |
| class | humanoid_localization::ObservationModel |
Namespaces | |
| namespace | humanoid_localization |
Variables | |
| static const double | humanoid_localization::LOG_SQRT_2_PI = 0.91893853320467274178 |
| log(sqrt(2*pi)) | |
| static const double | humanoid_localization::SQRT_2_PI = 2.506628274 |
| sqrt(2*pi) | |