 openvdb | |
  v1_1_0 | |
   io | |
    Archive | Grid serializer/unserializer |
    RealToHalf | RealToHalf and its specializations define a mapping from floating-point data types to analogous half float types |
    RealToHalf< float > | |
    RealToHalf< double > | |
    RealToHalf< Vec2s > | |
    RealToHalf< Vec2d > | |
    RealToHalf< Vec3s > | |
    RealToHalf< Vec3d > | |
    HalfReader | |
    HalfReader< false, T > | Partial specialization for non-floating-point types (no half to float promotion) |
    HalfReader< true, T > | Partial specialization for floating-point types |
    HalfWriter | |
    HalfWriter< false, T > | Partial specialization for non-floating-point types (no float to half quantization) |
    HalfWriter< true, T > | Partial specialization for floating-point types |
    File | Grid archive associated with a file on disk |
     NameIterator | |
    GridDescriptor | |
    Stream | Grid archive associated with arbitrary input and output streams (not necessarily files) |
   math | |
    internal | |
     LegacyFrustum | LegacyFrustum class used at DreamWorks for converting old vdb files |
     ReturnValue | |
    BBox | Axis-aligned bounding box |
    Coord | Signed (x, y, z) integer coordinates |
    CoordBBox | Axis-aligned bounding box of signed integer coordinates |
    D1 | |
    D1< CD_2NDT > | |
    D1< CD_2ND > | |
    D1< CD_4TH > | |
    D1< CD_6TH > | |
    D1< FD_1ST > | |
    D1< FD_2ND > | |
    D1< FD_3RD > | |
    D1< BD_1ST > | |
    D1< BD_2ND > | |
    D1< BD_3RD > | |
    D1< FD_WENO5 > | |
    D1< FD_HJWENO5 > | |
    D1< BD_WENO5 > | |
    D1< BD_HJWENO5 > | |
    D1Vec | |
    D1Vec< CD_2NDT > | |
    D1Vec< CD_2ND > | |
    D1Vec< CD_4TH > | |
    D1Vec< CD_6TH > | |
    D2 | |
    D2< CD_SECOND > | |
    D2< CD_FOURTH > | |
    D2< CD_SIXTH > | |
    Hermite | Quantized Hermite data object that stores compressed intersection information (offsets and normlas) for the up-wind edges of a voxel. (Size 10 bytes) |
    CompoundMap | Creates the composition of two maps, each of which could be a composition. In the case that each component of the composition classified as linear an acceleration AffineMap is stored |
    is_linear | Map traits |
    is_linear< AffineMap > | |
    is_linear< ScaleMap > | |
    is_linear< UniformScaleMap > | |
    is_linear< UnitaryMap > | |
    is_linear< TranslationMap > | |
    is_linear< ScaleTranslateMap > | |
    is_linear< UniformScaleTranslateMap > | |
    is_linear< CompoundMap< T1, T2 > > | |
    is_uniform_scale | |
    is_uniform_scale< UniformScaleMap > | |
    is_uniform_scale_translate | |
    is_uniform_scale_translate< TranslationMap > | |
    is_uniform_scale_translate< UniformScaleTranslateMap > | |
    is_scale | |
    is_scale< ScaleMap > | |
    is_scale_translate | |
    is_scale_translate< ScaleTranslateMap > | |
    is_uniform_diagonal_jacobian | |
    is_diagonal_jacobian | |
    MapBase | Abstract base class for maps |
    MapRegistry | Threadsafe singleton object for accessing the map type-name dictionary. Associates a map type-name with a factory function |
    AffineMap | A general linear transform using homogeneous coordinates to perform rotation, scaling, shear and translation |
    ScaleMap | A specialized Affine transform that scales along the principal axis the scaling need not be uniform in the three-directions |
    UniformScaleMap | A specialized Affine transform that scales along the principal axis the scaling is uniform in the three-directions |
    TranslationMap | A specialized linear transform that performs a translation |
    ScaleTranslateMap | A specialized Affine transform that scales along the principal axis the scaling need not be uniform in the three-directions, and then translates the result |
    UniformScaleTranslateMap | A specialized Affine transform that uniformaly scales along the principal axis and then translates the result |
    UnitaryMap | A specialized linear transform that performs a unitary maping i.e. rotation and or reflection |
    NonlinearFrustumMap | This map is composed of three steps. Frist it will take a box of size (Lx X Ly X Lz) defined by an member data bounding box and map it into a frustum with near plane (1 X Ly/Lx) and precribed depth Then this frustum is transformed by an internal second map: most often a uniform scale, but other affects can be achieved by accumulating translation, shear and rotation: these are all applied to the second map |
    Mat | |
    Quat | |
    Vec3 | |
    Mat4 | 4x4 -matrix class |
    Mat3 | 3x3 matrix class |
    Vec4 | |
    RandomInt | Simple class to generate random intergers |
    promote | |
    tolerance | |
    tolerance< float > | |
    tolerance< double > | |
    is_vec3d | Simple tool to help determine when type conversions are needed |
    is_vec3d< Vec3d > | |
    is_double | |
    is_double< double > | |
    ISGradient | Gradient operators defined in index space of various orders |
    BIAS_SCHEME | |
     ISStencil | |
    BIAS_SCHEME< FIRST_BIAS > | |
     ISStencil | |
    BIAS_SCHEME< SECOND_BIAS > | |
     ISStencil | |
    BIAS_SCHEME< THIRD_BIAS > | |
     ISStencil | |
    BIAS_SCHEME< WENO5_BIAS > | |
     ISStencil | |
    BIAS_SCHEME< HJWENO5_BIAS > | |
     ISStencil | |
    ISGradientBiased | Biased Gradient Operators, using upwinding defined by the Vec3Bias input |
    ISGradientNormSqrd | |
    ISLaplacian | Laplacian defined in index space, using various ceneter-differnce stencils |
    ISLaplacian< CD_SECOND > | |
    ISLaplacian< CD_FOURTH > | |
    ISLaplacian< CD_SIXTH > | |
    ISDivergence | Divergence operator defined in index space using various first derivative schemes |
    ISCurl | Curl operator defined in index space using various first derivative schemes |
    ISMeanCurvature | Compute the mean curvature in index space |
    Gradient | Center difference gradient opperators, defined with respect to the range-space of the map |
    Gradient< TranslationMap, DiffScheme > | |
    Gradient< UniformScaleMap, CD_2ND > | |
    Gradient< UniformScaleTranslateMap, CD_2ND > | |
    Gradient< ScaleMap, CD_2ND > | |
    Gradient< ScaleTranslateMap, CD_2ND > | |
    GradientBiased | Biased gradient opperators, defined with respect to the range-space of the map note this will need to be divided by two in the case of CD_2NDT |
    GradientNormSqrd | |
    GradientNormSqrd< UniformScaleMap, GradScheme > | |
    GradientNormSqrd< UniformScaleTranslateMap, GradScheme > | |
    Divergence | Compute the Divergence of a vector-type grid using differnce of various orders, the reulst defined with respect to the range-space of the map |
    Divergence< TranslationMap, DiffScheme > | |
    Divergence< UniformScaleMap, DiffScheme > | |
    Divergence< UniformScaleTranslateMap, DiffScheme > | |
    Divergence< UniformScaleMap, CD_2ND > | |
    Divergence< UniformScaleTranslateMap, CD_2ND > | |
    Divergence< ScaleMap, DiffScheme > | |
    Divergence< ScaleTranslateMap, DiffScheme > | |
    Divergence< ScaleMap, CD_2ND > | |
    Divergence< ScaleTranslateMap, CD_2ND > | |
    Curl | Compute the curl of a vector-valued grid using differencing of various orders in the space defined by the range of the map |
    Curl< UniformScaleMap, DiffScheme > | |
    Curl< UniformScaleTranslateMap, DiffScheme > | |
    Curl< UniformScaleMap, CD_2ND > | |
    Curl< UniformScaleTranslateMap, CD_2ND > | |
    Laplacian | Compute the Laplacian at a given location in a grid using finite differencing of various orders. The result is defined in the range of the map |
    Laplacian< TranslationMap, DiffScheme > | |
    Laplacian< UnitaryMap, DiffScheme > | |
    Laplacian< UniformScaleMap, DiffScheme > | |
    Laplacian< UniformScaleTranslateMap, DiffScheme > | |
    Laplacian< ScaleMap, DiffScheme > | |
    Laplacian< ScaleTranslateMap, DiffScheme > | |
    CPT | Compute the closest-point transform to a level set |
    CPT_RANGE | Compute the closest-point transform to a level set |
    MeanCurvature | Compute the Mean Curvature |
    MeanCurvature< TranslationMap, DiffScheme2, DiffScheme1 > | |
    MeanCurvature< UniformScaleMap, DiffScheme2, DiffScheme1 > | |
    MeanCurvature< UniformScaleTranslateMap, DiffScheme2, DiffScheme1 > | |
    GenericMap | A wrapper that holds a MapBase::ConstPtr and exposes a reduced set of fucntionality needed by the mathematical operators. This may be used in some Map-templated code, when the over-head of actually resovling the Map type is large compared to the map work to be done |
    QuantizedUnitVec | |
    BaseStencil | |
    SevenPointStencil | |
    SecondOrderDenseStencil | |
    ThirteenPointStencil | |
    FourthOrderDenseStencil | |
    NineteenPointStencil | |
    SixthOrderDenseStencil | |
    GradStencil | |
    WenoStencil | This is a special 19-point stencil that supports optimal fifth-order WENO upwinding, second-order central differencing, Laplacian, and zero-crossing test |
    CurvatureStencil | |
    DenseStencil | Dense stencil of a given width |
    Transform | Calculate an axis-aligned bounding box in index space from a bounding sphere in world space |
    Tuple | |
    TupleAbs | Helper class to compute the absolute value of a Tuple |
    TupleAbs< SIZE, T, true > | |
    Mat2 | |
    Vec2 | |
   tools | |
    composite | |
    internal | |
     TileSampler | A TileSampler wraps a grid sampler of another type (BoxSampler, QuadraticSampler, etc.), and for samples that fall within a given tile of the grid, it returns a cached tile value instead of accessing the grid |
     TileSampler< PointSampler, TreeT > | For point sampling, tree traversal is less expensive than testing bounding box membership |
     TileSampler< StaggeredPointSampler, TreeT > | For point sampling, tree traversal is less expensive than testing bounding box membership |
     PointTransform | |
     PrimCpy | |
     FogVolumeOp | |
     InteriorMaskOp | |
     Tolerance | |
     MeshVoxelizer | TBB class object to voxelize a mesh of triangles and/or quads into a collection of VDB grids, namely a square distance grid, closest primitive grid and a intersecting voxels grid (the voxels intersect the mesh) |
     ContourTracer | TBB Class object that slices up the volume into 2D slices that can be processed in parallel and marks the exterior contour of disjoint voxel sets in each slice |
     IntersectingVoxelSign | TBB Class object that traversers all the intersecting voxels (defined by the intersectingVoxelsGrid) and potentially flips their sign, by comparing the 'closest point' directions of outside-marked and non-intersecting neighbouring voxel |
     IntersectingVoxelCleaner | TBB Class object that removes intersecting voxels that where set by rasterizing self-intersecting parts of the mesh |
     ShellVoxelCleaner | TBB Class object that removes non-intersecting voxels that where set by rasterizing self-intersecting parts of the mesh |
     ExpandNB | TBB Class object to expand the level-set narrow-band |
     SqrtAndScaleOp | |
     VoxelSignOp | |
     TrimOp | |
     OffsetOp | |
     RenormOp | |
     MinOp | |
     MergeBufferOp | |
     LeafCPtrList | |
     LeafPtrList | |
     ReferenceData | |
     Count | |
     Merge | |
     PointGen | |
     QuadMeshOp | |
     AdaptiveMeshOp | |
     MeshGen | |
     AuxiliaryData | |
     SeamMaskGen | |
     AuxDataGenerator | |
    local | |
     DualTrait | |
     Dual | |
     DualTrait< Dual< T > > | |
    local_util | |
    valxform | |
     SharedOpApplier | |
     CopyableOpApplier | |
     SharedOpTransformer | |
     CopyableOpTransformer | |
    CompReplaceOp | |
    CsgVisitorBase | |
    CsgUnionVisitor | |
    CsgIntersectVisitor | |
    CsgDiffVisitor | |
    Filter | Filtering of VDB volumes |
    VectorToScalarConverter | VectorToScalarConverter<VectorGridType>::Type is the type of a grid having the same tree configuration as VectorGridType but a scalar value type, T, where T is the type of the original vector components |
    ScalarToVectorConverter | ScalarToVectorConverter<ScalarGridType>::Type is the type of a grid having the same tree configuration as ScalarGridType but value type Vec3<T> where T is ScalarGridType::ValueType |
    Cpt | Compute the closest-point transform of a scalar grid |
    Curl | Compute the curl of a scalar grid |
    Divergence | Computes the Divergence of a scalar grid |
     Functor | |
    Gradient | Computes the Gradient of a scalar grid |
     Functor | |
    Laplacian | Computes the Laplacian of a scalar grid |
     Functor | |
    MeanCurvature | |
     Functor | |
    Magnitude | |
     Functor | |
     OpT | |
    Normalize | |
     Functor | |
     OpT | |
    GridResampler | |
    GridTransformer | A GridTransformer applies a geometric transformation to an input grid using one of several sampling schemes, and stores the result in an output grid |
     MatrixTransform | |
    ABTransform | This class implements the Transformer functor interface (specifically, the isAffine(), transform() and invTransform() methods) for a transform that maps an A grid into a B grid's index space such that, after resampling, A's index space and transform match B's index space and transform |
    PointSampler | |
    BoxSampler | |
    QuadraticSampler | |
    StaggeredPointSampler | |
    StaggeredBoxSampler | |
    StaggeredQuadraticSampler | |
    GridSampler | Base class that provides the interface for continuous sampling of values in a grid |
    DiscreteField | Thin wrapper class for a velocity grid |
    EnrightField | Analytical, divergence-free and periodic vecloity field |
    LevelSetAdvection | Hyperbolic advection of narrow-band level sets in an external velocity field |
    LevelSetFilter | Filtering (i.e. diffusion) of narrow-band level sets |
    LevelSetFracture | Level set fracturing |
    LevelSetSphere | Generates a signed distance field (or narrow band level set) to a single sphere |
    LevelSetTracker | Performs multi-threaded interface tracking of narrow band level sets |
     Normalizer | |
    MinMaxVoxel | Threaded operator that finds the minimum and maximum values among the active leaf-level voxels of a grid |
    LeafTransformer | Threaded operator that applies a user-supplied functor to each leaf node in a LeafManager |
    MeshToVolume | |
    DimToWord | Mapping from a Log2Dim to a data type of size 2^Log2Dim bits |
    DimToWord< 3 > | |
    DimToWord< 4 > | |
    DimToWord< 5 > | |
    DimToWord< 6 > | |
    Morphology | |
    ParticlesToLevelSet | |
    ParticlesToLevelSetAndId | Use this wrapper class to convert particles into a level set and a separate index grid of closest-point particle id. The latter can be used to subsequently transfer particles attributes into separate grids |
    ClosestPointProjector | |
    VelocitySampler | |
    VelocityIntegrator | Performs runge-kutta time integration of variable order in a static velocity field |
    PointAdvect | |
    ConstrainedPointAdvect | |
    UniformPointScatter | The two point scatters UniformPointScatter and NonUniformPointScatter depend on the following two classes: |
    NonUniformPointScatter | Non-uniform scatters of point in the active voxels. The local point count is implicitly defined as a product of of a global density and the local voxel (or tile) value |
    PolygonPool | Collection of quads and triangles |
    VolumeToMesh | Mesh any scalar grid with a continuous isosurface |
   tree | |
    iter | |
     InvertedTree | |
     InvertedTree< HeadT, 1 > | |
    leafmgr | |
     TreeTraits | Useful traits for Tree types |
     TreeTraits< const TreeT > | |
    InternalNode | |
     ChildAll | |
     ChildIter | |
     ChildOff | |
     ChildOn | |
     DenseIter | |
     ValueAll | |
     ValueConverter | ValueConverter<T>::Type is the type of an InternalNode having the same child hierarchy and dimensions as this node but a different value type, T |
     ValueIter | |
     ValueOff | |
     ValueOn | |
    IteratorBase | Base class for iterators over internal and leaf nodes |
    SparseIteratorBase | Base class for sparse iterators over internal and leaf nodes |
    DenseIteratorBase | Base class for dense iterators over internal and leaf nodes |
    LeafManagerImpl | |
    LeafManager | This class manages a linear array of pointers to a given tree's leaf nodes, as well as optional auxiliary buffers (one or more per leaf) that can be swapped with the leaf nodes' voxel data buffers |
     LeafRange | |
      Iterator | |
    LeafManagerImpl< LeafManager< const TreeT > > | |
    LeafNode | Templated block class to hold specific data types and a fixed number of values determined by Log2Dim. The actual coordinate dimension of the block is 2^Log2Dim, i.e. Log2Dim=3 corresponds to a LeafNode that spans a 8^3 block |
     Buffer | Stores the actual values in the LeafNode. Its dimension it fixed to 2^(3*Log2Dim) |
     ChildAll | |
     ChildIter | Leaf nodes have no children, so their child iterators have no get/set accessors |
     ChildOff | |
     ChildOn | |
     DenseIter | |
     ValueAll | |
     ValueConverter | ValueConverter<T>::Type is the type of a LeafNode having the same child hierarchy and dimensions as this node but a different value type, T |
     ValueIter | |
     ValueOff | |
     ValueOn | |
    LeafNode< bool, Log2Dim > | LeafNode specialization for values of type bool that stores both the active states and the values of (2^Log2Dim)^3 voxels as bit masks |
     Buffer | |
     ChildIter | Leaf nodes have no children, so their child iterators have no get/set accessors |
     DenseIter | |
     ValueConverter | ValueConverter<T>::Type is the type of a LeafNode having the same dimensions as this node but a different value type, T |
     ValueIter | |
    NodeUnionImpl | |
    NodeUnionImpl< false, ValueT, ChildT > | |
    NodeUnionImpl< true, ValueT, ChildT > | |
    NodeUnion | |
    RootNode | |
     ValueConverter | ValueConverter<T>::Type is the type of a RootNode having the same child hierarchy as this node but a different value type, T |
    TreeBase | Base class for typed trees |
    Tree | |
     ValueConverter | ValueConverter<T>::Type is the type of a tree having the same hierarchy as this tree but a different value type, T |
    Tree4 | |
    TreeIterTraits | TreeIterTraits provides, for all tree iterators, a begin(tree) function that returns an iterator over a tree of arbitrary type |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildOnIter > | |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildOnCIter > | |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildOffIter > | |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildOffCIter > | |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildAllIter > | |
    TreeIterTraits< TreeT, typename TreeT::RootNodeType::ChildAllCIter > | |
    TreeIterTraits< TreeT, typename TreeT::NodeIter > | |
    TreeIterTraits< TreeT, typename TreeT::NodeCIter > | |
    TreeIterTraits< TreeT, typename TreeT::LeafIter > | |
    TreeIterTraits< TreeT, typename TreeT::LeafCIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueOnIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueOnCIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueOffIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueOffCIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueAllIter > | |
    TreeIterTraits< TreeT, typename TreeT::ValueAllCIter > | |
    CombineOpAdapter | Helper class to adapt a three-argument (a, b, result) CombineOp functor into a single-argument functor that accepts a CombineArgs struct |
    CopyConstness | |
    CopyConstness< const FromType, ToType > | |
    IterTraits | |
    IterTraits< NodeT, typename NodeT::ChildOnIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ChildOnCIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ChildOffIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ChildOffCIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ChildAllIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ChildAllCIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueOnIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueOnCIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueOffIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueOffCIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueAllIter > | |
     NodeConverter | |
    IterTraits< NodeT, typename NodeT::ValueAllCIter > | |
     NodeConverter | |
    IterListItem | An IterListItem is an element of a compile-time linked list of iterators to nodes of different types |
    IterListItem< PrevItemT, NodeVecT, VecSize, 0U > | The initial element of a compile-time linked list of iterators to nodes of different types |
    IterListItem< PrevItemT, NodeVecT, 1, _Level > | The final element of a compile-time linked list of iterators to nodes of different types |
    TreeValueIteratorBase | Base class for tree-traversal iterators over tile and voxel values |
    NodeIteratorBase | Base class for tree-traversal iterators over all nodes |
    LeafIteratorBase | Base class for tree-traversal iterators over all leaf nodes (but not leaf voxels) |
    IteratorRange | |
    TolerancePrune | Helper class for the tree nodes to replace constant tree branches (to within the provided tolerance) with a more memory efficient tile |
    InactivePrune | Helper class for the tree nodes to replace inactive tree branches with a more memory efficient inactive tiles with the provided value. Specialized but faster then the tolerance based pruning defined above |
    LevelSetPrune | Prune any descendants whose values are all inactive and replace them with inactive tiles having values with a magnitude equal to the background value and a sign equal to the first value encountered in the (inactive) child |
    ValueAccessor0 | ValueAccessor with no mutex and no node caching |
    ValueAccessor1 | Value accessor with one level of node caching |
    ValueAccessor2 | Value accessor with two levels of node caching |
    ValueAccessor3 | Value accessor with three levels of node caching |
    InvertedTree | |
    CacheItem | |
    ValueAccessorBase | This base class for ValueAccessors manages registration of an accessor with a tree so that the tree can automatically clear the accessor whenever one of its nodes is deleted |
    ValueAccessor | |
    ValueAccessor< TreeType, 0, tbb::null_mutex > | |
    ValueAccessor< TreeType, 1, tbb::null_mutex > | Template specialization of the ValueAccessor with no mutex and 1 cache level |
    ValueAccessor< TreeType, 2, tbb::null_mutex > | Template specialization of the ValueAccessor with no mutex and 2 cache levels |
    ValueAccessor< TreeType, 3, tbb::null_mutex > | Template specialization of the ValueAccessor with no mutex and 3 cache levels |
    ValueAccessorRW | |
    InvertedTree< HeadT, 1 > | |
    CacheItem< TreeCacheT, NodeVecT, true > | The tail of a compile-time list of cached node pointers, ordered from LeafNode to RootNode |
   util | |
    FormattedInt | I/O manipulator that formats integer values with thousands separators |
    BaseMaskIterator | Base class for the bit mask iterators |
    OnMaskIterator | |
    OffMaskIterator | |
    DenseMaskIterator | |
    NodeMask | Bit mask for the internal and leaf nodes of VDB. This is a 64-bit implementation |
    NodeMask< 1 > | Template specialization of NodeMask for Log2Dim=1, i.e. 2^3 nodes |
    NodeMask< 2 > | Template specialization of NodeMask for Log2Dim=2, i.e. 4^3 nodes |
    RootNodeMask | |
     BaseIterator | |
     DenseIterator | |
     OffIterator | |
     OnIterator | |
    NullInterrupter | Dummy NOOP interrupter class defining interface |
    LeafTopologyIntOp | Functor for use with tools::foreach() to compute the boolean intersection between the value masks of corresponding leaf nodes in two trees |
    LeafTopologyDiffOp | Functor for use with tools::foreach() to compute the boolean difference between the value masks of corresponding leaf nodes in two trees |
   Exception | |
   ArithmeticError | |
   IllegalValueException | |
   IndexError | |
   IoError | |
   KeyError | |
   LookupError | |
   NotImplementedError | |
   ReferenceError | |
   RuntimeError | |
   TypeError | |
   ValueError | |
   Grid | Container class that associates a tree with a transform and metadata |
    ValueConverter | ValueConverter<T>::Type is the type of a grid having the same hierarchy as this grid but a different value type, T |
   GridBase | Abstract base class for typed grids |
   GridNamePred | Predicate functor that returns true for grids that have a specified name |
   TreeAdapter | This adapter allows code that is templated on a Tree type to accept either a Tree type or a Grid type |
   TreeAdapter< Grid< _TreeType > > | Partial specialization for Grid types |
   VecTraits | |
   VecTraits< math::Vec2< T > > | |
   VecTraits< math::Vec3< T > > | |
   VecTraits< math::Vec4< T > > | |
   CombineArgs | This struct collects both input and output arguments to "grid combiner" functors used with the tree::TypedGrid::combineExtended() and combine2Extended() methods. ValueType is the value type of the two grids being combined |
   SwappedCombineOp | |
   ShallowCopy | |
   TopologyCopy | |
   VersionId | |
   Metadata | Base class for storing metadata information in a grid |
   UnknownMetadata | Subclass to read (and ignore) data of an unregistered type |
   TypedMetadata | Templated metadata class to hold specific types |
   MetaMap | Provides functionality storing type agnostic metadata information. Grids and other structures can inherit from this to attain metadata functionality |
 TestLeafIO | |