#include <hfield.h>

| Public Types | |
| typedef coal::HeightField< BV > | Base | 
|  Public Types inherited from coal::HeightField< BV > | |
| typedef std::vector< Node, Eigen::aligned_allocator< Node > > | BVS | 
| typedef HFNode< BV > | Node | 
| Public Attributes | |
| BVS | bvs | 
| Bounding volume hierarchy.  More... | |
| MatrixXs | heights | 
| Elevation values in meters of the Height Field.  More... | |
| CoalScalar | max_height | 
| CoalScalar | min_height | 
| Minimal height of the Height Field: all values bellow min_height will be discarded.  More... | |
| unsigned int | num_bvs | 
| CoalScalar | x_dim | 
| Dimensions in meters along X and Y directions.  More... | |
| VecXs | x_grid | 
| Grids along the X and Y directions. Useful for plotting or other related things.  More... | |
| CoalScalar | y_dim | 
| VecXs | y_grid | 
|  Public Attributes inherited from coal::HeightField< BV > | |
| EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef CollisionGeometry | Base | 
|  Public Attributes inherited from coal::CollisionGeometry | |
| Vec3s | aabb_center | 
| AABB center in local coordinate.  More... | |
| AABB | aabb_local | 
| AABB in local coordinate, used for tight AABB when only translation transform.  More... | |
| CoalScalar | aabb_radius | 
| AABB radius.  More... | |
| CoalScalar | cost_density | 
| collision cost for unit volume  More... | |
| CoalScalar | threshold_free | 
| threshold for free (<= is free)  More... | |
| CoalScalar | threshold_occupied | 
| threshold for occupied ( >= is occupied)  More... | |
| void * | user_data | 
| pointer to user defined data specific to this object  More... | |
| Additional Inherited Members | |
|  Public Member Functions inherited from coal::HeightField< BV > | |
| virtual HeightField< BV > * | clone () const | 
| Clone *this into a new CollisionGeometry.  More... | |
| void | computeLocalAABB () | 
| Compute the AABB for the HeightField, used for broad-phase collision.  More... | |
| HFNode< BV > & | getBV (unsigned int i) | 
| Access the bv giving the its index.  More... | |
| const HFNode< BV > & | getBV (unsigned int i) const | 
| Access the bv giving the its index.  More... | |
| const MatrixXs & | getHeights () const | 
| Returns a const reference of the heights.  More... | |
| CoalScalar | getMaxHeight () const | 
| Returns the maximal height value of the Height Field.  More... | |
| CoalScalar | getMinHeight () const | 
| Returns the minimal height value of the Height Field.  More... | |
| const BVS & | getNodes () const | 
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| Get the BV type: default is unknown.  More... | |
| NODE_TYPE | getNodeType () const | 
| Specialization of getNodeType() for HeightField with different BV types.  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| NODE_TYPE | getNodeType () const | 
| get the node type  More... | |
| CoalScalar | getXDim () const | 
| Returns the dimension of the Height Field along the X direction.  More... | |
| const VecXs & | getXGrid () const | 
| Returns a const reference of the grid along the X direction.  More... | |
| CoalScalar | getYDim () const | 
| Returns the dimension of the Height Field along the Y direction.  More... | |
| const VecXs & | getYGrid () const | 
| Returns a const reference of the grid along the Y direction.  More... | |
| HeightField () | |
| Constructing an empty HeightField.  More... | |
| HeightField (const CoalScalar x_dim, const CoalScalar y_dim, const MatrixXs &heights, const CoalScalar min_height=(CoalScalar) 0) | |
| Constructing an HeightField from its base dimensions and the set of heights points. The granularity of the height field along X and Y direction is extraded from the Z grid.  More... | |
| HeightField (const HeightField &other) | |
| Copy contructor from another HeightField.  More... | |
| void | updateHeights (const MatrixXs &new_heights) | 
| Update Height Field height.  More... | |
| virtual | ~HeightField () | 
| deconstruction, delete mesh data related.  More... | |
|  Public Member Functions inherited from coal::CollisionGeometry | |
| CollisionGeometry () | |
| CollisionGeometry (const CollisionGeometry &other)=default | |
| Copy constructor.  More... | |
| virtual Matrix3s | computeMomentofInertiaRelatedToCOM () const | 
| compute the inertia matrix, related to the com  More... | |
| void * | getUserData () const | 
| get user data in geometry  More... | |
| bool | isFree () const | 
| whether the object is completely free  More... | |
| bool | isOccupied () const | 
| whether the object is completely occupied  More... | |
| bool | isUncertain () const | 
| whether the object has some uncertainty  More... | |
| bool | operator!= (const CollisionGeometry &other) const | 
| Difference operator.  More... | |
| bool | operator== (const CollisionGeometry &other) const | 
| Equality operator.  More... | |
| void | setUserData (void *data) | 
| set user data in geometry  More... | |
| virtual | ~CollisionGeometry () | 
|  Protected Member Functions inherited from coal::HeightField< BV > | |
| int | buildTree () | 
| Build the bounding volume hierarchy.  More... | |
| Vec3s | computeCOM () const | 
| compute center of mass  More... | |
| Matrix3s | computeMomentofInertia () const | 
| compute the inertia matrix, related to the origin  More... | |
| CoalScalar | computeVolume () const | 
| compute the volume  More... | |
| OBJECT_TYPE | getObjectType () const | 
| Get the object type: it is a HFIELD.  More... | |
| void | init (const CoalScalar x_dim, const CoalScalar y_dim, const MatrixXs &heights, const CoalScalar min_height) | 
| CoalScalar | recursiveBuildTree (const size_t bv_id, const Eigen::DenseIndex x_id, const Eigen::DenseIndex x_size, const Eigen::DenseIndex y_id, const Eigen::DenseIndex y_size) | 
| CoalScalar | recursiveUpdateHeight (const size_t bv_id) | 
|  Protected Attributes inherited from coal::HeightField< BV > | |
| BVS | bvs | 
| Bounding volume hierarchy.  More... | |
| MatrixXs | heights | 
| Elevation values in meters of the Height Field.  More... | |
| CoalScalar | max_height | 
| CoalScalar | min_height | 
| Minimal height of the Height Field: all values bellow min_height will be discarded.  More... | |
| unsigned int | num_bvs | 
| CoalScalar | x_dim | 
| Dimensions in meters along X and Y directions.  More... | |
| VecXs | x_grid | 
| Grids along the X and Y directions. Useful for plotting or other related things.  More... | |
| CoalScalar | y_dim | 
| VecXs | y_grid | 
Definition at line 38 of file coal/serialization/hfield.h.
| typedef coal::HeightField<BV> boost::serialization::internal::HeightFieldAccessor< BV >::Base | 
Definition at line 39 of file coal/serialization/hfield.h.
| BVS coal::HeightField< BV >::bvs | 
Bounding volume hierarchy.
Definition at line 358 of file coal/hfield.h.
| MatrixXs coal::HeightField< BV >::heights | 
Elevation values in meters of the Height Field.
Definition at line 347 of file coal/hfield.h.
| CoalScalar coal::HeightField< BV >::max_height | 
Definition at line 351 of file coal/hfield.h.
| CoalScalar coal::HeightField< BV >::min_height | 
Minimal height of the Height Field: all values bellow min_height will be discarded.
Definition at line 351 of file coal/hfield.h.
| unsigned int coal::HeightField< BV >::num_bvs | 
Definition at line 359 of file coal/hfield.h.
| CoalScalar coal::HeightField< BV >::x_dim | 
Dimensions in meters along X and Y directions.
Definition at line 344 of file coal/hfield.h.
| VecXs coal::HeightField< BV >::x_grid | 
Grids along the X and Y directions. Useful for plotting or other related things.
Definition at line 355 of file coal/hfield.h.
| CoalScalar coal::HeightField< BV >::y_dim | 
Definition at line 344 of file coal/hfield.h.
| VecXs coal::HeightField< BV >::y_grid | 
Definition at line 355 of file coal/hfield.h.