lslgeneric::NDTCell Member List
This is the complete list of members for lslgeneric::NDTCell, including all inherited members.
addPoint(pcl::PointXYZ &pt)lslgeneric::NDTCell [inline, virtual]
addPoints(pcl::PointCloud< pcl::PointXYZ > &pt)lslgeneric::NDTCell [inline, virtual]
Blslgeneric::NDTCell [private]
CellClass enum namelslgeneric::NDTCell
center_lslgeneric::NDTCell [private]
cl_lslgeneric::NDTCell [private]
classify()lslgeneric::NDTCell
clone() const lslgeneric::NDTCell [virtual]
computeGaussian(int mode=CELL_UPDATE_MODE_SAMPLE_VARIANCE, unsigned int maxnumpoints=1e9, float occupancy_limit=255, Eigen::Vector3d origin=Eigen::Vector3d(0, 0, 0), double sensor_noise=0.1)lslgeneric::NDTCell
computeGaussianSimple()lslgeneric::NDTCell
computeMaximumLikelihoodAlongLine(const pcl::PointXYZ &p1, const pcl::PointXYZ &p2, Eigen::Vector3d &out)lslgeneric::NDTCell
consistency_scorelslgeneric::NDTCell
copy() const lslgeneric::NDTCell [virtual]
costlslgeneric::NDTCell
cov_lslgeneric::NDTCell [private]
d1_lslgeneric::NDTCell [private]
d2_lslgeneric::NDTCell [private]
edatalslgeneric::NDTCell [private]
emptydistlslgeneric::NDTCell [private]
emptyliklslgeneric::NDTCell [private]
emptyvallslgeneric::NDTCell [private]
EVAL_FACTORlslgeneric::NDTCell [private, static]
EVAL_ROUGH_THRlslgeneric::NDTCell [private, static]
evals_lslgeneric::NDTCell [private]
EVEC_INCLINED_THRlslgeneric::NDTCell [private, static]
evecs_lslgeneric::NDTCell [private]
Glslgeneric::NDTCell [private]
getCenter() const lslgeneric::NDTCell [inline]
getClass() const lslgeneric::NDTCell [inline]
getCov() const lslgeneric::NDTCell [inline]
getDiagonal() const lslgeneric::NDTCell [inline, virtual]
getDimensions(double &xs, double &ys, double &zs) const lslgeneric::NDTCell [inline]
getDynamicLikelihood(unsigned int N)lslgeneric::NDTCell [inline]
getEmptyval()lslgeneric::NDTCell [inline]
getEvals() const lslgeneric::NDTCell [inline]
getEvecs() const lslgeneric::NDTCell [inline]
getEventData()lslgeneric::NDTCell [inline]
getInverseCov() const lslgeneric::NDTCell [inline]
getLikelihood(const pcl::PointXYZ &pt) const lslgeneric::NDTCell
getMean() const lslgeneric::NDTCell [inline]
getN()lslgeneric::NDTCell [inline]
getOccupancy()lslgeneric::NDTCell [inline]
getOccupancyRescaled()lslgeneric::NDTCell [inline]
getRGB(float &r, float &g, float &b)lslgeneric::NDTCell [inline]
hasGaussian_lslgeneric::NDTCell
HORIZONTAL enum valuelslgeneric::NDTCell
icov_lslgeneric::NDTCell [private]
INCLINED enum valuelslgeneric::NDTCell
isEmptylslgeneric::NDTCell
isInside(const pcl::PointXYZ pt) const lslgeneric::NDTCell [inline]
loadFromJFF(FILE *jffin)lslgeneric::NDTCell
loadJFFEventData(FILE *jffin, TEventData &evdata)lslgeneric::NDTCell [private]
loadJFFMatrix(FILE *jffin, Eigen::Matrix3d &mat)lslgeneric::NDTCell [private]
loadJFFVector(FILE *jffin, Eigen::Vector3d &vec)lslgeneric::NDTCell [private]
max_occu_lslgeneric::NDTCell [private]
mean_lslgeneric::NDTCell [private]
Nlslgeneric::NDTCell [private]
NDTCell()lslgeneric::NDTCell [inline]
NDTCell(pcl::PointXYZ &center, double &xsize, double &ysize, double &zsize)lslgeneric::NDTCell [inline]
NDTCell(const NDTCell &other)lslgeneric::NDTCell [inline]
occlslgeneric::NDTCell [private]
parametersSet_lslgeneric::NDTCell [private, static]
points_lslgeneric::NDTCell
Rlslgeneric::NDTCell [private]
rescaleCovariance()lslgeneric::NDTCell
rescaleCovariance(Eigen::Matrix3d &cov, Eigen::Matrix3d &invCov)lslgeneric::NDTCell
ROUGH enum valuelslgeneric::NDTCell
setCenter(const pcl::PointXYZ &cn)lslgeneric::NDTCell [inline]
setCov(const Eigen::Matrix3d &cov)lslgeneric::NDTCell
setDimensions(const double &xs, const double &ys, const double &zs)lslgeneric::NDTCell [inline]
setEmptyval(int emptyval_)lslgeneric::NDTCell [inline]
setEvals(const Eigen::Vector3d &ev)lslgeneric::NDTCell [inline]
setEventData(TEventData _ed)lslgeneric::NDTCell [inline]
setMean(const Eigen::Vector3d &mean)lslgeneric::NDTCell [inline]
setN(int N_)lslgeneric::NDTCell [inline]
setOccupancy(float occ_)lslgeneric::NDTCell [inline]
setParameters(double _EVAL_ROUGH_THR=0.1, double _EVEC_INCLINED_THR=8 *M_PI/18, double _EVAL_FACTOR=100)lslgeneric::NDTCell [static]
setRGB(float r, float g, float b)lslgeneric::NDTCell [inline]
squareSum(const Eigen::Matrix3d &C, const Eigen::Vector3d &x)lslgeneric::NDTCell [inline, private]
studentT()lslgeneric::NDTCell [private]
UNKNOWN enum valuelslgeneric::NDTCell
updateColorInformation()lslgeneric::NDTCell
updateEmpty(double elik, double dist)lslgeneric::NDTCell [inline]
updateOccupancy(float occ_val, float max_occu=255.0)lslgeneric::NDTCell [inline]
updateSampleVariance(const Eigen::Matrix3d &cov2, const Eigen::Vector3d &m2, unsigned int numpointsindistribution, bool updateOccupancyFlag=true, float max_occu=1024, unsigned int maxnumpoints=1e9)lslgeneric::NDTCell
VERTICAL enum valuelslgeneric::NDTCell
writeJFFEventData(FILE *jffout, TEventData &evdata)lslgeneric::NDTCell [private]
writeJFFMatrix(FILE *jffout, Eigen::Matrix3d &mat)lslgeneric::NDTCell [private]
writeJFFVector(FILE *jffout, Eigen::Vector3d &vec)lslgeneric::NDTCell [private]
writeToJFF(FILE *jffout)lslgeneric::NDTCell
xsize_lslgeneric::NDTCell [private]
ysize_lslgeneric::NDTCell [private]
zsize_lslgeneric::NDTCell [private]
~NDTCell()lslgeneric::NDTCell [inline, virtual]


ndt_map
Author(s): Todor Stoyanov, Jari Saarinen, Henrik Andreasson
autogenerated on Wed Aug 26 2015 15:24:41