Compounds |
class | AcosImageAdaptor |
| Presents an image as being composed of the acos() of its pixels. More...
|
class | AcosImageFilter |
| Computes the acos(x) pixel-wise. More...
|
class | AdaptImageFilter |
| Convert an image to another pixel type using the specified data accessor. More...
|
class | AddImageAdaptor |
| Presents an image as being composed of the log() of its pixels. More...
|
class | AddImageFilter |
| Implements an operator for pixel-wise addition of two images. More...
|
class | AffineTransform |
class | AmoebaOptimizer |
| Wrap of the vnl_amoeba algorithm. More...
|
class | AnalyzeImageIO |
| Class that defines how to read Analyze file format. More...
|
class | AnalyzeImageIOFactory |
| Create instances of AnalyzeImageIO objects using an object factory. More...
|
class | AnisotropicDiffusionFunction |
class | AnisotropicDiffusionImageFilter |
class | AntiAliasBinaryImageFilter |
class | Array |
| Array class with size defined at construction time. More...
|
class | Array2D |
| Array2D class representing a 2D array with size defined at construction time. More...
|
class | AsinImageAdaptor |
| Presents an image as being composed of the asin() of its pixels. More...
|
class | AsinImageFilter |
| Computes the asin(x) pixel-wise. More...
|
class | Atan2ImageFilter |
| Computes arctangent pixel-wise from two images. More...
|
class | AtanImageAdaptor |
| Presents an image as being composed of the atan() of its pixels. More...
|
class | AtanImageFilter |
| Computes the atan(x) pixel-wise. More...
|
class | AutoPointer |
| Implements an Automatic Pointer to an object. More...
|
class | AuxVarTypeDefault |
| Level set auxiliary variables type information. AuxVarTypeDefault is a simple class that holds type information for auxiliary variables in some level set algorithms. This class is templated over the auxiliary variable data type, the number of auxiliary variables and the level set dimension. More...
|
class | AzimuthElevationToCartesianTransform |
class | BackwardDifferenceOperator |
| Operator whose inner product with a neighborhood returns a "half" derivative at the center of the neighborhood. More...
|
class | BlobSpatialObject |
| Representation of a Blob based on the spatial object classes. More...
|
class | CacheableScalarFunction |
| function cache implementation. More...
|
class | EllipseSpatialObject |
class | GroupSpatialObject |
| Representation of a group based on the spatial object classes. More...
|
class | ImageSpatialObject |
| Implementation of an image as spatial object. More...
|
class | LandmarkSpatialObject |
| Representation of a Landmark based on the spatial object classes. More...
|
class | LineSpatialObject |
| Representation of a Line based on the spatial object classes. More...
|
class | LineSpatialObjectPoint |
| Point used for a line definition. More...
|
struct | InvalidInputError |
class | CoefficientVectorSizeMismatch |
class | CompositeValleyFunction |
| Multiple valley shaped curve function. More...
|
class | ConjugateGradientOptimizer |
| Wrap of the vnl_conjugate_gradient. More...
|
class | CostFunction |
| Base class for cost functions intended to be used with Optimizers. More...
|
class | DICOMImageIO2 |
| Read DICOMImage file format. More...
|
class | DICOMImageIO2Factory |
| Create instances of DICOMImageIO2 objects using an object factory. More...
|
struct | Bal |
class | BalloonForce3DFilter |
class | BalloonForceFilter |
class | BarycentricCombination |
class | BilateralImageFilter |
| Blurs an image while preserving edges. More...
|
class | BinaryBallStructuringElement |
| A Neighborhood that represents a ball structuring element (ellipsoid) with binary elements. More...
|
class | BinaryDilateImageFilter |
| Binary dilation of an image. More...
|
class | BinaryErodeImageFilter |
| Binary erosion of an image. More...
|
class | BinaryFunctorImageFilter |
| Implements pixel-wise generic operation of two images. More...
|
class | BinaryMagnitudeImageFilter |
| Implements pixel-wise the computation of square root of the sum of squares. More...
|
class | BinaryMask3DMeshSource |
class | BinaryMedianImageFilter |
| Applies an version of the median filter optimized for binary images. More...
|
class | BinaryMinMaxCurvatureFlowFunction |
class | BinaryMinMaxCurvatureFlowImageFilter |
| Denoise a binary image using min/max curvature flow. More...
|
class | BinaryThresholdImageFilter |
| Binarize an input image by thresholding. More...
|
class | BinaryThresholdImageFunction |
| Returns true is the value of an image lies within a range of thresholds This ImageFunction returns true (or false) if the pixel value lies within (outside) a lower and upper threshold value. The threshold range can be set with the ThresholdBelow, ThresholdBetween or ThresholdAbove methods. The input image is set via method SetInputImage(). More...
|
class | BinomialBlurImageFilter |
| Performs a separable blur on each dimension of an image. More...
|
class | BloxBoundaryPointImage |
| Templated n-dimensional image class used to store linked lists. More...
|
class | BloxBoundaryPointImageToBloxBoundaryProfileImageFilter |
| Converts a BloxImage of BloxBoundaryPoints to a BloxImage of BloxBoundaryProfiles. More...
|
class | BloxBoundaryPointItem |
| A boundary point, stored in a BloxPixel. More...
|
class | BloxBoundaryPointPixel |
| Holds a linked list of itk::BloxBoundaryPointItem's. More...
|
class | BloxBoundaryPointToCoreAtomImageFilter |
| Converts a gradient image to an BloxImage of BloxBoundaryPoints. More...
|
class | BloxBoundaryProfileImage |
| N-dimensional image class which handles BloxBoundaryProfileItems. More...
|
class | BloxBoundaryProfileItem |
class | BloxBoundaryProfilePixel |
class | BloxCoreAtomImage |
| N-dimensional image class which handles BloxCoreAtomItems. More...
|
class | BloxCoreAtomItem |
| A core atom object, stored in a BloxPixel. More...
|
class | BloxCoreAtomPixel |
| Holds a linked list of itk::BloxCoreAtomItem's. More...
|
class | BloxImage |
| Templated n-dimensional image class used to store linked lists. More...
|
class | BloxItem |
| An entry in the BloxPixel linked list. More...
|
class | BloxPixel |
| Holds a linked list of BloxItem's. More...
|
class | BluePixelAccessor |
| Give access to the Blue component of a RGBPixel type. More...
|
class | ConvertPixelBuffer |
| Class to convert blocks of data from one type to another. More...
|
class | DefaultConvertPixelTraits |
| Traits class used to by ConvertPixels to convert blocks of pixels. More...
|
class | DicomImageIO |
| Read DicomImage file format. More...
|
class | DicomImageIOFactory |
| Create instances of DicomImageIO objects using an object factory. More...
|
struct | GetDimension |
struct | ipl_dimensions |
class | GiplImageIO |
| Read GiplImage file format. More...
|
class | GiplImageIOFactory |
| Create instances of GiplImageIO objects using an object factory. More...
|
class | GradientDescentOptimizer |
| Implement a gradient descent optimizer. More...
|
class | ImageFileReader |
| Data source that reads image data from disk files. More...
|
class | ImageFileReaderException |
| Base exception class for IO conflicts. More...
|
class | ImageFileWriter |
| The base class for all image data writers. More...
|
class | ImageFileWriterException |
| Base exception class for IO problems during writing. More...
|
class | ImageIOBase |
| Abstract superclass defines image IO interface. More...
|
class | UnknownType |
class | ImageIOFactory |
| Create instances of ImageIO objects using an object factory. More...
|
class | ImageIORegion |
| An ImageIORegion represents a structured region of data. More...
|
class | ImageViewer |
| Simple implemementation of a GLUT based image viewer. More...
|
class | ImageViewerWindow |
| Simple implemementation of a GLUT controled window. More...
|
class | ImageWriter |
| Base class for all writers that write images. More...
|
class | LBFGSOptimizer |
| Wrap of the vnl_lbfgs algorithm. More...
|
class | LevenbergMarquardtOptimizer |
| Wrap of the vnl_levenberg_marquardt algorithm. More...
|
class | MetaImageIO |
| Read MetaImage file format. More...
|
class | MetaImageIOFactory |
| Create instances of MetaImageIO objects using an object factory. More...
|
class | MultipleValuedCostFunction |
| This class is a base for the CostFunctions returning a single value. More...
|
class | MultipleValuedNonLinearOptimizer |
| This class is a base for the Optimization methods that optimize a multiple valued function. More...
|
class | MultipleValuedNonLinearVnlOptimizer |
| This class is a base for the Optimization methods that optimize a single valued function. More...
|
class | MultipleValuedVnlCostFunctionAdaptor |
| This class is an Adaptor that allows to pass itk::MultipleValuedCostFunctions to vnl_optimizers expecting a vnl_cost_function. More...
|
class | MultivariateLegendrePolynomial |
class | NearestNeighborFinder |
| Templated K-nearest neighbor search algorithm. More...
|
struct | NeighborType |
class | NonLinearOptimizer |
| Wrap of the vnl_nonlinear_minimizer to be adapted. More...
|
class | OnePlusOneEvolutionaryOptimizer |
| 1+1 evolutionary strategy optimizer. More...
|
class | Optimizer |
| Generic representation for an optimization method. More...
|
class | PlaneSpatialObject |
class | PNGImageIO |
class | PNGImageIOFactory |
| Create instances of PNGImageIO objects using an object factory. More...
|
class | QuaternionRigidTransformGradientDescentOptimizer |
| Implement a gradient descent optimizer. More...
|
class | RawImageIO |
| Read and write raw binary images. More...
|
class | RawImageIOFactory |
class | RawImageWriter |
| Write an image (n-dimensional) in raw format. More...
|
class | SimpleForwardIterator |
class | RegularStepGradientDescentBaseOptimizer |
| Implement a gradient descent optimizer. More...
|
class | RegularStepGradientDescentOptimizer |
| Implement a gradient descent optimizer. More...
|
class | Scene |
| a Scene has a list of SpatialObjects. More...
|
class | SingleValuedCostFunction |
| This class is a base for the CostFunctions returning a single value. More...
|
class | SingleValuedNonLinearOptimizer |
| This class is a base for the Optimization methods that optimize a single valued function. More...
|
class | SingleValuedNonLinearVnlOptimizer |
| This class is a base for the Optimization methods that optimize a single valued function. More...
|
class | SingleValuedVnlCostFunctionAdaptor |
| This class is an Adaptor that allows to pass itk::SingleValuedCostFunctions to vnl_optimizers expecting a vnl_cost_function. More...
|
class | SpatialObject |
| Implementation of the composite pattern. More...
|
class | SpatialObjectPoint |
| Point used for spatial objets. More...
|
class | SpatialObjectProperty |
class | SurfaceSpatialObject |
| Representation of a Surface based on the spatial object classes. More...
|
class | SurfaceSpatialObjectPoint |
| Point used for a Surface definition. More...
|
class | SymmetricEigenSystem |
| wrapper of the vnl_symmetric_eigensystem algorithm. More...
|
class | TargetClass |
class | TubeSpatialObject |
| Representation of a tube based on the spatial object classes. More...
|
class | TubeSpatialObjectPoint |
| Point used for a tube definition. More...
|
class | ConstIterator |
class | Iterator |
struct | Iterator |
class | JoinTraits |
| Trait to determine what datatype is needed if the specified pixel types are "joined" into a single vector. More...
|
class | JoinTraits< bool, bool > |
class | JoinTraits< bool, char > |
class | JoinTraits< bool, double > |
class | JoinTraits< bool, float > |
class | JoinTraits< bool, int > |
class | JoinTraits< bool, long > |
class | JoinTraits< bool, short > |
class | JoinTraits< bool, unsigned char > |
class | JoinTraits< bool, unsigned int > |
class | JoinTraits< bool, unsigned long > |
class | JoinTraits< bool, unsigned short > |
class | JoinTraits< char, bool > |
class | JoinTraits< char, char > |
class | JoinTraits< char, double > |
class | JoinTraits< char, float > |
class | JoinTraits< char, int > |
class | JoinTraits< char, long > |
class | JoinTraits< char, short > |
class | JoinTraits< char, unsigned char > |
class | JoinTraits< char, unsigned int > |
class | JoinTraits< char, unsigned long > |
class | JoinTraits< char, unsigned short > |
class | JoinTraits< double, bool > |
class | JoinTraits< double, char > |
class | JoinTraits< double, double > |
class | JoinTraits< double, float > |
class | JoinTraits< double, int > |
class | JoinTraits< double, long > |
class | JoinTraits< double, short > |
class | JoinTraits< double, unsigned char > |
class | JoinTraits< double, unsigned int > |
class | JoinTraits< double, unsigned long > |
class | JoinTraits< double, unsigned short > |
class | JoinTraits< float, bool > |
class | JoinTraits< float, char > |
class | JoinTraits< float, double > |
class | JoinTraits< float, float > |
class | JoinTraits< float, int > |
class | JoinTraits< float, long > |
class | JoinTraits< float, short > |
class | JoinTraits< float, unsigned char > |
class | JoinTraits< float, unsigned int > |
class | JoinTraits< float, unsigned long > |
class | JoinTraits< float, unsigned short > |
class | JoinTraits< int, bool > |
class | JoinTraits< int, char > |
class | JoinTraits< int, double > |
class | JoinTraits< int, float > |
class | JoinTraits< int, int > |
class | JoinTraits< int, long > |
class | JoinTraits< int, short > |
class | JoinTraits< int, unsigned char > |
class | JoinTraits< int, unsigned int > |
class | JoinTraits< int, unsigned long > |
class | JoinTraits< int, unsigned short > |
class | JoinTraits< long, bool > |
class | JoinTraits< long, char > |
class | JoinTraits< long, double > |
class | JoinTraits< long, float > |
class | JoinTraits< long, int > |
class | JoinTraits< long, long > |
class | JoinTraits< long, short > |
class | JoinTraits< long, unsigned char > |
class | JoinTraits< long, unsigned int > |
class | JoinTraits< long, unsigned long > |
class | JoinTraits< long, unsigned short > |
class | JoinTraits< short, bool > |
class | JoinTraits< short, char > |
class | JoinTraits< short, double > |
class | JoinTraits< short, float > |
class | JoinTraits< short, int > |
class | JoinTraits< short, long > |
class | JoinTraits< short, short > |
class | JoinTraits< short, unsigned char > |
class | JoinTraits< short, unsigned int > |
class | JoinTraits< short, unsigned long > |
class | JoinTraits< short, unsigned short > |
class | JoinTraits< unsigned char, bool > |
class | JoinTraits< unsigned char, char > |
class | JoinTraits< unsigned char, double > |
class | JoinTraits< unsigned char, float > |
class | JoinTraits< unsigned char, int > |
class | JoinTraits< unsigned char, long > |
class | JoinTraits< unsigned char, short > |
class | JoinTraits< unsigned char, unsigned char > |
class | JoinTraits< unsigned char, unsigned int > |
class | JoinTraits< unsigned char, unsigned long > |
class | JoinTraits< unsigned char, unsigned short > |
class | JoinTraits< unsigned int, bool > |
class | JoinTraits< unsigned int, char > |
class | JoinTraits< unsigned int, double > |
class | JoinTraits< unsigned int, float > |
class | JoinTraits< unsigned int, int > |
class | JoinTraits< unsigned int, long > |
class | JoinTraits< unsigned int, short > |
class | JoinTraits< unsigned int, unsigned char > |
class | JoinTraits< unsigned int, unsigned int > |
class | JoinTraits< unsigned int, unsigned long > |
class | JoinTraits< unsigned int, unsigned short > |
class | JoinTraits< unsigned long, bool > |
class | JoinTraits< unsigned long, char > |
class | JoinTraits< unsigned long, double > |
class | JoinTraits< unsigned long, float > |
class | JoinTraits< unsigned long, int > |
class | JoinTraits< unsigned long, long > |
class | JoinTraits< unsigned long, short > |
class | JoinTraits< unsigned long, unsigned char > |
class | JoinTraits< unsigned long, unsigned int > |
class | JoinTraits< unsigned long, unsigned long > |
class | JoinTraits< unsigned long, unsigned short > |
class | JoinTraits< unsigned short, bool > |
class | JoinTraits< unsigned short, char > |
class | JoinTraits< unsigned short, double > |
class | JoinTraits< unsigned short, float > |
class | JoinTraits< unsigned short, int > |
class | JoinTraits< unsigned short, long > |
class | JoinTraits< unsigned short, short > |
class | JoinTraits< unsigned short, unsigned char > |
class | JoinTraits< unsigned short, unsigned int > |
class | JoinTraits< unsigned short, unsigned long > |
class | JoinTraits< unsigned short, unsigned short > |
struct | MemoryBlock |
class | BoundaryAssignmentIdentifier |
class | BoundingBox |
| Represent and compute information about bounding boxes. More...
|
class | BSplineCenteredL2ResampleImageFilterBase |
class | BSplineCenteredResampleImageFilterBase |
| Evaluates the Centered B-Spline interpolation of an image. Spline order may be from 0 to 5. More...
|
class | BSplineDecompositionImageFilter |
class | BSplineDeformableTransform |
| Deformable transform using a BSpline representation. More...
|
class | BSplineDerivativeKernelFunction |
| Derivative of a BSpline kernel used for density estimation and nonparameteric regression. More...
|
class | BSplineDownsampleImageFilter |
| Down-samples an image by a factor of 2 using B-Spline filter interpolation. More...
|
class | BSplineInterpolateImageFunction |
| Evaluates the B-Spline interpolation of an image. Spline order may be from 0 to 5. More...
|
class | BSplineInterpolationWeightFunction |
| Returns the weights over the support region used for B-spline interpolation/reconstruction. More...
|
class | BSplineKernelFunction |
| BSpline kernel used for density estimation and nonparameteric regression. More...
|
class | BSplineL2ResampleImageFilterBase |
| Uses the "Centered l2" B-Spline pyramid implementation of B-Spline Filters to up/down sample an image by a factor of 2. More...
|
class | BSplineResampleImageFilterBase |
| Uses the "l2" spline pyramid implementation of B-Spline Filters to up/down sample an image by a factor of 2. More...
|
class | BSplineResampleImageFunction |
| Resample image intensity from a BSpline coefficient image. More...
|
class | BSplineUpsampleImageFilter |
class | BSplineUpsampleImageFilterBase |
| Uses B-Spline interpolation to upsample an image by a factor of 2. This class is the public interface for spline upsampling as defined by the ResamplerType. More...
|
class | ByteSwapper |
| Perform machine dependent byte swapping. More...
|
class | CannyEdgeDetectionImageFilter |
class | CannySegmentationLevelSetFunction |
class | CannySegmentationLevelSetImageFilter |
| Segments structures in images based on image features derived from pseudo-canny-edges. More...
|
struct | CannyThreadStruct |
class | CastImageFilter |
| Casts input pixels to output pixel type. More...
|
class | CellBoundary |
| Wrap an ITK cell so that it behaves like a boundary cell. More...
|
class | CellInterface |
class | CellInterfaceVisitor |
class | CellInterfaceVisitorImplementation |
class | CellTraitsInfo |
| A simple utility class to define the cell type inside a mesh type structure definition. This just makes a copy of existing type information that is needed for a cell type template parameter. More...
|
class | CenteredAffineTransform |
| Affine transformation with a specified center of rotation. More...
|
class | CenteredRigid2DTransform |
| CenteredRigid2DTransform of a vector space (e.g. space coordinates). More...
|
class | CenteredTransformInitializer |
| CenteredTransformInitializer is a helper class intended to initialize the center of rotation and the translation of Transforms having the center of rotation among their parameters. More...
|
class | CentralDifferenceImageFunction |
| Calculate the derivative by central differencing. More...
|
class | ChangeInformationImageFilter |
| Change the origin, spacing and/or region of an Image. More...
|
class | ClassifierBase |
| Base class for classifier object. More...
|
class | ColorTable |
class | Command |
| superclass for callback/observer methods. More...
|
class | ComposeRGBImageFilter |
class | ConditionalConstIterator |
| ConditionalConstIterator is a base class for other iterators where membership in the set of output pixels is "conditional" upon some property, calculation, etc. For example, a threshold iterator might walk a region and return only those pixels which meet a minimum intensity condition. More...
|
class | ConditionalIterator |
| ConditionalIterator is a base class for other iterators where membership in the set of output pixels is "conditional" upon some property, calculation, etc. For example, a threshold iterator might walk a region and return only those pixels which meet a minimum intensity condition. More...
|
class | ConfidenceConnectedImageFilter |
class | ConicShellInteriorExteriorSpatialFunction |
| Spatial function implementation of a conic shell. More...
|
class | ConnectedRegionsMeshFilter |
| Extract portions of a mesh that are connected at vertices. More...
|
class | ConnectedThresholdImageFilter |
| Label pixels that are connected to a seed and lie within a range of values. More...
|
class | ConstantBoundaryCondition |
| This boundary condition returns a constant value for out-of-bounds image pixels. More...
|
class | ConstantPadImageFilter |
| Increase the image size by padding with a constant value. More...
|
class | ConstIterator |
| The const iterator type for the map. More...
|
class | Iterator |
| The non-const iterator type for the map. More...
|
struct | GlobalDataStruct |
class | ConstIterator |
class | ConstReverseIterator |
| A const reverse iterator through the array. More...
|
struct | ConstIterator |
class | ConstNeighborhoodIterator |
| Const version of NeighborhoodIterator, defining iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
|
class | ConstRandomAccessNeighborhoodIterator |
| Const version of RandomAccessNeighborhoodIterator, defining iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
|
class | ConstShapedNeighborhoodIterator |
| Const version of ShapedNeighborhoodIterator, defining iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
|
class | ConstSliceIterator |
| A flexible iterator for itk containers(i.e. itk::Neighborhood) that support pixel access through operator[]. More...
|
class | ConstSmartNeighborhoodIterator |
| Const version of SmartNeighborhoodIterator, defining iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
|
class | ConstSparseFieldLayerIterator |
class | ContinuousIndex |
| A templated class holding a point in n-Dimensional image space. More...
|
class | CosImageAdaptor |
| Presents an image as being composed of the cos() of its pixels. More...
|
class | CosImageFilter |
| Computes the cos(x) pixel-wise. More...
|
class | CovariantVector |
| A templated class holding a n-Dimensional covariant vector. More...
|
class | CreateObjectFunction |
| CreateObjectFunction is used to create callback functions that create ITK Objects for use with the itk::ObjectFactory. More...
|
class | CreateObjectFunctionBase |
| Define API for object creation callback functions. More...
|
class | CropImageFilter |
| Decrease the image size by cropping the image by an itk::Size at both the upper and lower bounds of the largest possible region. More...
|
class | CStyleCommand |
| Command subclass that calls a pointer to a C function. More...
|
class | CurvatureAnisotropicDiffusionImageFilter |
class | CurvatureFlowFunction |
struct | GlobalDataStruct |
class | CurvatureFlowImageFilter |
| Denoise an image using curvature driven flow. More...
|
class | CurvatureNDAnisotropicDiffusionFunction |
class | DanielssonDistanceMapImageFilter |
class | DataObject |
| Base class for all data objects in ITK. More...
|
class | DataObjectError |
| Exception object for DataObject exceptions. More...
|
class | DecisionRuleBase |
| Base class that allows the setting of usage of differnt decision rules used in classification This class has the pure virtual function, Evaluate(). Therefore, any subclass should implement the function to be instantiated. More...
|
class | DefaultDynamicMeshTraits |
class | DefaultImageTraits |
class | DefaultPixelAccessor |
| Give access to partial aspects a type. More...
|
class | DefaultStaticMeshTraits |
class | DeformableMesh3D |
class | DeformableMesh3DFilter |
class | DeformableMeshFilter |
class | DemonsRegistrationFilter |
| Deformably register two images using the demons algorithm. More...
|
class | DemonsRegistrationFunction |
struct | GlobalDataStruct |
class | DIS |
struct | DenseFDThreadStruct |
class | DenseFiniteDifferenceImageFilter |
class | DerivativeImageFilter |
| Computes the directional derivative of an image. The directional derivative at each pixel location is computed by convolution with a first-order derivative operator. More...
|
class | DerivativeOperator |
| A NeighborhoodOperator for taking an n-th order derivative at a pixel. More...
|
class | DifferenceImageFilter |
| Implements pixel-wise comparison of two images. More...
|
class | DifferenceOfGaussiansGradientImageFilter |
| Performs difference-of-gaussians gradient detection. More...
|
class | DilateObjectMorphologyImageFilter |
| dilation of an object in an image. More...
|
class | DirectedHausdorffDistanceImageFilter |
| Computes the directed Hausdorff distance between the set of non-zero pixels of two images. More...
|
class | Directory |
| Portable directory/filename traversal. More...
|
class | DiscreteGaussianImageFilter |
| Blurs an image by separable convolution with discrete gaussian kernels. This filter performs Gaussian blurring by separable convolution of an image and a discrete Gaussian operator (kernel). More...
|
struct | DispatchBase |
struct | Dispatch |
class | DivideImageFilter |
| Implements an operator for pixel-wise division of two images. More...
|
class | DynamicLoader |
| Portable loading of dynamic libraries or dll's. More...
|
class | EdgePotentialImageFilter |
| Computes the edge potential of an image from the image gradient. More...
|
class | EigenAnalysis2DImageFilter |
class | ElasticBodyReciprocalSplineKernelTransform |
class | ElasticBodySplineKernelTransform |
class | EllipsoidInteriorExteriorSpatialFunction |
class | EllipsoidSpatialFunction |
| Function implementation of an ellipsoid. More...
|
class | ErodeObjectMorphologyImageFilter |
| Erosion of an object in an image. More...
|
class | Euler2DTransform |
| Euler2DTransform of a vector space (e.g. space coordinates). More...
|
class | Euler3DTransform |
| Euler3DTransform of a vector space (e.g. space coordinates). More...
|
class | EventObject |
| Abstraction of the Events used to communicating among filters and with GUIs. More...
|
class | ExceptionObject |
| Standard exception handling object. More...
|
class | ExpandImageFilter |
| Expand the size of an image by an integer factor in each dimension. More...
|
class | ExpImageAdaptor |
| Presents an image as being composed of the exp() of its pixels. More...
|
class | ExpImageFilter |
| Computes the exp(x) pixel-wise. More...
|
class | ExpNegativeImageAdaptor |
| Presents an image as being composed of the exp() of its pixels. More...
|
class | ExpNegativeImageFilter |
| Computes the function exp(-K.x) pixel-wise. More...
|
class | ExtractImageFilter |
| Decrease the image size by cropping the image to the selected region bounds. More...
|
class | FastMutexLock |
| Critical section locking class. More...
|
class | FileOutputWindow |
| Messages sent from the system are sent to a file. More...
|
class | FiniteDifferenceFunction |
class | FiniteDifferenceImageFilter |
class | FixedArray |
| Simulate a standard C array with copy semnatics. More...
|
class | FlipImageFilter |
| Flips an image across user specified axes. More...
|
class | FloodFilledFunctionConditionalConstIterator |
| Iterates over a flood-filled spatial function. More...
|
class | FloodFilledFunctionConditionalIterator |
| Base class for non-const flood-filled function iterators. More...
|
class | FloodFilledImageFunctionConditionalConstIterator |
| Iterates over a flood-filled image function. More...
|
class | FloodFilledImageFunctionConditionalIterator |
| Iterates over a flood-filled image function. More...
|
class | FloodFilledSpatialFunctionConditionalConstIterator |
| Iterates over a flood-filled spatial function. More...
|
class | FloodFilledSpatialFunctionConditionalIterator |
| Iterates over a flood-filled spatial function. More...
|
class | ForwardDifferenceOperator |
| Operator whose inner product with a neighborhood returns a "half" derivative at the center of the neighborhood. More...
|
class | FrustumSpatialFunction |
| Spatial function implementation of a truncated pyramid. More...
|
class | FunctionBase |
| Base class for all ITK function objects. More...
|
class | GaussianImageSource |
| Generate an n-dimensional image of a Gaussian. More...
|
class | GaussianKernelFunction |
| Gaussian kernel used for density estimation and nonparameteric regression. More...
|
class | GaussianOperator |
| A NeighborhoodOperator whose coefficients are a one dimensional, discrete Gaussian kernel. More...
|
class | GaussianSpatialFunction |
| N-dimensional gaussian spatial function class. More...
|
struct | GetImageDimension |
struct | GetVectorDimension |
class | GradientAnisotropicDiffusionImageFilter |
class | GradientImageFilter |
| Computes the gradient of an image using directional derivatives. More...
|
class | GradientImageToBloxBoundaryPointImageFilter |
| Converts a gradient image to an BloxImage of BloxBoundaryPoints. More...
|
class | GradientMagnitudeImageFilter |
| Computes the gradient magnitude of an image region at each pixel. More...
|
class | GradientMagnitudeRecursiveGaussianImageFilter |
| Computes the Magnitude of the Gradient of an image by convolution with the first derivative of a Gaussian. More...
|
class | GradientNDAnisotropicDiffusionFunction |
class | GradientRecursiveGaussianImageFilter |
| Computes the gradient of an image by convolution with the first derivative of a Gaussian. More...
|
class | GradientToMagnitudeImageFilter |
| Take an image of vectors as input and produce an image with the magnitude of those vectors. More...
|
class | GrayscaleDilateImageFilter |
| gray scale dilation of an image. More...
|
class | GrayscaleErodeImageFilter |
| gray scale dilation of an image. More...
|
class | GrayscaleFunctionDilateImageFilter |
| gray scale function dilation of an image. More...
|
class | GrayscaleFunctionErodeImageFilter |
| gray scale function erosion of an image. More...
|
class | GreenPixelAccessor |
| Give access to the Green component of a RGBPixel type. More...
|
struct | hash |
struct | hash< char * > |
struct | hash< char > |
struct | hash< const char * > |
struct | hash< int > |
struct | hash< long > |
struct | hash< short > |
struct | hash< signed char > |
struct | hash< unsigned char > |
struct | hash< unsigned int > |
struct | hash< unsigned long > |
struct | hash< unsigned short > |
class | hash_map |
| Replacement for STL hash map because some systems do not support it, or support it incorrectly. More...
|
class | hash_multimap |
class | hash_multiset |
class | hash_set |
| Replacement for STL hash set because some systems do not support it, or support it incorrectly. More...
|
class | hashtable |
class | hashtable_base |
struct | hashtable_const_iterator |
struct | hashtable_iterator |
struct | hashtable_node |
class | HausdorffDistanceImageFilter |
| Computes the Hausdorff distance between the set of non-zero pixels of two images. More...
|
class | HexahedronBoundary |
class | HexahedronCell |
class | HexahedronCellTopology |
class | IdentityTransform |
| Implementation of an Identity Transform. More...
|
class | Image |
| Templated n-dimensional image class. More...
|
class | ImageAdaptor |
| Give access to partial aspects of voxels from an Image. More...
|
class | ImageBase |
| Base class for templated image classes. More...
|
class | ImageBoundaryCondition |
| A virtual base object that defines an interface to a class of boundary condition objects for use by neighborhood iterators. More...
|
class | ImageConstIterator |
| Multi-dimensional image iterator. More...
|
class | ImageConstIteratorWithIndex |
| Multi-dimensional image iterator. More...
|
class | ImageContainerInterface |
class | ImageFunction |
| Evaluates a function of an image at specified position. More...
|
class | ImageIO |
class | ImageIterator |
| Multi-dimensional image iterator. More...
|
class | ImageIteratorWithIndex |
| Multi-dimensional image iterator. More...
|
class | ImageLinearConstIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageLinearIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRandomConstIteratorWithIndex |
| Multi-dimensional image iterator which walks randomly within a region. More...
|
class | ImageRandomIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegion |
| An image region represents a structured region of data. More...
|
class | ImageRegionConstIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionConstIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionExclusionConstIteratorWithIndex |
| Multi-dimensional image iterator which walks a region excluding a second region completly contained in the first. More...
|
class | ImageRegionExclusionIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionMultidimensionalSplitter |
| Divide a region into several pieces. More...
|
class | ImageRegionReverseConstIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionReverseIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageRegionSplitter |
| Divide a region into several pieces. More...
|
class | ImageReverseConstIterator |
| Multi-dimensional image iterator. More...
|
class | ImageReverseIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageSliceConstIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageSliceIteratorWithIndex |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ImageSource |
| Base class for all process objects that output image data. More...
|
class | ImageToImageFilter |
| Base class for filters that take an image as input and produce an image as output. More...
|
class | ImageToMeshFilter |
class | ImageToParametricSpaceFilter |
| Generate a mesh of parametric space from input images. More...
|
class | ImportImageContainer |
class | ImportImageFilter |
| Import data from a standard C array into an itk::Image. More...
|
class | IncompatibleOperandsError |
class | Indent |
| Control indentation during Print() invocation. More...
|
class | Index |
| Represent a n-dimensional index in a n-dimensional image. More...
|
class | IndexedContainerInterface |
class | InteriorExteriorMeshFilter |
class | InteriorExteriorSpatialFunction |
| Returns whether or not a location is "inside" or "outside" a function. More...
|
class | InterpolateImageFilter |
| Interpolate an image from two N-D images. More...
|
class | InterpolateImageFunction |
| Base class for all image interpolaters. More...
|
class | InterpolateImagePointsFilter |
| Resamples an image at the coordinates specified by the user. More...
|
class | InvalidArgumentError |
class | InvalidRequestedRegionError |
class | IsolatedConnectedImageFilter |
| Label pixels that are connected to one seed but not another. More...
|
class | Iterator |
class | IterationReporter |
| Implements iterations tracking for a filter. More...
|
class | itkBSplineCenteredL2ResampleImageFilterBase |
| Uses the "Centered L2" B-Spline pyramid implementation of B-Spline Filters to up/down sample an image by a factor of 2. More...
|
class | itkBSplineDecompositionImageFilter |
| Calculates the B-Spline coefficients of an image. Spline order may be from 0 to 5. More...
|
class | itkSparseFieldLayer |
class | JoinImageFilter |
| Join two images, resulting in an image where each pixel has the components of the first image followed by the components of the second image. More...
|
class | KernelFunction |
| Kernel used for density estimation and nonparameteric regression. More...
|
class | KernelTransform |
class | KLMDynamicBorderArray |
| Object maintaining a reference to a list of border associated with a region. More...
|
class | KLMSegmentationBorder |
| Base class for KLMSegmentationBorder object. More...
|
class | KLMSegmentationRegion |
| Base class for KLMSegmentationRegion object. More...
|
class | LaplacianImageFilter |
class | LaplacianOperator |
class | LevelSetFunction |
| The LevelSetFunction class is a generic function object which can be used to create a level set method filter when combined with an appropriate finite difference image filter. (See FiniteDifferenceImageFilter.). More...
|
class | LevelSetFunctionBase |
class | LevelSetNode |
| Represent a node in a level set. More...
|
class | LevelSetTypeDefault |
| Level set type information. More...
|
class | LightObject |
| Light weight base class for most itk classes. More...
|
class | LightProcessObject |
| LightProcessObject is the base class for all process objects (source, filters, mappers) in the Insight data processing pipeline. More...
|
class | LinearInterpolateImageFunction |
| Linearly interpolate an image at specified positions. More...
|
class | LineBoundary |
class | LineCell |
class | Log10ImageAdaptor |
| Presents an image as being composed of the log10() of its pixels. More...
|
class | Log10ImageFilter |
| Computes the log10(x) pixel-wise. More...
|
class | LogImageAdaptor |
| Presents an image as being composed of the log() of its pixels. More...
|
class | LogImageFilter |
| Computes the log(x) pixel-wise. More...
|
class | MapContainer |
class | MaskImageFilter |
| Implements an operator for pixel-wise masking of the input image with the mask. More...
|
class | Matrix |
| A templated class holding a M x N size Matrix This class contains a vnl_matrix_fixed in order to make all the vnl mathematical methods available. More...
|
class | MaximumDecisionRule |
| A Decision rule that choose the class that has maximum value. More...
|
class | MaximumImageFilter |
| Implements a pixel-wise operator Max(a, b) between two images. More...
|
class | MeanImageFilter |
| Applies an averaging filter to an image. More...
|
class | MeanImageFunction |
| Calculate the mean value in the neighborhood of a pixel. More...
|
class | MedianImageFilter |
| Applies a median filter to an image. More...
|
class | MedianImageFunction |
| Calculate the median value in the neighborhood of a pixel. More...
|
class | MemberCommand |
| Command subclass that calls a pointer to a member function. More...
|
class | Mesh |
| Implements the N-dimensional mesh structure. More...
|
class | MeshRegion |
| A mesh region represents an unstructured region of data. More...
|
class | MeshSource |
| Base class for all process objects that output mesh data. More...
|
class | MeshToMeshFilter |
class | MinimumDecisionRule |
| A Decision rule that choose the class that has minimum value. More...
|
class | MinimumImageFilter |
| Implements a pixel-wise operator Max(a, b) between two images. More...
|
class | MinimumMaximumImageCalculator |
class | MinimumMaximumImageFilter |
| Computes the minimum and the maximum intensity values of an image. More...
|
class | MirrorPadImageFilter |
| Increase the image size by padding with replicants of the input image value. More...
|
class | MorphologyImageFilter |
| Base class for the morphological operations such as erosion and dialation. More...
|
class | MultiplyImageFilter |
| Implements an operator for pixel-wise multiplication of two images. More...
|
class | MultiVisitor |
| A visitor that can visit different cell types in a mesh. CellInterfaceVisitor instances can be registered for each type of cell that needs to be visited. More...
|
class | MultiThreader |
| A class for performing multithreaded execution. More...
|
class | MutexLock |
| Mutual exclusion locking class. More...
|
class | MutexLockHolder |
class | NaryAddImageFilter |
| Implements an operator for pixel-wise addition of two images. More...
|
class | NaryFunctorImageFilter |
| Implements pixel-wise generic operation of Nth similar images. More...
|
class | NearestNeighborInterpolateImageFunction |
| Nearest neighbor interpolation of a scalar image. More...
|
class | Neighborhood |
| A light-weight container object for storing an N-dimensional neighborhood of values. More...
|
class | NeighborhoodAllocator |
class | NeighborhoodBinaryThresholdImageFunction |
| Determine whether all the pixels in the specified neighborhood meet a threshold criteria. More...
|
class | NeighborhoodConnectedImageFilter |
| Label pixels that are connected to a seed and lie within a neighborhood. More...
|
class | NeighborhoodInnerProduct |
class | NeighborhoodIterator |
| Defines iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
|
class | NeighborhoodOperator |
| Virtual class that defines a common interface to all neighborhood operator subtypes. More...
|
class | NeighborhoodOperatorImageFilter |
| Applies a single NeighborhoodOperator to an image region. More...
|
class | NonThreadedShrinkImageFilter |
| Reduce the size of an image by an integer factor. More...
|
class | NormalizeImageFilter |
| Normalize an image by setting its mean to zero and variance to one. More...
|
class | NthElementImageAdaptor |
| Presents an image as being composed of the N-th element of its pixels. More...
|
class | NthElementPixelAccessor |
| Give access to the N-th of a Container type. More...
|
class | NumericTraits |
| Define additional traits for native types such as int or float. More...
|
class | NumericTraits< bool > |
| Define traits for type bool. More...
|
class | NumericTraits< char > |
| Define traits for type char. More...
|
class | NumericTraits< double > |
| Define traits for type double. More...
|
class | NumericTraits< float > |
| Define traits for type float. More...
|
class | NumericTraits< int > |
| Define traits for type int. More...
|
class | NumericTraits< long > |
| Define traits for type long. More...
|
class | NumericTraits< long double > |
| Define traits for type long double. More...
|
class | NumericTraits< short > |
| Define traits for type short. More...
|
class | NumericTraits< unsigned char > |
| Define traits for type unsigned char. More...
|
class | NumericTraits< unsigned int > |
| Define traits for type unsigned int. More...
|
class | NumericTraits< unsigned long > |
| Define traits for type unsigned long. More...
|
class | NumericTraits< unsigned short > |
| Define traits for type unsigned short. More...
|
class | Object |
| Base class for most itk classes. More...
|
class | ObjectFactory |
| Create instances of a class. More...
|
class | ObjectFactoryBase |
| Create instances of classes using an object factory. More...
|
class | ObjectMorphologyImageFilter |
| Base class for the morphological operations being applied to isolated objects in an image. More...
|
class | ObjectStore |
| A specialized memory management object for allocating and destroying contiguous blocks of objects. More...
|
class | Offset |
| Represent the offset between two n-dimensional indexes in a n-dimensional image. More...
|
class | OStringStream |
class | OutputWindow |
| Messages sent from the system are collected by this object. More...
|
class | OverrideInformation |
| Internal implementation class for ObjectFactorBase. More...
|
class | PadImageFilter |
| Increase the image size by padding. Superclass for filters that fill in extra pixels. More...
|
class | ParametricSpaceToImageSpaceMeshFilter |
class | PeriodicBoundaryCondition |
| A function object that determines values outside of image boundaries according to periodic (wrap-around) conditions. More...
|
class | PermuteAxesImageFilter |
| Permutes the image axes according to a user specified order. More...
|
class | PixelAccessor |
| Give access to partial aspects of a type. More...
|
class | PixelTraits |
| Traits for a pixel that define the dimension and component type. More...
|
class | PixelTraits< bool > |
class | PixelTraits< char > |
class | PixelTraits< double > |
class | PixelTraits< float > |
class | PixelTraits< int > |
class | PixelTraits< long > |
class | PixelTraits< short > |
class | PixelTraits< unsigned char > |
class | PixelTraits< unsigned int > |
class | PixelTraits< unsigned long > |
class | PixelTraits< unsigned short > |
class | PlaheImageFilter |
class | SquaredDistance |
class | Point |
| A templated class holding a geometric point in n-Dimensional space. More...
|
class | PointLocator |
| Accelerate geometric searches for points. More...
|
class | PointSet |
| A superclass of the N-dimensional mesh structure; supports point (geometric coordinate and attribute) definition. More...
|
class | PolygonBoundary |
class | PolygonCell |
class | ProcessObject |
| ProcessObject is the base class for all process objects (source, filters, mappers) in the Insight data processing pipeline. More...
|
class | ProgressReporter |
| Implements progress tracking for a filter. More...
|
class | QuadraticEdgeBoundary |
class | QuadraticEdgeCell |
class | QuadraticTriangleBoundary |
class | QuadraticTriangleCell |
class | QuadraticTriangleCellTopology |
class | QuadrilateralBoundary |
class | QuadrilateralCell |
class | QuadrilateralCellTopology |
class | QuaternionRigidTransform |
| QuaternionRigidTransform of a vector space (e.g. space coordinates). More...
|
class | RandomAccessNeighborhoodIterator |
| Extends the bi-directional NeighborhoodIterator to a random access iterator. More...
|
class | RandomImageSource |
| Generate an n-dimensional image of random pixel values. More...
|
class | RangeError |
class | ReceptorMemberCommand |
| Command subclass that calls a pointer to a member function. More...
|
class | RecursiveGaussianImageFilter |
| Base class for recursive convolution with Gaussian kernel. More...
|
class | RecursiveSeparableImageFilter |
| Base class for recursive convolution with a kernel. More...
|
class | RedPixelAccessor |
| Give access to the red component of a RGBPixel type. More...
|
class | ReflectImageFilter |
| Implements a Reflection of an image along a selected direction. More...
|
class | ReflectiveImageRegionConstIterator |
class | ReflectiveImageRegionIterator |
| Multi-dimensional image iterator which only walks a region. More...
|
class | ReverseIterator |
| A reverse iterator through the array. More...
|
class | Region |
| A region represents some portion or piece of data. More...
|
class | RGBAPixel |
| Represent Red, Green, Blue cand Alpha component for color images. More...
|
class | RGBPixel |
| Represent Red, Green and Blue component for color images. More...
|
class | RGBToVectorImageAdaptor |
| Presents an image of pixel type RGBPixel as being and image of Vectors. More...
|
class | Rigid2DTransform |
| Rigid2DTransform of a vector space (e.g. space coordinates). More...
|
class | Rigid3DPerspectiveTransform |
| Rigid3DTramsform of a vector space (e.g. space coordinates). More...
|
class | Rigid3DTransform |
| Rigid3DTransform of a vector space (e.g. space coordinates). More...
|
class | ScalarVector |
| A templated class holding bot scalar and vector values and responding to the GetScalar() and GetVector() methods. More...
|
class | ScaleTransform |
| Scale transformation of a vector space (e.g. space coordinates). More...
|
class | SegmentationBorder |
| Base class for SegmentationBorder object. More...
|
class | SegmentationLevelSetFunction |
class | SegmentationRegion |
| Base class for SegmentationRegion object. More...
|
class | ShapedNeighborhoodIterator |
| A neighborhood iterator which can take on an arbitrary shape. More...
|
class | Similarity2DTransform |
| Similarity2DTransform of a vector space (e.g. space coordinates). More...
|
class | SimpleConstMemberCommand |
| Command subclass that calls a pointer to a member function. More...
|
class | SimpleFastMutexLock |
| Critical section locking class that can be allocated on the stack. More...
|
class | SimpleMemberCommand |
| Command subclass that calls a pointer to a member function. More...
|
class | SimpleMutexLock |
| Simple mutual exclusion locking class. More...
|
class | SinImageAdaptor |
| Presents an image as being composed of the sin() of its pixels. More...
|
class | Size |
| Represent the size (bounds) of a n-dimensional image. More...
|
class | SliceIterator |
| A flexible iterator for itk containers(i.e. itk::Neighborhood) that support pixel access through operator[]. More...
|
class | SmartNeighborhoodIterator |
| An extension of NeighborhoodIterator that automatically performs bounds checking on the image and returns user-supplied boundary conditions for out-of-bounds pixels. More...
|
class | SmartPointer |
| Implements transparent reference counting. More...
|
class | SmartPointerForwardReference |
| Implements transparent reference counting in situations where forward references / cyclic include depndencies are a problem. More...
|
class | SobelOperator |
| A NeighborhoodOperator for doing Sobel operation at a pixel. More...
|
class | SparseFieldCityBlockNeighborList |
| A convenience class for storing indicies which reference neighbor pixels within a neighborhood. More...
|
struct | RegionType |
class | ResampleImageFilter |
| Resample an image via a coordinate transform. More...
|
class | RescaleIntensityImageFilter |
| Applies a linear transformation to the intensity levels of the input Image. More...
|
class | ScalarAnisotropicDiffusionFunction |
class | ScalarToArrayCastImageFilter |
| Casts input vector pixels to output vector pixel type. More...
|
class | ShiftScaleImageFilter |
| Shift and scale the pixels in an image. More...
|
class | ShrinkImageFilter |
| Reduce the size of an image by an integer factor in each dimension. More...
|
class | SigmoidImageFilter |
| Computes the sigmoid function pixel-wise. More...
|
class | SimilarityIndexImageFilter |
| Measures the similarity between the set of non-zero pixels of two images. More...
|
class | SinImageFilter |
| Computes the sin(x) pixel-wise. More...
|
class | SobelEdgeDetectionImageFilter |
| Implements the Sobel Edge Detection.The Sobel operator performs a 2D/ND spatial gradient measurement on an image and so emphasizes regions of high spatial gradient that correspond to edges. Typically it is used to find the approximate absolute gradient magnitude at each point in an input greyscale image. More...
|
class | SparseFieldLayer |
class | SparseFieldLayerIterator |
class | SparseFieldLevelSetImageFilter |
| This class implements a finite difference partial differential equation solver for evolving surfaces embedded in volumes as level-sets. More...
|
class | SparseFieldLevelSetNode |
class | SpatialFunction |
| N-dimensional spatial function class. More...
|
class | SpatialFunctionImageEvaluatorFilter |
| Evaluates a SpatialFunction onto a source image. More...
|
class | SpatialObjectToImageFilter |
| Base class for filters that take a SpatialObject as input and produce an image as output. By default, if the user does not specify the size of the output image, the maximum size of the object's bounding box is used. The spacing of the image is given by the spacing of the input Spatial object. More...
|
class | SphereSpatialFunction |
| Spatial function implementation of a sphere. More...
|
class | SqrtImageAdaptor |
| Presents an image as being composed of the sqrt() of its pixels. More...
|
class | SqrtImageFilter |
| Computes the sqrt(x) pixel-wise. More...
|
class | SquaredDifferenceImageFilter |
| Implements pixel-wise the computation of squared difference. More...
|
class | StatisticsImageFilter |
| Compute min. max, variance and mean of an Image. More...
|
class | STLConstContainerAdaptor |
class | STLContainerAdaptor |
class | StreamingImageFilter |
| Pipeline object to control data streaming for large data processing. More...
|
class | SubtractImageFilter |
| Implements an operator for pixel-wise subtraction of two images. More...
|
class | SymmetricEllipsoidInteriorExteriorSpatialFunction |
class | TanImageAdaptor |
| Presents an image as being composed of the tan() of its pixels. More...
|
class | TanImageFilter |
| Computes the tan(x) pixel-wise. More...
|
class | TCell |
| Template parameter used to define superclass for CellBoundary. More...
|
class | TernaryAddImageFilter |
| Implements pixel-wise addition of three images. More...
|
class | TernaryFunctorImageFilter |
| Implements pixel-wise generic operation of three images. More...
|
class | TernaryMagnitudeImageFilter |
| Implements pixel-wise addition of three images. More...
|
class | TernaryMagnitudeSquaredImageFilter |
| Implements pixel-wise addition of three images. More...
|
struct | ThreadStruct |
struct | ThreadInfoStruct |
class | TetrahedronBoundary |
class | TetrahedronCell |
class | TetrahedronCellTopology |
class | TextOutput |
class | ThinPlateR2LogRSplineKernelTransform |
class | ThinPlateSplineKernelTransform |
class | ThresholdImageFilter |
| Set image values to a user-specified value if they are below, above, or between simple threshold values. More...
|
class | TimeProbe |
class | TimeProbesCollectorBase |
class | TimeStamp |
| Generate a unique, increasing time value. More...
|
class | TobogganImageFilter |
| toboggan image segmentation The Toboggan segmentation takes a gradient magnitude image as input and produces an (over-)segmentation of the image based on connecting each pixel to a local minimum of gradient. It is roughly equivalent to a watershed segmentation of the lowest level. More...
|
class | TorusInteriorExteriorSpatialFunction |
| Spatial function implementation of torus symmetric about the z-axis in 3D. More...
|
class | Transform |
| Transform points and vector from an input space to an output space. More...
|
class | TransformMeshFilter |
class | TranslationTransform |
| Translation transformation of a vector space (e.g. space coordinates). More...
|
class | TriangleBoundary |
class | TriangleCell |
class | TriangleCellTopology |
class | TwoOutputExampleImageFilter |
| Example of a filter that produce two outputs. More...
|
class | UnaryFunctorImageFilter |
| Implements pixel-wise generic operation on one image. More...
|
class | ValarrayImageContainer |
class | VarianceImageFunction |
| Calculate the variance in the neighborhood of a pixel. More...
|
class | Vector |
| A templated class holding a n-Dimensional vector. More...
|
class | VectorAnisotropicDiffusionFunction |
class | VectorCastImageFilter |
| Casts input vector pixels to output vector pixel type. More...
|
class | VectorContainer |
class | VectorCurvatureAnisotropicDiffusionImageFilter |
class | VectorCurvatureNDAnisotropicDiffusionFunction |
class | VectorExpandImageFilter |
| Expand the size of a vector image by an integer factor in each dimension. More...
|
class | VectorGradientAnisotropicDiffusionImageFilter |
class | VectorGradientMagnitudeImageFilter |
| Computes a scalar, gradient magnitude image from a multiple channel (pixels are vectors) input. More...
|
class | VectorGradientNDAnisotropicDiffusionFunction |
class | VectorIndexSelectionCastImageFilter |
| Extracts the selected index of the vector that is the input pixel type. More...
|
class | VectorInterpolateImageFunction |
| Base class for all vector image interpolaters. More...
|
class | VectorLinearInterpolateImageFunction |
| Linearly interpolate a vector image at specified positions. More...
|
class | VectorNeighborhoodInnerProduct |
class | VectorNeighborhoodOperatorImageFilter |
| Applies a single scalar NeighborhoodOperator to an itk::Vector image region. More...
|
class | VectorToRGBImageAdaptor |
| Presents an image of pixel type Vector as being and image of RGBPixel type. More...
|
class | Version |
| Track the current version of the software. More...
|
class | Versor |
| A templated class holding a unit quaternion. More...
|
class | VersorRigid3DTransform |
| VersorRigid3DTransform of a vector space (e.g. space coordinates). More...
|
class | VersorTransform |
class | VersorTransformOptimizer |
| Implement a gradient descent optimizer. More...
|
class | VertexBoundary |
class | VertexCell |
class | VOLImageIO |
| Read and write .VOL 3D ultrasound images. More...
|
class | VOLImageIOFactory |
| Create instances of VOLImageIO objects using an object factory. More...
|
class | VolumeSplineKernelTransform |
class | FortuneHalfEdge |
class | FortuneEdge |
class | FortuneSite |
class | itkSphere |
struct | Dispatch |
struct | DispatchBase |
class | ExtensionVelocitiesImageFilter |
| Extend velocities smoothly from a particular level set. More...
|
class | FastMarchingExtensionImageFilter |
| Extend auxiliary variables smoothly using Fast Marching. More...
|
class | FastMarchingImageFilter |
| Solve an Eikonal equation using Fast Marching. More...
|
class | FixedImageSpatialSample |
class | GeodesicActiveContourLevelSetFunction |
| This function is used in GeodesicActiveContourLevelSetImageFilter to segment structures in images based on user supplied edge potential map. More...
|
class | GeodesicActiveContourLevelSetImageFilter |
| Segments structures in images based on user supplied edge potential map. More...
|
class | GibbsPriorFilter |
class | GradientVectorFlowImageFilter |
| This class computes a diffusion of the gradient vectors for graylevel or binary edge map derive from the image. It enlarges the capture range of the gradient force and make external force derived from the gradient work effectively in the framework of deformable model. More...
|
class | HistogramMatchingImageFilter |
| Normalize the grayscale values between two image by histogram matching. More...
|
class | HybridFilter |
| the filter try to combine the gibbs prior model and deformable model into a segmentation framework, the output of Gibbs Prior model will be automatically set as the input of deformable model. More...
|
class | ImageClassifierBase |
| Base class for ImageClassifierBase object. More...
|
class | ImageGaussianModelEstimator |
| Base class for ImageGaussianModelEstimator object. More...
|
class | ImageKmeansModelEstimator |
| Base class for ImageKmeansModelEstimator object. More...
|
class | ImageModelEstimatorBase |
| Base class for model estimation from images used for classification. More...
|
class | ImageMomentsCalculator |
| Compute moments of an n-dimensional image. More...
|
class | ImageRegistrationMethod |
| Base class for Image Registration Methods. More...
|
class | ImageToImageMetric |
| Computes similarity between regions of two images. More...
|
class | ImageToSpatialObjectMetric |
| Computes similarity between a moving spatial obejct and an Image to be registered. More...
|
class | ImageToSpatialObjectRegistrationMethod |
| Base class for Image Registration Methods. More...
|
class | itkBinaryMask3DSphereMesh |
class | KalmanLinearEstimator |
| Implement a linear recursive estimator. More...
|
class | KLMRegionGrowImageFilter |
| Base class for a region growing object that performs energy-based region growing for multiband images. More...
|
class | LaplacianSegmentationLevelSetFunction |
class | LaplacianSegmentationLevelSetImageFilter |
| Segments structures in images based on a second derivative image features. More...
|
class | LevelSetNeighborhoodExtractor |
| Locate pixels of a particular level set. More...
|
class | LevelSetVelocityNeighborhoodExtractor |
| Locate pixels of a particular level set. More...
|
class | MattesMutualInformationImageToImageMetric |
| Computes the mutual information between two images to be registered using the methof of Mattes et al. More...
|
class | MeanSquaresImageToImageMetric |
| Computes similarity between two objects to be registered. More...
|
class | MinMaxCurvatureFlowFunction |
class | MinMaxCurvatureFlowImageFilter |
| Denoise an image using min/max curvature flow. More...
|
class | MRASlabIdentifier |
| identifies slab in MR images comparing minimum intensity averages. More...
|
class | MRFImageFilter |
| Implementation of a labeller object that uses Markov Random Fields to classify pixels in an image data set. More...
|
class | MRIBiasEnergyFunction |
| a cost function for optimization. More...
|
class | MRIBiasFieldCorrectionFilter |
| corrects 3D MRI bias field. More...
|
class | MultiResolutionImageRegistrationMethod |
| Base class for multi-resolution image registration methods. More...
|
class | MultiResolutionPDEDeformableRegistration |
| Framework for perfoming multi-resolution PDE deformable registration. More...
|
class | MultiResolutionPyramidImageFilter |
| Framework for creating images in a multi-resolution pyramid. More...
|
class | MutualInformationImageToImageMetric |
| Computes the mutual information between two images to be registered. More...
|
class | SpatialSample |
class | NormalizedCorrelationImageToImageMetric |
| Computes similarity between two objects to be registered. More...
|
class | NormalizedCorrelationPointSetToImageMetric |
| Computes similarity between two objects to be registered. More...
|
class | OtsuThresholdImageCalculator |
| Computes the Otsu's threshold for an image. More...
|
class | PatternIntensityImageToImageMetric |
| Computes similarity between two objects to be registered. More...
|
class | PatternIntensityPointSetToImageMetric |
| Computes similarity between two objects to be registered. More...
|
class | PDEDeformableRegistrationFilter |
| Deformably register two images using a PDE algorithm. More...
|
class | PDEDeformableRegistrationFunction |
class | RecursiveMultiResolutionPyramidImageFilter |
| Creates a multi-resolution pyramid using a recursive implementation. More...
|
class | RegionGrowImageFilter |
| Base class for RegionGrowImageFilter object. More...
|
class | RegistrationMethod |
| Base class for Registration Methods. More...
|
class | ReinitializeLevelSetImageFilter |
| Reinitialize the level set to the signed distance function. More...
|
class | RGBGibbsPriorFilter |
class | SegmentationLevelSetImageFilter |
| A base class which defines the API for implementing a special class of image segmentation filters using level set methods. More...
|
class | ShapeDetectionLevelSetFunction |
| This function is used in ShapeDetectionLevelSetImageFilter to segment structures in images based on user supplied edge potential map. More...
|
class | ShapeDetectionLevelSetImageFilter |
| Segments structures in images based on user supplied edge potential map. More...
|
class | SimpleFuzzyConnectednessScalarImageFilter |
class | SphereMeshSource |
class | ThresholdSegmentationLevelSetFunction |
| This function is used in ThresholdSegmentationLevelSetImageFilter to segment structures in images based on intensity values. More...
|
class | ThresholdSegmentationLevelSetImageFilter |
| Segments structures in images based on intensity values. More...
|
class | VectorFuzzyConnectednessImageFilter |
class | VoronoiDiagram2D |
| Implements the 2-Dimensional Voronoi Diagram. More...
|
class | VoronoiEdge |
class | VoronoiDiagram2DGenerator |
| Implement the Sweep Line Algorithm for the construction of the 2D Voronoi Diagram. More...
|
class | VoronoiPartitioningImageFilter |
class | VoronoiSegmentationImageFilter |
class | VoronoiSegmentationImageFilterBase |
class | VoronoiSegmentationRGBImageFilter |
class | VTKImageExport |
| Connect the end of an ITK image pipeline to a VTK pipeline. More...
|
class | VTKImageExportBase |
| Superclass for VTKImageExport instantiations. More...
|
class | VTKImageImport |
| Connect the end of an VTK pipeline to an ITK image pipeline. More...
|
class | VTKImageIO |
| ImageIO class for reading VTK images. More...
|
class | VTKImageIOFactory |
| Create instances of VTKImageIO objects using an object factory. More...
|
class | WarpImageFilter |
| Warps an image using an input deformation field. More...
|
class | WatershedImageFilter |
| A low-level image analysis algorithm that automatically produces a hierarchy of segmented, labeled images from a scalar-valued image input. More...
|
class | WatershedMiniPipelineProgressCommand |
class | WeakPointer |
| Implements a weak reference to an object. More...
|
class | Win32OutputWindow |
| Collect error and debug messages on Win32-based systems. More...
|
class | WrapPadImageFilter |
| Increase the image size by padding with replicants of the input image value. More...
|
class | Writer |
| The base class for all data writers. More...
|
class | XMLFileOutputWindow |
| Messages sent from the system are sent to a file with each message enclosed by XML tags. More...
|
class | ZeroCrossingBasedEdgeDetectionImageFilter |
class | ZeroCrossingImageFilter |
class | ZeroFluxNeumannBoundaryCondition |
| A function object that determines a neighborhood of values at an image boundary according to a Neumann boundary condition where first, upwind derivatives on the boundary are zero. This is a useful condition in solving some classes of differential equations. More...
|
[NOHEADER] |
template<typename TAutoPointerBase, typename TAutoPointerDerived> void ITK_EXPORT | TransferAutoPointer (TAutoPointerBase &pa, TAutoPointerDerived &pb) |
[NOHEADER] |
std::ostream & | operator<< (std::ostream &os, EventObject &e) |
[NOHEADER] |
| itkEventMacro (NoEvent, EventObject) |
| itkEventMacro (AnyEvent, EventObject) |
| itkEventMacro (DeleteEvent, AnyEvent) |
| itkEventMacro (StartEvent, AnyEvent) |
| itkEventMacro (EndEvent, AnyEvent) |
| itkEventMacro (ProgressEvent, AnyEvent) |
| itkEventMacro (ModifiedEvent, AnyEvent) |
| itkEventMacro (IterationEvent, AnyEvent) |
| itkEventMacro (StartPickEvent, PickEvent) |
| itkEventMacro (EndPickEvent, PickEvent) |
| itkEventMacro (AbortCheckEvent, PickEvent) |
[NOHEADER] |
std::ostream & | operator<< (std::ostream &os, ExceptionObject &e) |
Typedefs |
typedef void * | LibHandle |
typedef void(* | ThreadFunctionType )(void *) |
typedef int | ThreadProcessIDType |
typedef int | MutexType |
typedef int | FastMutexType |
Enumerations |
enum | { num_primes = 28
} |
enum | AtomicPixelType {
ITK_UCHAR,
ITK_CHAR,
ITK_USHORT,
ITK_SHORT,
ITK_UINT,
ITK_INT,
ITK_ULONG,
ITK_LONG,
ITK_FLOAT,
ITK_DOUBLE
} |
Functions |
template<class TSource, class TTarget> void | CopyAndConvertImage (const TSource *sourceInp, TTarget *targetInp, typename TTarget::RegionType requestedRegion) |
template<class Key, class T, class HashFcn, class EqualKey, class Alloc> bool | operator== (const hash_map< Key, T, HashFcn, EqualKey, Alloc > &hm1, const hash_map< Key, T, HashFcn, EqualKey, Alloc > &hm2) |
template<class Key, class T, class HashFcn, class EqualKey, class Alloc> bool | operator== (const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &hm1, const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &hm2) |
template<class Value, class HashFcn, class EqualKey, class Alloc> bool | operator== (const hash_set< Value, HashFcn, EqualKey, Alloc > &hs1, const hash_set< Value, HashFcn, EqualKey, Alloc > &hs2) |
template<class Value, class HashFcn, class EqualKey, class Alloc> bool | operator== (const hash_multiset< Value, HashFcn, EqualKey, Alloc > &hs1, const hash_multiset< Value, HashFcn, EqualKey, Alloc > &hs2) |
vcl_size_t | hash_string (const char *s) |
unsigned long | next_prime (unsigned long n) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> bool | operator== (hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc >const &, hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc >const &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> std::forward_iterator_tag | iterator_category (const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> Value * | value_type (const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> ptrdiff_t * | distance_type (const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> std::forward_iterator_tag | iterator_category (const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> Value * | value_type (const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> ptrdiff_t * | distance_type (const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &) |
template<class Value, class Key, class HashFcn, class ExtractKey, class EqualKey, class Alloc> IUEi_STL_INLINE bool | operator== (const hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &ht1, const hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &ht2) |
template<typename TValueType> std::ostream & | operator<< (std::ostream &os, const Array< TValueType > &arr) |
template<typename TValueType> std::ostream & | operator<< (std::ostream &os, const Array2D< TValueType > &arr) |
template<typename T> std::ostream & | operator<< (std::ostream &os, AutoPointer< T > p) |
template<class TImage> ConstNeighborhoodIterator<
TImage > | operator+ (const ConstNeighborhoodIterator< TImage > &it, const typename ConstNeighborhoodIterator< TImage >::OffsetType &ind) |
template<class TImage> ConstNeighborhoodIterator<
TImage > | operator+ (const typename ConstNeighborhoodIterator< TImage >::OffsetType &ind, const ConstNeighborhoodIterator< TImage > &it) |
template<class TImage> ConstNeighborhoodIterator<
TImage > | operator- (const ConstNeighborhoodIterator< TImage > &it, const typename ConstNeighborhoodIterator< TImage >::OffsetType &ind) |
| itkEventMacro (UserEvent, AnyEvent) |
template<typename TValueType, unsigned int VLength> std::ostream & | operator<< (std::ostream &os, const FixedArray< TValueType, VLength > &arr) |
std::string | AtomicPixelTypeToString (const AtomicPixelType pixelType) |
unsigned int | ComputeSizeOfAtomicPixelType (const AtomicPixelType pixelType) |
int | Strucmp (const char *s1, const char *s2) |
char * | ExtractFilePath (const char *fileName) |
char * | ExtractFileExtension (const char *fileName) |
char * | ExtractFileName (const char *fileName) |
template<unsigned int VImageDimension> std::ostream & | operator<< (std::ostream &os, const ImageRegion< VImageDimension > ®ion) |
template<unsigned int VIndexDimension> std::ostream & | operator<< (std::ostream &os, const Index< VIndexDimension > &ind) |
ITK_EXPORT void | OutputWindowDisplayText (const char *) |
ITK_EXPORT void | OutputWindowDisplayErrorText (const char *) |
ITK_EXPORT void | OutputWindowDisplayWarningText (const char *) |
ITK_EXPORT void | OutputWindowDisplayGenericOutputText (const char *) |
ITK_EXPORT void | OutputWindowDisplayDebugText (const char *) |
template<class T, unsigned int NRows, unsigned int NColumns> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const Matrix< T, NRows, NColumns > &v) |
template<class TPixel, unsigned int VDimension, class TContainer> std::ostream & | operator<< (std::ostream &os, const Neighborhood< TPixel, VDimension, TContainer > &neighborhood) |
template<class TPixel> std::ostream & | operator<< (std::ostream &o, const NeighborhoodAllocator< TPixel > &a) |
template<unsigned int VOffsetDimension> std::ostream & | operator<< (std::ostream &os, const Offset< VOffsetDimension > &ind) |
template<class T, unsigned int NPointDimension> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const Point< T, NPointDimension > &v) |
template<class T, unsigned int NPointDimension> ITK_EXPORT std::istream & | operator>> (std::istream &is, Point< T, NPointDimension > &v) |
template<typename TComponent> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const RGBAPixel< TComponent > &c) |
template<typename TComponent> ITK_EXPORT std::istream & | operator>> (std::istream &is, RGBAPixel< TComponent > &c) |
template<typename TComponent> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const RGBPixel< TComponent > &c) |
template<typename TComponent> ITK_EXPORT std::istream & | operator>> (std::istream &is, RGBPixel< TComponent > &c) |
template<unsigned int VDimension> std::ostream & | operator<< (std::ostream &os, const Size< VDimension > &size) |
template<typename T> std::ostream & | operator<< (std::ostream &os, SmartPointer< T > p) |
template<typename T> std::ostream & | operator<< (std::ostream &os, SmartPointerForwardReference< T > p) |
template<class T, unsigned int NVectorDimension> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const Vector< T, NVectorDimension > &v) |
template<class T, unsigned int NVectorDimension> ITK_EXPORT std::istream & | operator>> (std::istream &is, Vector< T, NVectorDimension > &v) |
ITK_EXPORT Vector< double, 3 > | operator^ (const Vector< double, 3 > &, const Vector< double, 3 > &) |
ITK_EXPORT Vector< float, 3 > | operator^ (const Vector< float, 3 > &, const Vector< float, 3 > &) |
ITK_EXPORT Vector< int, 3 > | operator^ (const Vector< int, 3 > &, const Vector< int, 3 > &) |
template<class T> ITK_EXPORT std::ostream & | operator<< (std::ostream &os, const Versor< T > &v) |
template<class T> ITK_EXPORT std::istream & | operator>> (std::istream &is, Versor< T > &v) |
template<typename T> std::ostream & | operator<< (std::ostream &os, WeakPointer< T > p) |
std::ostream & | operator<< (std::ostream &os, const ImageIORegion ®ion) |
itk::ObjectFactoryBase * | itkLoad () |
Variables |
const unsigned long | prime_list [num_primes] |
const unsigned int | ITK_MAX_DIMENSIONS = 10 |
The three coordinate axis are azimuth, elevation, and range.
The azimuth elevation coordinate system is defined similarly to spherical coordinates but is slightly different in that the azimuth and elevation are measured in degrees between the r-axis (i.e z axis) and the projection on the x-z and y-z planes, respectively. Range, or r, is the distance from the origin.
The equations form performing the conversion from azimuth-elevation coordinates to cartesian coordinates are as follows: z = sqrt((r^2*(cos(azimuth))^2)/(1 + (cos(azimuth))^2 * (tan(elevation))^2); x = z * tan(azimuth) y = z * tan(elevation)
The reversed transforms are: azimuth = arctan(x/y) elevation = arctan(y/z) r = sqrt(x^2 + y^2 + z^2)
In this class, we can also set what a "forward" transform means. If we call SetForwardAzimuthElevationToCartesian(), a forward transform will return cartesian coordinates when passed azimuth,elevation,r coordinates. Calling SetForwardCartesianToAzimuthElevation() will cause the forward transform to return azimuth,elevation,r coordinates from cartesian coordinates.
Setting the FirstSampleDistance to a non-zero value means that a r value of 12 is actually (12 + FirstSampleDistance) distance from the origin.
ScalarT The type to be used for scalar numeric values. Either float or double.
NDimensions The number of dimensions of the vector space (must be >=3).