49         scan->transform(transform, writeFrame, use);
    65             return scan->point(index);
    67         index -= scan->numPoints();
 
Eigen::Vector3d Vector3d
Eigen 3D vector, double precision. 
std::shared_ptr< Scan > ScanPtr
Shared pointer to scans. 
Transform< double > Transformd
4x4 double precision transformation matrix 
A Wrapper around Scan to allow for SLAM usage. 
size_t numPoints() const
Returns the number of Points in the Scan. 
std::shared_ptr< SLAMScanWrapper > SLAMScanPtr
void writeFrame(const Transform< T > &transform, const boost::filesystem::path &framesOut)
Writes a Eigen transformation into a .frames file. 
void addFrame(FrameUse use=FrameUse::UNUSED)
Adds a new animation Frame with the current Pose. 
FrameUse
Annotates the use of a Scan when creating an slam6D .frames file.