Classes | |
| class | DistanceMap | 
| class | EndpointModel | 
| class | HumanoidLocalization | 
| class | MapModel | 
| class | MotionModel | 
| class | ObservationModel | 
| class | OccupancyMap | 
| struct | Particle | 
| Particle consists of a pose and a weight.  More... | |
| class | RaycastingModel | 
Typedefs | |
| typedef boost::mt19937 | EngineT | 
| Boost RNG engine:   | |
| typedef Eigen::Matrix< double, 6, 6 > | Matrix6d | 
| typedef Eigen::Matrix< float, 6, 6 > | Matrix6f | 
| typedef boost::normal_distribution | NormalDistributionT | 
| Boost RNG distribution:   | |
| typedef  boost::variate_generator < EngineT &, NormalDistributionT >  | NormalGeneratorT | 
| standard normal-distributed noise   | |
| typedef std::vector< Particle > | Particles | 
| typedef pcl::PointCloud < pcl::PointXYZ >  | PointCloud | 
| typedef boost::uniform_real | UniformDistributionT | 
| typedef  boost::variate_generator < EngineT &, UniformDistributionT >  | UniformGeneratorT | 
| uniform noise in range [0,1)   | |
| typedef Eigen::Matrix< double, 6, 1 > | Vector6d | 
| typedef Eigen::Matrix< float, 6, 1 > | Vector6f | 
Functions | |
| static void | getRP (const geometry_msgs::Quaternion &msg_q, double &roll, double &pitch) | 
Variables | |
| static const double | LOG_SQRT_2_PI = 0.91893853320467274178 | 
| log(sqrt(2*pi))   | |
| static const double | SQRT_2_PI = 2.506628274 | 
| sqrt(2*pi)   | |
| typedef boost::mt19937 humanoid_localization::EngineT | 
Boost RNG engine:
Definition at line 54 of file humanoid_localization_defs.h.
| typedef Eigen::Matrix<double, 6, 6> humanoid_localization::Matrix6d | 
Definition at line 68 of file humanoid_localization_defs.h.
| typedef Eigen::Matrix<float, 6, 6> humanoid_localization::Matrix6f | 
Definition at line 66 of file humanoid_localization_defs.h.
| typedef boost::normal_distribution humanoid_localization::NormalDistributionT | 
Boost RNG distribution:
Definition at line 56 of file humanoid_localization_defs.h.
| typedef boost::variate_generator<EngineT&, NormalDistributionT> humanoid_localization::NormalGeneratorT | 
standard normal-distributed noise
Definition at line 61 of file humanoid_localization_defs.h.
| typedef std::vector<Particle> humanoid_localization::Particles | 
Definition at line 48 of file humanoid_localization_defs.h.
| typedef pcl::PointCloud<pcl::PointXYZ> humanoid_localization::PointCloud | 
Definition at line 50 of file humanoid_localization_defs.h.
| typedef boost::uniform_real humanoid_localization::UniformDistributionT | 
Definition at line 59 of file humanoid_localization_defs.h.
| typedef boost::variate_generator<EngineT&, UniformDistributionT> humanoid_localization::UniformGeneratorT | 
uniform noise in range [0,1)
Definition at line 63 of file humanoid_localization_defs.h.
| typedef Eigen::Matrix<double, 6, 1> humanoid_localization::Vector6d | 
Definition at line 69 of file humanoid_localization_defs.h.
| typedef Eigen::Matrix<float, 6, 1> humanoid_localization::Vector6f | 
Definition at line 67 of file humanoid_localization_defs.h.
| static void humanoid_localization::getRP | ( | const geometry_msgs::Quaternion & | msg_q, | 
| double & | roll, | ||
| double & | pitch | ||
| ) |  [inline, static] | 
        
Definition at line 72 of file HumanoidLocalization.h.
const double humanoid_localization::LOG_SQRT_2_PI = 0.91893853320467274178 [static] | 
        
log(sqrt(2*pi))
Definition at line 49 of file ObservationModel.h.
const double humanoid_localization::SQRT_2_PI = 2.506628274 [static] | 
        
sqrt(2*pi)
Definition at line 46 of file ObservationModel.h.