24 #ifndef HUMANOID_LOCALIZATION_HUMANOID_LOCALIZATION_DEFS_H_ 25 #define HUMANOID_LOCALIZATION_HUMANOID_LOCALIZATION_DEFS_H_ 28 #include <boost/random/variate_generator.hpp> 29 #include <boost/random/mersenne_twister.hpp> 30 #include <boost/random/normal_distribution.hpp> 31 #include <boost/random/uniform_real.hpp> 35 #include <eigen3/Eigen/Core> 38 #include <pcl/point_types.h>
boost::uniform_real UniformDistributionT
boost::variate_generator< EngineT &, NormalDistributionT > NormalGeneratorT
standard normal-distributed noise
boost::mt19937 EngineT
Boost RNG engine:
Particle consists of a pose and a weight.
boost::normal_distribution NormalDistributionT
Boost RNG distribution:
Eigen::Matrix< double, 6, 6 > Matrix6d
boost::variate_generator< EngineT &, UniformDistributionT > UniformGeneratorT
uniform noise in range [0,1)
Eigen::Matrix< double, 6, 1 > Vector6d
Eigen::Matrix< float, 6, 6 > Matrix6f
Eigen::Matrix< float, 6, 1 > Vector6f
std::vector< Particle > Particles
pcl::PointCloud< pcl::PointXYZ > PointCloud