►Nnoether | [GUI Plugins Example Simple] |
CAABBCenterOriginGenerator | Returns the center of the axis-aligned bounding box (AABB) as the origin |
CAABBCenterOriginGeneratorWidget | |
CAngleDoubleSpinBox | Double spin box widget class that supports angle units |
CBaseWidget | Base class for a widget that can configure tool path planning components |
CBiasedToolDragOrientationToolPathModifier | Transforms the waypoints to correspond with the edge of the ginding tool so that the edge of the tool is in contact with the media |
CBiasedToolDragOrientationToolPathModifierWidget | |
CBoundaryEdgePlanner | Edge tool path planner that creates paths around the boundary edges of a mesh (exterior and interior) as identified by half-edge triangle mesh representation of the mesh |
CBoundaryEdgePlannerFactory | |
CBoundaryEdgePlannerWidget | |
►CBSplineReconstruction | Smoothes a mesh by fitting a bspline surface to it |
CParameters | |
CCentroidOriginGenerator | Returns the centroid of the mesh vertices as the origin |
CCentroidOriginGeneratorWidget | |
CCircularLeadInModifier | Modifier that adjusts the parameters of the tool approach trajectory to the media |
CCircularLeadInToolPathModifierWidget | |
CCircularLeadOutModifier | Modifier that adds exit waypoints in a circular arc (with fixed orientation) to the end of a trajectory |
CCircularLeadOutToolPathModifierWidget | |
CCleanData | Merges duplicate points, removes unused points, and/or removes degenerate cells |
CCompoundMeshModifier | MeshModifier that cascades multiple MeshModifier instances in series |
CCompoundModifier | Modifier that chains together other modifiers |
CConcatenateModifier | Concatenates all input tool paths into a single tool path |
CConcatenateModifierWidget | |
CConfigurableTPPPipelineWidget | |
CCrossHatchPlaneSlicerRasterPlannerWidget | |
CDirectionGenerator | Interface for generating the direction of raster paths |
CDirectionGeneratorWidgetPlugin | WidgetPlugin implementation specifically for BaseWidget instances that configure direction generators |
CDirectionOfTravelOrientationModifier | Aligns the x-axis of all waypoints with the direction of travel between adjacent waypoints |
CDirectionOfTravelOrientationModifierWidget | |
CDistanceDoubleSpinBox | Double spin box widget class that supports distance units |
CEdgePlanner | A specification of the tool path planner interface for generating paths around the edges of surfaces |
CEuclideanClusteringMeshModifier | MeshModifier that separates the mesh into clusters |
CEuclideanClusteringMeshModifierWidget | |
CExtrudedPolygonSubMeshExtractor | Extracts the submesh with the vertices captured inside an extruded polygon defined by the input boundary points |
►CExtrudedPolygonSubsetExtractor | Extracts the submesh with the vertices captured inside an extruded polygon defined by the input boundary points |
CParams | |
CFactory | Factory for creating tool path planning components from plugins |
CFillHoles | Fills holes in the mesh using vtkFillHoles |
CFillHolesModifierWidget | |
CFixedDirectionGenerator | Generates the raster direction based on a fixed input |
CFixedDirectionGeneratorWidget | |
CFixedOrientationModifier | Aligns the orientation of each waypoint with the existing waypoint normal (z-axis) and the specified reference x-axis direction |
CFixedOrientationModifierWidget | |
CFixedOriginGenerator | Returns a fixed point as the origin |
CFixedOriginGeneratorWidget | |
CLinearApproachModifier | Adds a series of waypoints in a linear pattern off the first waypoint in a tool path |
CLinearApproachToolPathModifierWidget | |
CLinearDepartureModifier | Adds a series of waypoints in a linear pattern off the last waypoint in a tool path |
CLinearDepartureToolPathModifierWidget | |
CMeshModifier | A common interface for mesh modifications |
CMeshModifierWidgetPlugin | WidgetPlugin implementation specifically for BaseWidget instances that configure mesh modifiers |
CMovingAverageOrientationSmoothingModifier | Applies a moving average filter to waypoints in each tool path segment to smooth their orientations |
CMovingAverageOrientationSmoothingModifierWidget | |
CMultiToolPathPlanner | Runs multiple tool path planners serially and concatenates their outputs together |
CNormalEstimationPCLMeshModifier | Estimates vertex normals of an input mesh using PCL |
CNormalEstimationPCLMeshModifierWidget | |
CNormalsFromMeshFacesMeshModifier | MeshModifier that assigns vertex normals using mesh faces |
CNormalsFromMeshFacesMeshModifierWidget | |
COffsetModifier | Offsets the tool path by a fixed pose |
COffsetModifierWidget | |
COffsetOriginGenerator | Returns the origin as the origin of another specified origin generator plus a fixed offset |
COneTimeCompoundModifier | Modifier that chains together one-time style modifiers |
COneTimeToolPathModifier | An extension of the ToolPathModifier interface that requires a modifier to not cause additional changes if run again |
COriginGenerator | Interface for setting the start point from which to generate toolpaths |
COriginGeneratorWidgetPlugin | WidgetPlugin implementation specifically for BaseWidget instances that configure origin generators |
CPCARotatedDirectionGenerator | Rotates a direction vector provided by another direction generator about the smallest principal axis of the input mesh |
CPlaneProjectionMeshModifier | MeshModifier that fits planes to the input mesh and projects the vertices onto the face |
CPlaneProjectionMeshModifierWidget | |
CPlaneSlicerRasterPlanner | An implementation of the Raster Planner using a series of parallel cutting planes |
CPlaneSlicerRasterPlannerFactory | |
CPlaneSlicerRasterPlannerWidget | |
CPlugin | Base class for a plugin that can generate a tool path planning component (e.g., mesh modifier, tool path planner, tool path modifier) |
CPluginLoaderWidget | Widget for loading widget plugins |
CPrincipalAxisDirectionGenerator | Generates the raster direction along the largest principal axis of the input mesh |
CPrincipalAxisDirectionGeneratorWidget | |
CRasterOrganizationModifier | Organizes a tool path into a raster-style pattern |
CRasterOrganizationModifierWidget | |
CRasterPlanner | A specification of the tool path planner for covering surfaces in repeating, evenly spaced path lines |
CRasterPlannerFactory | Interface for creating implementations of raster tool path planners |
CRasterPlannerWidget | |
CSimplePlugin | Template for a simple implementation of Plugin |
CSimpleWidgetPlugin | Template for a simple implementation of WidgetPlugin |
CSnakeOrganizationModifier | Organizes a tool path into a snake-style pattern |
CSnakeOrganizationModifierWidget | |
CStandardEdgePathsOrganizationModifier | Organizes a set of tool paths into a standard configuration for edge paths |
CStandardEdgePathsOrganizationModifierWidget | |
CSubMeshExtractor | Base class for extracting a submesh from a mesh given a set of boundary points |
CSubsetExtractor | Base class for extracting a point cloud subset from an input given a set of boundary points |
CToolDragOrientationToolPathModifier | Transforms the waypoints to correspond with the center of the ginding tool so that the edge of the tool is in contact with the media |
CToolDragOrientationToolPathModifierWidget | |
CToolPathModifier | A common interface for functions that alter a generated toolpath |
CToolPathModifierWidgetPlugin | WidgetPlugin implementation specifically for BaseWidget instances that configure tool path modifiers |
CToolPathPlanner | Interface for a tool path planner that operates on a mesh |
CToolPathPlannerFactory | Interface for creating implementations of the ToolPathPlanner interface |
CToolPathPlannerPipeline | |
CToolPathPlannerWidgetPlugin | WidgetPlugin implementation specifically for BaseWidget instances that configure tool path planners |
CTPPPipelineWidget | Widget for creating a tool path planning pipeline |
CTPPWidget | Basic tool path planning widget |
CUniformOrientationModifier | Aligns the x-axis of all waypoints with the direction of travel of the first two waypoints |
CUniformOrientationModifierWidget | |
CUniformSpacingLinearModifier | The UniformSpacingLinearModifier class |
CUniformSpacingLinearModifierWidget | |
CUniformSpacingSplineModifier | The UniformSpacingSplineModifier class |
CUniformSpacingSplineModifierWidget | |
CWidgetFactory | Extends the Factory class to be able to load widget plugins for the GUI |
CWidgetPlugin | Base class for a plugin that can generate a BaseWidget<T> for configuring a tool path planning component (e.g., mesh modifier, tool path planner, tool path modifier) |
►CWindowedSincSmoothing | Uses vtkWindowedSincPolyDataFilter to smooth the mesh |
CConfig | Configuration information for WindowedSincSmoothing |
►NYAML | |
Cconvert< Eigen::Matrix< FloatT, 3, 1 > > | |
Cconvert< Eigen::Transform< FloatT, 3, Eigen::Isometry > > | |
Cconvert< std::vector< T, Eigen::aligned_allocator< T > > > | |