Gazebo Math

API Reference

7.4.0
Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
[detail level 1234]
 Ngz
 NmathMath classes and function useful in robot applications
 Ngraph
 CDirectedEdgeA directed edge represents a connection between two vertices. The connection is unidirectional, it's only possible to traverse the edge in one direction (from the tail to the head)
 CEdgeGeneric edge class. An edge has two ends and some constraint between them. For example, a directed edge only allows traversing the edge in one direction
 CEdgeInitializerUsed in the Graph constructors for uniform initialization
 CGraphA generic graph class. Both vertices and edges can store user information. A vertex could be created passing a custom Id if needed, otherwise it will be choosen internally. The vertices also have a name that could be reused among other vertices if needed. This class supports the use of different edge types (e.g. directed or undirected edges)
 CUndirectedEdgeAn undirected edge represents a connection between two vertices. The connection is bidirectional, it's possible to traverse the edge in both directions
 CVertexA vertex of a graph. It stores user information, an optional name, and keeps an internal unique Id. This class does not enforce to choose a unique name
 CAdditivelySeparableScalarField3The AdditivelySeparableScalarField3 class constructs a scalar field F in R^3 as a sum of scalar functions i.e. F(x, y, z) = k (p(x) + q(y) + r(z))
 CAngleUsed to simplify and clarify the use of radians and degrees measurements. A default constructed Angle instance has a value of zero radians/degrees
 CAxisAlignedBoxMathematical representation of a box that is aligned along an X,Y,Z axis
 CBiQuadBi-quad filter base class
 CBiQuadVector3BiQuad vector3 filter
 CBoxA representation of a box. All units are in meters
 CCapsuleA representation of a capsule or sphere-capped cylinder
 CColorDefines a color using a red (R), green (G), blue (B), and alpha (A) component. Each color component is in the range [0..1]
 CCylinderA representation of a cylinder
 CDiffDriveOdometryComputes odometry values based on a set of kinematic properties and wheel speeds for a diff-drive vehicle
 CEllipsoidA representation of a general ellipsoid
 CFilterFilter base class
 CFrustumMathematical representation of a frustum and related functions. This is also known as a view frustum
 CGaussMarkovProcessImplementation of a stationary gauss-markov process, also known as a Ornstein Ulenbeck process
 CInertialThe Inertial object provides a representation for the mass and inertia matrix of a body B. The components of the inertia matrix are expressed in what we call the "inertial" frame Bi of the body, i.e. the frame in which these inertia components are measured. The inertial frame Bi must be located at the center of mass of the body, but not necessarily aligned with the body’s frame. In addition, this class allows users to specify a frame F for these inertial properties by specifying the pose X_FBi of the inertial frame Bi in the inertial object frame F
 CInMemorySessionAn in-memory session. Loads the whole dataset in memory and performs queries
 CInMemoryTimeVaryingVolumetricGridFactoryFactory class for constructing an InMemoryTimeVaryingVolumetricGrid
 CIntervalThe Interval class represents a range of real numbers. Intervals may be open (a, b), left-closed [a, b), right-closed (a, b], or fully closed [a, b]
 CKmeansK-Means clustering algorithm. Given a set of observations, k-means partitions the observations into k sets so as to minimize the within-cluster sum of squares. Description based on http://en.wikipedia.org/wiki/K-means_clustering
 CLine2A two dimensional line segment. The line is defined by a start and end point
 CLine3A three dimensional line segment. The line is defined by a start and end point
 CMassMatrix3A class for inertial information about a rigid body consisting of the scalar mass and a 3x3 symmetric moment of inertia matrix stored as two Vector3's
 CMaterialContains information about a single material
 CMatrix3A 3x3 matrix class
 CMatrix4A 4x4 matrix class
 CMatrix6A 6x6 matrix class
 CMecanumDriveOdometryComputes odometry values based on a set of kinematic properties and wheel speeds for a Mecanum-drive vehicle
 CMovingWindowFilterBase class for MovingWindowFilter. This replaces the version of MovingWindowFilter in the Gazebo Common library
 COnePoleA one-pole DSP filter
 COnePoleQuaternionOne-pole quaternion filter
 COnePoleVector3One-pole vector3 filter
 COrientedBoxMathematical representation of a box which can be arbitrarily positioned and rotated
 CPIDGeneric PID controller class. Generic proportional-integral-derivative controller class that keeps track of PID-error states and control inputs given the state of a system and a user specified target state. It includes a user-adjustable command offset term (feed-forward)
 CPiecewiseScalarField3The PiecewiseScalarField3 class constructs a scalar field F in R^3 as a union of scalar fields Pn, defined over regions Rn i.e. piecewise
 CPieceA scalar field P in R^3 and the region R in which it is defined
 CPlaneA plane and related functions
 CPolynomial3The Polynomial3 class represents a cubic polynomial with real coefficients p(x) = c0 x^3 + c1 x^2 + c2 x + c3
 CPose3The Pose3 class represents a 3D position and rotation. The position component is a Vector3, and the rotation is a Quaternion
 CQuaternionA quaternion class that represents 3D rotations and orientations. Four scalar values, [w,x,y,z], are used represent orientations and rotations
 CRandRandom number generator class
 CRegion3The Region3 class represents the cartesian product of intervals Ix ✕ Iy ✕ Iz, one per axis, yielding an axis-aligned region of R^3 space. It can be thought of as an intersection of halfspaces. Regions may be open or closed in their boundaries, if any
 CRollingMeanA class that computes the mean over a series of data points. The window size determines the maximum number of data points. The oldest value is popped off when the window size is reached and a new value is pushed in
 CRotationSplineSpline for rotations
 CSemanticVersionVersion comparison class based on Semantic Versioning 2.0.0 http://semver.org/ Compares versions and converts versions from string
 CSignalMaxAbsoluteValueComputing the maximum of the absolute value of a discretely sampled signal. Also known as the maximum norm, infinity norm, or supremum norm
 CSignalMaximumComputing the maximum value of a discretely sampled signal
 CSignalMeanComputing the mean value of a discretely sampled signal
 CSignalMinimumComputing the minimum value of a discretely sampled signal
 CSignalRootMeanSquareComputing the square root of the mean squared value of a discretely sampled signal
 CSignalStatisticStatistical properties of a discrete time scalar signal
 CSignalStatsCollection of statistics for a scalar signal
 CSignalVarianceComputing the incremental variance of a discretely sampled signal
 CSpeedLimiterClass to limit velocity, acceleration and jerk
 CSphereA representation of a sphere
 CSphericalCoordinatesConvert spherical coordinates for planetary surfaces
 CSplineSplines
 CStopwatchThe Stopwatch keeps track of time spent in the run state, accessed through ElapsedRunTime(), and time spent in the stop state, accessed through ElapsedStopTime(). Elapsed run time starts accumulating after the first call to Start(). Elapsed stop time starts accumulation after Start() has been called followed by Stop(). The stopwatch can be reset with the Reset() function
 CTemperatureA class that stores temperature information, and allows conversion between different units
 CTimeVaryingVolumetricGridA grid with interpolation where time can be varied. This class has no implementation to allow for different strategies
 CTimeVaryingVolumetricGrid< T, V, InMemorySession< T, P >, P >Specialization of TimeVaryingVolumetricGrid which loads the whole of the dataset into memory. To construct this class use InMemoryTimeVaryingVolumetricGridFactory
 CTimeVaryingVolumetricGridLookupFieldLookup table for a time-varying volumetric dataset. This is an unimplemented template as the actual methods depend on the underlying structure. The key idea is that one uses a session S to hold a session token. This is so that we don't keep doing O(logn) lookups and instead step along the axis
 CTimeVaryingVolumetricGridLookupField< T, V, InMemorySession< T, V > >Specialized version of TimeVaryingVolumetricGridLookupField for in-memory lookup. It loads the whole dataset into memory
 CTriangleTriangle class and related functions
 CTriangle3A 3-dimensional triangle and related functions
 CVector2Two dimensional (x, y) vector
 CVector3The Vector3 class represents the generic vector containing 3 elements. Since it's commonly used to keep coordinate system related information, its elements are labeled by x, y, z
 CVector3StatsCollection of statistics for a Vector3 signal
 CVector4T Generic x, y, z, w vector
 CVolumetricGridLookupFieldLookup table for a volumetric dataset. This class is used to lookup indices for a large dataset that's organized in a grid. This class is not meant to be used with non-grid like data sets. The grid may be sparse or non uniform and missing data points