Main Page   Groups   Namespace List   Class Hierarchy   Alphabetical List   Compound List   File List   Namespace Members   Compound Members   File Members   Concepts
Namespaces | Classes | Typedefs | Enumerations | Functions | Variables

itk Namespace Reference

Hashtable class, used to implement the hashed associative containers itk_hash_set, itk_hash_map, itk_hash_multiset, and itk_hash_multimap. More...

Namespaces

namespace  Accessor
namespace  bio
namespace  Concept
namespace  fem
namespace  fftw
namespace  Function
namespace  Functor
namespace  i18n
namespace  ImageToImageFilterDetail
namespace  Math
namespace  NeighborhoodAlgorithm
namespace  QuaternionOrientationAdapterClasses
namespace  SpatialOrientation
namespace  Statistics
namespace  watershed

Classes

class  AbortCheckEvent
class  AbortEvent
class  AbsImageAdaptor
 Presents an image as being composed of the vcl_abs() of its pixels. More...
class  AbsImageFilter
 Computes the ABS(x) pixel-wise. More...
class  AbsoluteValueDifferenceImageFilter
 Implements pixel-wise the computation of absolute value difference. More...
class  AccumulateImageFilter
 Implements an accumulation of an image along a selected direction. More...
class  AcosImageAdaptor
 Presents an image as being composed of the vcl_acos() of its pixels. More...
class  AcosImageFilter
 Computes the vcl_acos(x) pixel-wise. More...
class  ActiveShapeModelCalculator
 Base class for ActiveShapeModelCalculator object. More...
class  ActiveShapeModelGradientSearchMethod
 Base class for ActiveShapeModelGradientSearchMethod object. More...
class  AdaptImageFilter
 Convert an image to another pixel type using the specified data accessor. More...
class  AdaptiveHistogramEqualizationImageFilter
 Power Law Adaptive Histogram Equalization. More...
class  AddConstantToImageFilter
 Add a constant to all input pixels. More...
class  AddImageAdaptor
 Presents an image as being the addition of a constant value to all pixels. More...
class  AddImageFilter
 Implements an operator for pixel-wise addition of two images. More...
class  AffineGeometryFrame
 Describes the geometry of a data object. More...
class  AffineTransform
class  AggregateLabelMapFilter
 Collapses all labels into the first label. More...
class  AmoebaOptimizer
 Wrap of the vnl_amoeba algorithm. More...
class  AnalyzeImageIO
 Class that defines how to read Analyze file format. Analyze IMAGE FILE FORMAT - As much information as I can determine from the Medical image formats web site, and the Analyze75.pdf file provided from the Mayo clinic. A special note of thanks to Dennis P. Hanson (dph@mayo.edu) for his generous contributions in getting this information correct. More...
class  AnalyzeImageIOFactory
 Create instances of AnalyzeImageIO objects using an object factory. More...
class  AnchorCloseImageFilter
class  AnchorDilateImageFilter
class  AnchorErodeDilateImageFilter
 class to implement erosions and dilations using anchor methods. This is the base class that must be instantiated with appropriate definitions of greater, less and so on. The SetBoundary facility isn't necessary for operation of the anchor method but is included for compatability with other morphology classes in itk. More...
class  AnchorErodeDilateLine
 class to implement erosions and dilations using anchor methods. This is the base class that must be instantiated with appropriate definitions of greater, less and so on. There is special code for cases where the structuring element is bigger than the image size that aren't particularly anchor related, but use the same data structures. Hopefully these sections occupy a very minor proportion of the time. More...
class  AnchorErodeImageFilter
class  AnchorOpenCloseImageFilter
 class to implement openings and closings using anchor methods. More...
class  AnchorOpenCloseLine
 class to implement openings and closings using anchor methods. This is the base class that must be instantiated with appropriate definitions of greater, less and so on More...
class  AnchorOpenImageFilter
class  AndImageFilter
 Implements the AND logical operator pixel-wise between two images. More...
class  AnisotropicDiffusionFunction
class  AnisotropicDiffusionImageFilter
class  AnisotropicFourthOrderLevelSetImageFilter
 This class implements the 4th-order level set anisotropic diffusion (smoothing) PDE. More...
class  AnnulusOperator
 A NeighborhoodOperator for performing a matched filtering with an annulus (two concentric circles, spheres, hyperspheres, etc.). More...
class  AntiAliasBinaryImageFilter
class  AnyEvent
class  ApproximateSignedDistanceMapImageFilter
 Create a map of the approximate signed distance from the boundaries of a binary image. More...
class  ArchetypeSeriesFileNames
 Generate an ordered sequence of filenames. More...
class  AreaClosingImageFilter
 Morphological closing by attributes. More...
class  AreaOpeningImageFilter
 Morphological opening by attributes. More...
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  ArrowSpatialObject
 Representation of a Arrow based on the spatial object classes. More...
class  AsinImageAdaptor
 Presents an image as being composed of the vcl_asin() of its pixels. More...
class  AsinImageFilter
 Computes the vcl_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 vcl_atan() of its pixels. More...
class  AtanImageFilter
 Computes the vcl_atan(x) pixel-wise. More...
class  AtanRegularizedHeavisideStepFunction
 Atan-based implementation of the Regularized (smoothed) Heaviside functions. More...
class  AttributeMorphologyBaseImageFilter
 Morphological opening by attributes. More...
class  AuthalicMatrixCoefficients
 Compute a matrix filled with Authalic Coefiicients of the edge, wherever two vertices are connected with an edge. More...
class  AutoCropLabelMapFilter
 Crop a LabelMap image to fit exactly the objects in the LabelMap. More...
class  AutomaticTopologyMeshSource
 Convenience class for generating meshes. More...
class  AutoPointer
 Implements an Automatic Pointer to an object. More...
class  AutoPointerDataObjectDecorator
 Decorates any pointer to a simple object with a DataObject API using AutoPointer semantics. More...
class  AuxVarTypeDefault
 Level set auxiliary variables type information. More...
class  AzimuthElevationToCartesianTransform
 Transforms from an azimuth, elevation, radius coordinate system to a Cartesian coordinate system, or vice versa. More...
class  BackwardDifferenceOperator
 Operator whose inner product with a neighborhood returns a "half" derivative at the center of the neighborhood. More...
class  BalloonForceFilter
 BalloonForceFilter is used to apply balloon force and the potential force onto the 2D surface model embedded in a 3D space. More...
class  BandNode
class  Barrier
 Standard barrier class implementation for synchronizing the execution of threads. More...
class  BarycentricCombination
class  BasicDilateImageFilter
 gray scale dilation of an image More...
class  BasicErodeImageFilter
 gray scale erosion of an image More...
class  BayesianClassifierImageFilter
 Performs Bayesian Classification on an image. More...
class  BayesianClassifierInitializationImageFilter
 This filter is intended to be used as a helper class to initialize the BayesianClassifierImageFilter. The goal of this filter is to generate a membership image that indicates the membership of each pixel to each class. These membership images are fed as input to the bayesian classfier filter. More...
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  BinaryContourImageFilter
 Labels the pixels on the border of the objects in a binary image. More...
class  BinaryCrossStructuringElement
 A Neighborhood that represents a cross structuring element with binary elements. More...
class  BinaryDilateImageFilter
 Fast binary dilation. More...
class  BinaryErodeImageFilter
 Fast binary erosion. More...
class  BinaryFunctorImageFilter
 Implements pixel-wise generic operation of two images. More...
class  BinaryImageToLabelMapFilter
 Label the connected components in a binary image and produce a collection of label objects. More...
class  BinaryImageToShapeLabelMapFilter
 Converts a binary image to a label map and valuate the shape attributes. More...
class  BinaryImageToStatisticsLabelMapFilter
 a convenient class to convert a binary image to a label map and valuate the statistics attributes at once More...
class  BinaryMagnitudeImageFilter
 Implements pixel-wise the computation of square root of the sum of squares. More...
class  BinaryMask3DMeshSource
class  BinaryMaskToNarrowBandPointSetFilter
 Generate a PointSet containing the narrow band around the edges of a input binary image. More...
class  BinaryMedialNodeMetric
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  BinaryMorphologicalClosingImageFilter
 binary morphological closing of an image. More...
class  BinaryMorphologicalOpeningImageFilter
 binary morphological closing of an image. More...
class  BinaryMorphologyImageFilter
 Base class for fast binary dilation and erosion. More...
class  BinaryProjectionImageFilter
 Binary projection. More...
class  BinaryPruningImageFilter
 This filter removes "spurs" of less than a certain length in the input image. More...
class  BinaryShapeKeepNObjectsImageFilter
 keep N objects according to their shape attributes More...
class  BinaryShapeOpeningImageFilter
 Remove objects based on the value of their shape attribute. More...
class  BinaryStatisticsKeepNObjectsImageFilter
 keep N objects according to their statistics attributes More...
class  BinaryStatisticsOpeningImageFilter
 Remove objects based on the value of their Statistics attribute. More...
class  BinaryThinningImageFilter
 This filter computes one-pixel-wide edges of the input image. 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  BinaryThresholdProjectionImageFilter
 BinaryThreshold projection. More...
class  BinaryThresholdSpatialFunction
 A spatial functions that returns if the internal spatial function is within user specified thresholds. More...
class  BinomialBlurImageFilter
 Performs a separable blur on each dimension of an image. More...
class  BioRadImageIO
 ImageIO class for reading Bio-Rad images. Bio-Rad file format are used by confocal micropscopes like MRC 1024, MRC 600 http://www.bio-rad.com/. More...
class  BioRadImageIOFactory
 Create instances of BioRadImageIO objects using an object factory. More...
class  BlackTopHatImageFilter
 Black top hat extract local minima that are larger than the structuring element. More...
class  BlobSpatialObject
 Spatial object representing a potentially amorphous object. 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  BloxBoundaryProfileImageToBloxCoreAtomImageFilter
 Converts a blox boundary profile image to an image of core atoms. 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  BMPImageIO
 Read BMPImage file format. More...
class  BMPImageIOFactory
 Create instances of BMPImageIO objects using an object factory. More...
class  BoundedReciprocalImageFilter
 Computes 1/(1+x) for each pixel in the image. More...
class  BoundingBox
 Represent and compute information about bounding boxes. More...
class  BoxImageFilter
 A base class for all the filters working on a box neighborhood. More...
class  BoxMeanImageFilter
 Implements a fast rectangular mean filter using the accumulator approach. More...
class  BoxSigmaImageFilter
 Implements a fast rectangular sigma filter using the accumulator approach. More...
class  BoxSpatialObject
 The class may be used to represent N-dimensional boxes. In two dimensions it is a rectangle, In three dimensions it is a cuboid... More...
class  Brains2HeaderFactory
 Create instances of Brains2Header objects using an object factory. More...
class  Brains2IPLHeaderInfo
class  Brains2MaskHeaderInfo
class  Brains2MaskImageIO
 Class that defines how to read Brains2Mask file format. More...
class  Brains2MaskImageIOFactory
 Create instances of Brains2MaskImageIO objects using an object factory. More...
class  BresenhamLine
class  Bruker2DSEQImageIO
 Class that defines how to read Bruker file format. Bruker IMAGE FILE FORMAT - The following is a brief description of the Bruker file format taken from: More...
class  Bruker2DSEQImageIOFactory
 Create instances of Bruker2DSEQImageIO objects using an object factory. 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
 Calculates the B-Spline coefficients of an image. Spline order may be from 0 to 5. More...
class  BSplineDeformableTransform
 Deformable transform using a BSpline representation. More...
class  BSplineDeformableTransformInitializer
 BSplineDeformableTransformInitializer is a helper class intended to initialize the grid parameters of a BSplineDeformableTransform based on the parameters of an image. 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  BSplineScatteredDataPointSetToImageFilter
 Image filter which provides a B-spline output approximation. More...
class  BSplineUpsampleImageFilter
 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  CacheableScalarFunction
 function cache implementation More...
class  CannyEdgeDetectionImageFilter
class  CannySegmentationLevelSetFunction
 A refinement of the standard level-set function which computes a speed term and advection term based on pseudo-Canny edges. See CannySegmentationLevelSetImageFilter for complete information. More...
class  CannySegmentationLevelSetImageFilter
 Segments structures in images based on image features derived from pseudo-canny-edges. More...
class  CastImageFilter
 Casts input pixels to output pixel type. 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  CenteredEuler3DTransform
 CenteredEuler3DTransform of a vector space (e.g. space coordinates). More...
class  CenteredRigid2DTransform
 CenteredRigid2DTransform of a vector space (e.g. space coordinates). More...
class  CenteredSimilarity2DTransform
 CenteredSimilarity2DTransform 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  CenteredVersorTransformInitializer
 CenteredVersorTransformInitializer is a helper class intended to initialize the center of rotation, versor, and translation of the VersorRigid3DTransform. More...
class  CentralDifferenceImageFunction
 Calculate the derivative by central differencing. More...
class  ChainCodePath
 Represent a path as a sequence of connected image index offsets. More...
class  ChainCodePath2D
 Represent a 2D path as a sequence of connected image index offsets. More...
class  ChainCodeToFourierSeriesPathFilter
 Filter that produces a Fourier series version of a chain code path. More...
class  ChangeInformationImageFilter
 Change the origin, spacing and/or region of an Image. More...
class  ChangeLabelImageFilter
 Change Sets of Labels. More...
class  ChangeLabelLabelMapFilter
 Replace the label Ids of selected LabelObjects with new label Ids. More...
class  ChangeRegionLabelMapFilter
 Change the region of a label map. More...
class  CheckerBoardImageFilter
 Combines two images in a checkerboard pattern. More...
class  ChildTreeIterator
class  ClassifierBase
 Base class for classifier object. More...
class  ClosingByReconstructionImageFilter
 Closing by reconstruction of an image. More...
class  CollidingFrontsImageFilter
 Selects a region of space where two independent fronts run towards each other. More...
class  ColorTable
class  Command
 superclass for callback/observer methods More...
class  CompareHistogramImageToImageMetric
 Compares Histograms between two images to be registered to a Training Histogram. More...
class  ComplexBSplineInterpolateImageFunction
 Complex wrapper around BSplineInterpolateImageFunction. More...
class  ComplexToImaginaryImageAdaptor
 Presents a complex image as being composed of imag() part of its pixels. More...
class  ComplexToImaginaryImageFilter
 Computes pixel-wise the imaginary part of a complex image. More...
class  ComplexToModulusImageAdaptor
 Presents a complex image as being composed of vcl_abs() part of its pixels. More...
class  ComplexToModulusImageFilter
 Computes pixel-wise the Modulus of a complex image. More...
class  ComplexToPhaseImageAdaptor
 Presents a complex image as being composed of arg() part of its pixels. More...
class  ComplexToPhaseImageFilter
 Computes pixel-wise the modulus of a complex image. More...
class  ComplexToRealImageAdaptor
 Presents a complex image as being composed of real() part of its pixels. More...
class  ComplexToRealImageFilter
 Computes pixel-wise the real(x) part of a complex image. More...
class  Compose2DCovariantVectorImageFilter
 Implements pixel-wise composition of an 2D covariant vector pixel from two scalar images. More...
class  Compose2DVectorImageFilter
 Implements pixel-wise composition of an 2D vector pixel from two scalar images. More...
class  Compose3DCovariantVectorImageFilter
 Implements pixel-wise composition of an 3D covariant vector pixel from three scalar images. More...
class  Compose3DVectorImageFilter
 Implements pixel-wise composition of an 3D vector pixel from three scalar images. More...
class  ComposeRGBAImageFilter
 Implements pixel-wise composition of an RGBA pixel from four scalar images. More...
class  ComposeRGBImageFilter
 Implements pixel-wise composition of an RGB pixel from three scalar images. More...
class  CompositeValleyFunction
 Multiple valley shaped curve function. More...
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  ConditionVariable
 A thread synchronization object used to suspend execution until some condition on shared data is met. More...
class  ConfidenceConnectedImageFilter
 Segment pixels with similar statistics using connectivity. More...
class  ConformalFlatteningMeshFilter
 ConformalFlatteningMeshFilter applies a conformal mapping from 3D to 2D. More...
class  ConformalMatrixCoefficients
 Compute a matrix filed by Conformal Coefficients of the edge wherever two vertices are connected by an edge. More...
class  ConicShellInteriorExteriorSpatialFunction
 Spatial function implementation of a conic shell. More...
class  ConjugateGradientOptimizer
 Wrap of the vnl_conjugate_gradient. More...
class  ConnectedComponentFunctorImageFilter
 A generic connected components filter that labels the objects in an artibitrary image. More...
class  ConnectedComponentImageFilter
 Label the objects in a binary image. 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  ConstNeighborhoodIterator
 Const version of NeighborhoodIterator, defining iteration of a local N-dimensional neighborhood of pixels across an itk::Image. More...
class  ConstrainedRegionBasedLevelSetFunctionSharedData
 Helper class used to share data in the ScalarChanAndVeseLevelSetFunction. More...
class  ConstrainedValueAdditionImageFilter
 Implements pixel-wise the computation of constrained value addition. More...
class  ConstrainedValueDifferenceImageFilter
 Implements pixel-wise the computation of constrained value difference. 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  ConstSparseFieldLayerIterator
class  ContinuousIndex
 A templated class holding a point in n-Dimensional image space. More...
class  ContourDirectedMeanDistanceImageFilter
 Computes the directed Mean distance between the boundaries of non-zero pixel regions of two images. More...
class  ContourExtractor2DImageFilter
 Computes a list of PolyLineParametricPath objects from the contours in a 2D image. More...
class  ContourMeanDistanceImageFilter
 Computes the Mean distance between the boundaries of non-zero regions of two images. More...
class  ContourSpatialObject
 Representation of a Contour based on the spatial object classes. More...
class  ContourSpatialObjectPoint
 Point used for a Contour definition. More...
class  ConvertPixelBuffer
 Class to convert blocks of data from one type to another. More...
class  ConvolutionImageFilter
 Convolve a given image with an arbitrary image kernel. More...
class  CoreAtomImageToDistanceMatrixProcess
 Computes the distance between all medial nodes (voted core atoms) in a core atom image (input) and stores them in a matrix data object (output). More...
class  CoreAtomImageToUnaryCorrespondenceMatrixProcess
 This process takes in two itkBloxCoreAtomImages and runs the itkUnaryMedialNodeMetric on them. It returns a unary correspondence matrix for the images in the form of an itkMatrixResizeableDataObject. More...
class  CorrelationCoefficientHistogramImageToImageMetric
 Computes correlation coefficient similarity measure between two images to be registered. More...
class  CorrespondenceDataStructure
 A data structure designed to contain medial node clique correspondence data between two images. More...
class  CorrespondenceDataStructureIterator
 An iterator designed to easily traverse an itkCorrespondenceDataStructure. More...
class  CorrespondingList
 Part of the itkCorrespondenceDataStructure. More...
class  CorrespondingMedialNodeClique
 CorrespondingMedialNodeClique is an item stored in CorrespondingNodeList. Specifically it is stored in corresponding node lists and contain pointers to a set of medial nodes (cliques). More...
class  CosImageAdaptor
 Presents an image as being composed of the vcl_cos() of its pixels. More...
class  CosImageFilter
 Computes the vcl_cos(x) pixel-wise. More...
class  CostFunction
 Base class for cost functions intended to be used with Optimizers. More...
class  CovarianceImageFunction
 Calculate the covariance matrix in the neighborhood of a pixel in a Vector image. More...
class  CovariantVector
 A templated class holding a n-Dimensional covariant vector. More...
class  CoxDeBoorBSplineKernelFunction
 BSpline kernel used for density estimation and nonparameteric regression. 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  CropLabelMapFilter
 Crop a LabelMap image. More...
class  CrossHelper
class  CStyleCommand
 Command subclass that calls a pointer to a C function. More...
class  CumulativeGaussianCostFunction
 Cost function for the Cumulative Gaussian Optimizer. More...
class  CumulativeGaussianOptimizer
 This is an optimizer specific to estimating the parameters of Cumulative Gaussian sampled data. More...
class  CurvatureAnisotropicDiffusionImageFilter
class  CurvatureFlowFunction
 This class encapsulate the finite difference equation which drives a curvature flow denoising algorithm. More...
class  CurvatureFlowImageFilter
 Denoise an image using curvature driven flow. More...
class  CurvatureNDAnisotropicDiffusionFunction
class  CurvesLevelSetFunction
 This function is used in CurvesLevelSetImageFilter to segment structures in images based on user supplied edge potential map. More...
class  CurvesLevelSetImageFilter
 Segments structures in images based on user supplied edge potential map. More...
class  CylinderSpatialObject
 This class describe a cylinder in 3D only. More...
class  DanielssonDistanceMapImageFilter
class  DataObject
 Base class for all data objects in ITK. More...
class  DataObjectDecorator
 Decorates any subclass of itkObject with a DataObject API. 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  DefaultConvertPixelTraits
 Traits class used to by ConvertPixels to convert blocks of pixels. More...
class  DefaultDynamicMeshTraits
class  DefaultImageTraits
 Default ImageTraits for any PixelType. More...
class  DefaultPixelAccessor
 Give access to partial aspects a type. More...
class  DefaultPixelAccessorFunctor
 This class provides a common API for pixel accessors for Image and VectorImage. (between the DefaultVectorPixelAccessor and DefaultPixelAccessor). More...
class  DefaultStaticMeshTraits
class  DefaultVectorPixelAccessor
 Give access to partial aspects of a type. More...
class  DefaultVectorPixelAccessorFunctor
 This class provides a common API for pixel accessors for Image and VectorImage. (between the DefaultVectorPixelAccessor and DefaultPixelAccessor). More...
class  DeformableMesh3DFilter
class  DeformableSimplexMesh3DBalloonForceFilter
 Additional to its superclass this model adds an balloon force component to the internal forces. More...
class  DeformableSimplexMesh3DFilter
 Three-dimensional deformable model for image segmentation. More...
class  DeformableSimplexMesh3DGradientConstraintForceFilter
 Additional to its superclass this class reimplemets the external forces methos in which the scan line algorithm is used to find highest gradient is found in the direction of the normal to each vertex within a specified range. More...
class  DeformationFieldJacobianDeterminantFilter
 Computes a scalar image from a vector image (e.g., deformation field) input, where each output scalar at each pixel is the Jacobian determinant of the vector field at that location. This calculation is only correct if the the vector field has values that are the absolute locations from which to get the new values are to be taken. This implies that the identity vector field (VF) mapping would have values at each location (x) equal to the location itself. VF(x)=x. THIS IS VERY UNUSUAL. The DeformationFieldJacobianDeterminantFilter computes the proper Jacobian Determinant for a vector field described this way as det[ dT/dx ] = det[ du/dx ]. More...
class  DeformationFieldSource
 Computes a deformation field from two sets of landmarks. More...
class  DeleteEvent
class  DemonsRegistrationFilter
 Deformably register two images using the demons algorithm. More...
class  DemonsRegistrationFunction
class  DenseFiniteDifferenceImageFilter
class  DerivativeImageFilter
 Computes the directional derivative of an image. The directional derivative at each pixel location is computed by convolution with a derivative operator of user-specified order. More...
class  DerivativeOperator
 A NeighborhoodOperator for taking an n-th order derivative at a pixel. More...
class  DicomImageIO
 Read DicomImage file format. More...
class  DICOMImageIO2
 Read DICOMImage file format. More...
class  DICOMImageIO2Factory
 Create instances of DICOMImageIO2 objects using an object factory. More...
class  DicomImageIOFactory
 Create instances of DicomImageIO objects using an object factory. More...
class  DICOMSeriesFileNames
 Generate an ordered sequence of filenames. More...
class  DiffeomorphicDemonsRegistrationFilter
 Deformably register two images using a diffeomorphic demons algorithm. More...
class  DifferenceImageFilter
 Implements comparison between two images. More...
class  DifferenceOfGaussiansGradientImageFilter
 Performs difference-of-gaussians gradient detection. More...
class  DiffusionTensor3D
 Represent a diffusion tensor as used in DTI images. More...
class  DiffusionTensor3DReconstructionImageFilter
 This class takes as input one or more reference image (acquired in the absence of diffusion sensitizing gradients) and 'n' diffusion weighted images and their gradient directions and computes an image of tensors. (with DiffusionTensor3D as the pixel type). Once that is done, you can apply filters on this tensor image to compute FA, ADC, RGB weighted maps etc. 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  DirectFourierReconstructionImageToImageFilter
 Direct fourier reconstruction filter of a tomographic volume. More...
class  Directory
 Portable directory/filename traversal. More...
class  DiscreteGaussianDerivativeImageFilter
 Calculates image derivatives using discrete derivative gaussian kernels. This filter calculates Gaussian derivative by separable convolution of an image and a discrete Gaussian derivative operator (kernel). More...
class  DiscreteGaussianDerivativeImageFunction
 Compute the discrete gaussian derivatives of an the image at a specific location in space, i.e. point, index or continuous index. This class computes a single derivative given the order in each direction (by default zero). This class is templated over the input image type. 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...
class  DiscreteGradientMagnitudeGaussianImageFunction
 Compute the discrete gradient magnitude gaussian of an the image at a specific location in space, i.e. point, index or continuous index. This class computes a single derivative given the order in each direction (by default zero). This class is templated over the input image type. More...
class  DiscreteHessianGaussianImageFunction
 Compute the Hessian Gaussian of an image at a specific location in space by calculating discrete second-order gaussian derivatives. This class is templated over the input image type. More...
class  DisplacementFieldJacobianDeterminantFilter
 Computes a scalar image from a vector image (e.g., deformation field) input, where each output scalar at each pixel is the Jacobian determinant of the vector field at that location. This calculation is correct in the case where the vector image is a "displacement" from the current location. The computation for the jacobian determinant is: det[ dT/dx ] = det[ I + du/dx ]. More...
class  DivideByConstantImageFilter
 Divide input pixels by a constant. More...
class  DivideImageFilter
 Implements an operator for pixel-wise division of two images. More...
class  DoubleThresholdImageFilter
 Binarize an input image using double thresholding. More...
class  DTITubeSpatialObject
 Representation of a tube based on the spatial object classes. More...
class  DTITubeSpatialObjectPoint
 Point used for a tube definition. 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
 Computes pixel-wise the eigen values and eigen vectors of a 2D symmetrical matrix. More...
class  ElasticBodyReciprocalSplineKernelTransform
class  ElasticBodySplineKernelTransform
 This class defines the elastic body spline (EBS) transformation. More...
class  ElementWrapperInterface
class  ElementWrapperPointerInterface
class  EllipseSpatialObject
 TODO. More...
class  EllipsoidInteriorExteriorSpatialFunction
class  EndEvent
class  EndPickEvent
class  EquivalencyTable
 Hash table to manage integral label equivalencies. More...
class  ErodeObjectMorphologyImageFilter
 Erosion of an object in an image. More...
class  ESMDemonsRegistrationFunction
 Fast implementation of the symmetric demons registration force. More...
class  EuclideanDistancePointMetric
 Computes the minimum distance between a moving point-set and a fixed point-set. A vector of minimum closest point distance is created for each point in the moving point-set. No correspondance is needed. For speed consideration, the point-set with the minimum number of points should be used as the moving point-set. If the number of points is high, the possibility of setting a distance map should improve the speed of the closest point computation. 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  ExhaustiveOptimizer
 Optimizer that fully samples a grid on the parametric space. More...
class  ExitEvent
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 vcl_exp() of its pixels. More...
class  ExpImageFilter
 Computes the vcl_exp(x) pixel-wise. More...
class  ExpNegativeImageAdaptor
 Presents an image as being composed of the vcl_exp() of its pixels. More...
class  ExpNegativeImageFilter
 Computes the function vcl_exp(-K.x) pixel-wise. More...
class  ExponentialDeformationFieldImageFilter
 Computes a diffeomorphic deformation field as the Lie group exponential of a vector field. More...
class  ExtensionVelocitiesImageFilter
 Extend velocities smoothly from a particular level set. More...
class  ExtractImageFilter
 Decrease the image size by cropping the image to the selected region bounds. More...
class  ExtractOrthogonalSwath2DImageFilter
 Extracts into rectangular form a "swath" image from the input image along the parametric path. More...
class  ExtrapolateImageFunction
 Base class for all image extrapolaters. More...
class  FastApproximateRankImageFilter
 A separable rank filter. More...
class  FastChamferDistanceImageFilter
 This class compute the signed (positive and negative) chamfer distance in a narrow band. More...
class  FastIncrementalBinaryDilateImageFilter
 Fast binary dilation. More...
class  FastMarchingExtensionImageFilter
 Extend auxiliary variables smoothly using Fast Marching. More...
class  FastMarchingImageFilter
 Solve an Eikonal equation using Fast Marching. More...
class  FastMarchingUpwindGradientImageFilter
 Generates the upwind gradient field of fast marching arrival times. More...
class  FastMutexLock
 Critical section locking class. More...
class  FastSymmetricForcesDemonsRegistrationFilter
 Deformably register two images using a symmetric forces demons algorithm. More...
class  FastSymmetricForcesDemonsRegistrationFunction
class  FFTComplexConjugateToRealImageFilter
 TODO. More...
class  FFTComplexToComplexImageFilter
 Implements an API to enable the Fourier transform or the inverse Fourier transform of images with complex valued voxels to be computed. More...
class  FFTRealToComplexConjugateImageFilter
 TODO. More...
class  FFTShiftImageFilter
 Shift the zero-frequency components to center of the image. More...
class  FFTWComplexConjugateToRealImageFilter
class  FFTWRealToComplexConjugateImageFilter
class  FileOutputWindow
 Messages sent from the system are sent to a file. More...
class  FiniteCylinderSpatialFunction
 Function implementation of an finite cylinder. More...
class  FiniteDifferenceFunction
class  FiniteDifferenceImageFilter
class  FiniteDifferenceSparseImageFilter
 This class implements a multi-threaded base class for Image to SparseImage finite difference processes. More...
class  FiniteDifferenceSparseImageFunction
 This is the base class for function classes that can be used with filters derived from FiniteDifferenceSparseImageFilter. More...
class  FixedArray
 Simulate a standard C array with copy semnatics. More...
class  FixedCenterOfRotationAffineTransform
 Affine transformation with a specified center of rotation. More...
class  FlatStructuringElement
 A class to support a variety of flat structuring elements, including versions created by decomposition of lines. More...
class  FlipImageFilter
 Flips an image across user specified axes. More...
class  FloodFilledFunctionConditionalConstIterator
 Iterates over a flood-filled spatial function. 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  FourierSeriesPath
 Represent a closed path through ND Space by its frequency components. More...
class  FRPROptimizer
 Implements Fletch-Reeves & Polak-Ribiere optimization using dBrent line search. More...
class  FrustumSpatialFunction
 Spatial function implementation of a truncated pyramid. More...
class  FunctionAndGradientEvaluationIterationEvent
class  FunctionBase
 Base class for all ITK function objects. More...
class  FunctionEvaluationIterationEvent
class  GaborImageSource
 Generate an n-dimensional image of a Gabor filter. More...
class  GaborKernelFunction
 Gabor kernel used for various computer vision tasks. More...
class  GaussianBlurImageFunction
 Compute the convolution of a neighborhood operator with the image at a specific location in space, i.e. point, index or continuous index. This class is templated over the input image type. More...
class  GaussianDerivativeImageFunction
 Compute the gaussian derivatives of an the image at a specific location in space, i.e. point, index or continuous index. This class is templated over the input image type. More...
class  GaussianDerivativeOperator
 A NeighborhoodOperator whose coefficients are a one dimensional, discrete derivative Gaussian kernel. More...
class  GaussianDerivativeSpatialFunction
 N-dimensional gaussian spatial function class. 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...
class  GaussianSpatialObject
 Represents a multivariate Gaussian function. More...
class  GDCMImageIO
 ImageIO class for reading and writing DICOM V3.0 and ACR/NEMA 1&2 uncompressed images This class is only an adaptor to the gdcm library (currently gdcm 1.2.x is used by default): More...
class  GDCMImageIOFactory
 Create instances of GDCMImageIO objects using an object factory. More...
class  GDCMSeriesFileNames
 Generate a sequence of filenames from a DICOM series. More...
class  GE4ImageIO
 Class that defines how to read GE4 file format. More...
class  GE4ImageIOFactory
 Create instances of GE4ImageIO objects using an object factory. More...
class  GE5ImageIO
 Class that defines how to read GE5 file format. More...
class  GE5ImageIOFactory
 Create instances of GE5ImageIO objects using an object factory. More...
class  GEAdwImageIO
 Class that defines how to read GEAdw file format. More...
class  GEAdwImageIOFactory
 Create instances of GEAdwImageIO objects using an object factory. More...
class  GeodesicActiveContourLevelSetFunction
 This function is used in GeodesicActiveContourLevelSetImageFilter to segment structures in an image based on a user supplied edge potential map. More...
class  GeodesicActiveContourLevelSetImageFilter
 Segments structures in images based on a user supplied edge potential map. More...
class  GeodesicActiveContourShapePriorLevelSetFunction
 This function is used in GeodesicActiveContourShapePriorSegmentationLevelSetFilter to segment structures in an image based on user supplied edge potential map and shape model. More...
class  GeodesicActiveContourShapePriorLevelSetImageFilter
 Segments structures in an image based on a user supplied edge potential map and user supplied shape model. More...
class  GeometricalQuadEdge
 This class extends the QuadEdge by adding a reference to the Origin. More...
class  GetAverageSliceImageFilter
 Averages a single dimension of an image. More...
struct  GetDimension
struct  GetImageDimension
struct  GetMeshDimension
struct  GetPointSetDimension
struct  GetVectorDimension
class  GiplImageIO
 Read GiplImage file format. More...
class  GiplImageIOFactory
 Create instances of GiplImageIO objects using an object factory. More...
class  GradientAnisotropicDiffusionImageFilter
class  GradientDescentOptimizer
 Implement a gradient descent optimizer. More...
class  GradientDifferenceImageToImageMetric
 Computes similarity between two objects to be registered. More...
class  GradientEvaluationIterationEvent
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  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  GrayscaleConnectedClosingImageFilter
 Enhance pixels associated with a dark object (identified by a seed pixel) where the dark object is surrounded by a brigher object. More...
class  GrayscaleConnectedOpeningImageFilter
 Enhance pixels associated with a bright object (identified by a seed pixel) where the bright object is surrounded by a darker object. More...
class  GrayscaleDilateImageFilter
 gray scale dilation of an image More...
class  GrayscaleErodeImageFilter
 gray scale erosion of an image More...
class  GrayscaleFillholeImageFilter
 Remove local minima not connected to the boundary of the image. More...
class  GrayscaleFunctionDilateImageFilter
 gray scale function dilation of an image More...
class  GrayscaleFunctionErodeImageFilter
 gray scale function erosion of an image More...
class  GrayscaleGeodesicDilateImageFilter
 geodesic gray scale dilation of an image More...
class  GrayscaleGeodesicErodeImageFilter
 geodesic gray scale erosion of an image More...
class  GrayscaleGrindPeakImageFilter
 Remove local maxima not connected to the boundary of the image. More...
class  GrayscaleMorphologicalClosingImageFilter
 gray scale morphological closing of an image. More...
class  GrayscaleMorphologicalOpeningImageFilter
 gray scale morphological opening of an image. More...
class  GreenPixelAccessor
 Give access to the Green component of a RGBPixel type. More...
class  GridForwardWarpImageFilter
 Warps a grid using an input deformation field. More...
class  GridImageSource
 Generate an n-dimensional image of a grid. More...
class  GroupSpatialObject
 Representation of a group based on the spatial object classes. More...
class  HarmonicMatrixCoefficients
 Compute a matrix filled with Harmonic coefficients, wherever two vertices are connected by an edge. 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  HConcaveImageFilter
 Identify local minima whose depth below the baseline is greater than h. More...
class  HConvexImageFilter
 Identify local maxima whose height above the baseline is greater than h. More...
class  HeavisideStepFunction
 Implementation of the classical Heaviside step function. More...
class  HeavisideStepFunctionBase
 Base class of the Heaviside function. More...
class  Hessian3DToVesselnessMeasureImageFilter
 Line filter to provide a vesselness measure for tubular objects from the hessian matrix. The filter takes as input an image of hessian pixels (SymmetricSecondRankTensor pixels) and preserves pixels that have eigen values $ \lambda_3 $ close to 0 and $\lambda_2$ and $\lambda_1$ as large negative values. (for bright tubular structures). More...
class  HessianRecursiveGaussianImageFilter
 Computes the Hessian matrix of an image by convolution with the Second and Cross derivatives of a Gaussian. More...
class  HessianToObjectnessMeasureImageFilter
 A filter to enhance M-dimensional objects in N-dimensional images. More...
class  HexahedronCell
class  HexahedronCellTopology
class  HistogramAlgorithmBase
 base class for algorithms operating on histograms More...
class  HistogramImageToImageMetric
 Computes similarity between two objects to be registered. More...
class  HistogramMatchingImageFilter
 Normalize the grayscale values between two image by histogram matching. More...
class  HistogramToEntropyImageFilter
 The class takes a histogram as an input and gives the entropy image as the output. A pixel, at position I, in the output image is given by. More...
class  HistogramToImageFilter
 This class takes a histogram as an input and returns an image of type specified by the functor. More...
class  HistogramToIntensityImageFilter
 The class takes a histogram as an input and produces an image as the output. A pixel, at position I, in the output image is given by. More...
class  HistogramToLogProbabilityImageFilter
 The class takes a histogram as an input and gives the log probability image as the output. A pixel, at position I, in the output image is given by. More...
class  HistogramToProbabilityImageFilter
 The class takes a histogram as an input and gives the probability image as the output. A pixel, at position I, in the output image is given by. More...
class  HMaximaImageFilter
 Suppress local maxima whose height above the baseline is less than h. More...
class  HMinimaImageFilter
 Suppress local minima whose depth below the baseline is less than h. More...
class  HoughTransform2DCirclesImageFilter
 Performs the Hough Transform to find circles in a 2D image. More...
class  HoughTransform2DLinesImageFilter
 Performs the Hough Transform to find 2D straight lines in a 2D image. More...
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  ImageAndPathToImageFilter
 Base class for filters that take both a path and an image as input and produce a path as output. 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  ImageClassifierBase
 Base class for ImageClassifierBase object. More...
class  ImageConstIterator
 A multi-dimensional image iterator templated over image type. More...
class  ImageConstIteratorWithIndex
 A base class for multi-dimensional iterators templated over image type that are designed to efficiently keep track of the iterator position. More...
class  ImageContainerInterface
class  ImageDuplicator
 This helper class create an image which is perfect copy of the input image. More...
class  ImageFileReader
 Data source that reads image data from a single file. More...
class  ImageFileReaderException
 Base exception class for IO conflicts. More...
class  ImageFileWriter
 Writes image data to a single file. More...
class  ImageFileWriterException
 Base exception class for IO problems during writing. More...
class  ImageFunction
 Evaluates a function of an image at specified position. More...
class  ImageGaussianModelEstimator
 Base class for ImageGaussianModelEstimator object. More...
class  ImageHelper
 Fast Index/Offset computation. More...
class  ImageIOBase
 Abstract superclass defines image IO interface. More...
class  ImageIOFactory
 Create instances of ImageIO objects using an object factory. More...
class  ImageIORegion
 An ImageIORegion represents a structured region of data. More...
class  ImageIORegionAdaptor
 Helper class for converting ImageRegions into ImageIORegions and back. More...
class  ImageIterator
 A multi-dimensional iterator templated over image type. More...
class  ImageIteratorWithIndex
 A base class for multi-dimensional iterators templated over image type that are designed to efficiently keep track of the iterator position. More...
class  ImageKernelOperator
 A NeighborhoodOperator whose coefficients are from an image. More...
class  ImageKmeansModelEstimator
 Base class for ImageKmeansModelEstimator object. More...
class  ImageLinearConstIteratorWithIndex
 A multi-dimensional image iterator that visits image pixels within a region in a "scan-line" order. More...
class  ImageLinearIteratorWithIndex
 A multi-dimensional image iterator that visits image pixels within a region in a "scan-line" order. More...
class  ImageMaskSpatialObject
 Implementation of an image mask as spatial 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  ImagePCADecompositionCalculator
 Decomposes an image into directions along basis components. More...
class  ImagePCAShapeModelEstimator
 Base class for ImagePCAShapeModelEstimator object. More...
class  ImageRandomConstIteratorWithIndex
 A multi-dimensional image iterator that visits a random set of pixels within an image region. More...
class  ImageRandomIteratorWithIndex
 A multi-dimensional image iterator that visits a random set of pixels within an image region. More...
class  ImageRandomNonRepeatingConstIteratorWithIndex
 A multi-dimensional image iterator that visits a random set of pixels within an image region. All pixels in the image will be visited before any are repeated. A priority image may be passed to the interator which will cause it to select certain sets of pixels (those with lower priority values) before others. More...
class  ImageRandomNonRepeatingIteratorWithIndex
 A multi-dimensional image iterator that visits image pixels within a region in a random order, without repeating. More...
class  ImageRegion
 An image region represents a structured region of data. More...
class  ImageRegionConstIterator
 A multi-dimensional iterator templated over image type that walks a region of pixels. More...
class  ImageRegionConstIteratorWithIndex
 A multi-dimensional iterator templated over image type that walks an image region and is specialized to keep track of its index location. More...
class  ImageRegionExclusionConstIteratorWithIndex
 Multi-dimensional image iterator that walks an image region, excluding a second region contained within the first. More...
class  ImageRegionExclusionIteratorWithIndex
 Multi-dimensional image iterator that walks an image region, excluding a second region contained within the first. More...
class  ImageRegionIterator
 A multi-dimensional iterator templated over image type that walks a region of pixels. More...
class  ImageRegionIteratorWithIndex
 A multi-dimensional iterator templated over image type that walks pixels within a region and is specialized to keep track of its image index location. More...
class  ImageRegionMultidimensionalSplitter
 Divide a region into several pieces. More...
class  ImageRegionReverseConstIterator
 A multi-dimensional image iterator designed to walk a specified image region in reverse. More...
class  ImageRegionReverseIterator
 Multi-dimensional image iterator which only walks a region. More...
class  ImageRegionSplitter
 Divide a region into several pieces. More...
class  ImageRegistrationMethod
 Base class for Image Registration Methods. More...
class  ImageReverseConstIterator
 Multi-dimensional image iterator. More...
class  ImageReverseIterator
 A multi-dimensional image iterator designed to walk a specified region in reverse. More...
class  ImageSeriesReader
 Data source that reads image data from a series of disk files. More...
class  ImageSeriesWriter
 Writes image data to a series of data files. More...
class  ImageSeriesWriterException
 Base exception class for IO problems during writing. More...
class  ImageShapeModelEstimatorBase
 Base class for statistical shape model estimation. More...
class  ImageSliceConstIteratorWithIndex
 Multi-dimensional image iterator which only walks a region. More...
class  ImageSliceIteratorWithIndex
 A multi-dimensional image iterator that extends the ImageLinearIteratorWithIndex from iteration along lines in an image to iteration along both lines and planes (slices) within an image. A slice is defined as a 2D plane spanned by two vectors pointing along orthogonal coordinate axes. More...
class  ImageSource
 Base class for all process objects that output image data. More...
class  ImageSpatialObject
 Implementation of an image as spatial object. More...
class  ImageToImageFilter
 Base class for filters that take an image as input and produce an image as output. More...
class  ImageToImageMetric
 Computes similarity between regions of two images. More...
class  ImageToMeshFilter
 ImageToMeshFilter is the base class for all process objects that output Mesh data and require image data as input. Specifically, this class defines the SetInput() method for defining the input to a filter. More...
class  ImageToParametricSpaceFilter
 Generate a mesh of parametric space from input images. More...
class  ImageToPathFilter
 Base class for filters that take an image as input and produce an path as output. 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  ImageToVectorImageFilter
 This class takes as input 'n' itk::Image's and composes them into a single itk::VectorImage. More...
class  ImageTransformHelper
 Fast index/physical index computation. More...
class  ImageVoxel
class  ImplicitManifoldNormalVectorFilter
 This class implements the filter for computing the normal vectors from a scalar implicit function (i.e. a levelset image) and processing them. More...
class  ImportImageContainer
class  ImportImageFilter
 Import data from a standard C array into an itk::Image. More...
class  Indent
 Control indentation during Print() invocation. More...
class  Index
 Represent a n-dimensional index in a n-dimensional image. More...
class  IndexedContainerInterface
class  InitializeEvent
class  InOrderTreeIterator
class  InPlaceImageFilter
 Base class for filters that take an image as input and overwrite that image as the output. More...
class  InPlaceLabelMapFilter
 Base class for filters that takes an image as input and overwrites that image as the output. More...
class  IntensityWindowingImageFilter
 Applies a linear transformation to the intensity levels of the input Image that are inside a user-defined interval. Values below this interval are mapped to a constant. Values over the interval are mapped to another constant. More...
class  InteriorExteriorMeshFilter
 InteriorExteriorMeshFilter takes an itk::Mesh and extracts from it a Sub-Mesh such that all its points Evaluate > 0 in an itk::SpatialFunction provided by the user. More...
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  IntrinsicMatrixCoefficients
 Compute a mtrix filled by intrinsic Coefficients of the edge, wherever two vertices are connected by an edge. More...
class  InvalidRequestedRegionError
class  InverseDeformationFieldImageFilter
 Computes the inverse of a deformation field. More...
class  InverseEuclideanDistanceMatrixCoefficients
 Compute a matrix filed with the inverse of the euclidian distance wherever two vertices are connected by an edge. More...
class  InvertIntensityImageFilter
 Invert intensity of an image. More...
class  IOCommon
 Centralized funtionality for IO classes. More...
class  IPLCommonImageIO
 Class that defines how to read GE4 file format. More...
class  IPLFileNameList
 -- stores filename+info to be enumerated for IPLCommonImageIO More...
class  IPLFileSortInfo
class  IsoContourDistanceImageFilter
 Compute an approximate distance from an interpolated isocontour to the close grid points. More...
class  IsolatedConnectedImageFilter
 Label pixels that are connected to one set of seeds but not another. More...
class  IsolatedWatershedImageFilter
 Isolate watershed basins using two seeds. More...
class  IsotropicFourthOrderLevelSetImageFilter
 This class implements the 4th-order level set isotropic diffusion (smoothing) PDE. More...
class  IterationEvent
class  IterationReporter
 Implements iterations tracking for a filter. More...
class  IterativeInverseDeformationFieldImageFilter
 Computes the inverse of a deformation field. More...
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  JoinSeriesImageFilter
 Join N-D images into an (N+1)-D image. More...
class  JPEGImageIO
 ImageIO object for reading and writing JPEG images. More...
class  JPEGImageIOFactory
 Create instances of JPEGImageIO objects using an object factory. More...
class  KalmanLinearEstimator
 Implement a linear recursive estimator. More...
class  KappaSigmaThresholdImageCalculator
 Compute moments of an n-dimensional image. More...
class  KappaSigmaThresholdImageFilter
 Threshold an image using multiple Otsu Thresholds. More...
class  KappaStatisticImageToImageMetric
 Computes similarity between two binary objects to be registered. More...
class  KernelFunction
 Kernel used for density estimation and nonparameteric regression. More...
class  KernelImageFilter
 A base class for all the filters working on an arbitrary shaped neighborhood. More...
class  KernelTransform
class  KLMDynamicBorderArray
 Object maintaining a reference to a list of borders associated with a region. More...
class  KLMRegionGrowImageFilter
 Base class for a region growing object that performs energy-based region growing for multiband images. More...
class  KLMSegmentationBorder
 Base class for KLMSegmentationBorder object. More...
class  KLMSegmentationRegion
 Base class for KLMSegmentationRegion object. More...
class  KullbackLeiblerCompareHistogramImageToImageMetric
 Computes the Kubler Lieblach(KL) metric between the histogram of the two images to be registered and a training histogram. More...
class  LabelContourImageFilter
 Labels the pixels on the border of the objects in a labeled image. More...
class  LabelGeometryImageFilter
 Given a label map and an optional intensity image, compute geometric features. More...
class  LabelImageToLabelMapFilter
 convert a labeled image to a label collection image More...
class  LabelImageToShapeLabelMapFilter
 Converts a label image to a label map and valuates the shape attributes. More...
class  LabelImageToStatisticsLabelMapFilter
 a convenient class to convert a label image to a label map and valuate the statistics attributes at once More...
class  LabelMap
 Templated n-dimensional image to store labeled objects. More...
class  LabelMapFilter
 Base class for filters that take an image as input and overwrite that image as the output. More...
class  LabelMapToBinaryImageFilter
 Convert a LabelMap to a binary image. More...
class  LabelMapToLabelImageFilter
 Converts a LabelMap to a labeled image. More...
class  LabelObject
 The base class for the representation of an labeled binary object in an image. More...
class  LabelObjectLine
class  LabelOverlayImageFilter
 Apply a colormap to a label image and put it on top of the input image. More...
class  LabelPerimeterEstimationCalculator
 Estimates the perimeter of a label object. More...
class  LabelShapeKeepNObjectsImageFilter
 keep N objects according to their shape attributes More...
class  LabelShapeOpeningImageFilter
 remove the objects according to the value of their shape attribute More...
class  LabelStatisticsImageFilter
 Given an intensity image and a label map, compute min, max, variance and mean of the pixels associated with each label or segment. More...
class  LabelStatisticsKeepNObjectsImageFilter
 keep N objects according to their statistics attributes More...
class  LabelStatisticsOpeningImageFilter
 remove the objects according to the value of their statistics attribute More...
class  LabelToRGBImageFilter
 Apply a colormap to a label image. More...
class  LabelVotingImageFilter
 This filter performs pixelwise voting among an arbitrary number of input images, where each of them represents a segmentation of the same scene (i.e., image). More...
class  LandmarkBasedTransformInitializer
 LandmarkBasedTransformInitializer is a helper class intended to The class computes the transform that aligns the fixed and moving images given a set of landmarks. The class is templated over the Transform type. The transform computed gives the best fit transform that maps the fixed and moving images in a least squares sense. The indices are taken to correspond, so point 1 in the first set will get mapped close to point 1 in the second set, etc. An equal number of fixed and moving landmarks need to be specified using SetFixedLandmarks() SetMovingLandmarks(). Any number of landmarks may be specified. Call InitializeTransform() to initialize the transform. More...
class  LandmarkSpatialObject
 Representation of a Landmark based on the spatial object classes. More...
class  LaplacianImageFilter
class  LaplacianOperator
class  LaplacianRecursiveGaussianImageFilter
 Computes the Laplacian of an image by convolution with the second derivative of a Gaussian. More...
class  LaplacianSegmentationLevelSetFunction
 This function is used in LaplacianSegmentationImageFilter to segment structures in an image based Laplacian edges. More...
class  LaplacianSegmentationLevelSetImageFilter
 Segments structures in images based on a second derivative image features. More...
class  LaplacianSharpeningImageFilter
class  LBFGSBOptimizer
 Limited memory Broyden Fletcher Goldfarb Shannon minimization with simple bounds. More...
class  LBFGSOptimizer
 Wrap of the vnl_lbfgs algorithm. More...
class  LeafTreeIterator
class  LevelOrderTreeIterator
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  LevelSetFunctionWithRefitTerm
 This class extends the LevelSetFunction class by adding a grow term based on a target curvature stored in a sparse image. More...
class  LevelSetMotionRegistrationFilter
 Deformably register two images using level set motion. More...
class  LevelSetMotionRegistrationFunction
class  LevelSetNeighborhoodExtractor
 Locate pixels of a particular level set. More...
class  LevelSetNode
 Represent a node in a level set. More...
class  LevelSetTypeDefault
 Level set type information. More...
class  LevelSetVelocityNeighborhoodExtractor
 Locate pixels of a particular level set. More...
class  LevenbergMarquardtOptimizer
 Wrap of the vnl_levenberg_marquardt algorithm. 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  LineCell
class  LineConstIterator
 Iterator that walks a Bresenham line through an ND image. More...
class  LineIterator
 Iterator that walks a Bresenham line through an ND image. More...
class  LineSpatialObject
 Representation of a Line based on the spatial object classes. More...
class  LineSpatialObjectPoint
 Point used for a line definition. More...
class  ListNode
class  Log10ImageAdaptor
 Presents an image as being composed of the vcl_log10() of its pixels. More...
class  Log10ImageFilter
 Computes the vcl_log10(x) pixel-wise. More...
class  Logger
 Class Logger is meant for logging information during a run. More...
class  LoggerBase
 Class LoggerBase is meant for logging information during a run. More...
class  LoggerManager
 Class LoggerManager is meant for centrally managing loggers. More...
class  LoggerOutput
 This class is meant for overriding itk::OutputWindow to redirect messages to itk::Logger. More...
class  LoggerThreadWrapper
 Class LoggerThreadWrapper is meant for providing logging service as a separate thread. More...
class  LogImageAdaptor
 Presents an image as being composed of the vcl_log() of its pixels. More...
class  LogImageFilter
 Computes the vcl_log(x) pixel-wise. More...
class  LogOutput
 Class LogOutput represents an output stream. More...
class  LSMImageIO
 ImageIO class for reading LSM (Zeiss) images LSM is a line of confocal laser scanning microscopes produced by the Zeiss company LSM files are essentially extensions of the TIFF multiple image stack file format. More...
class  LSMImageIOFactory
 Create instances of LSMImageIO objects using an object factory. More...
class  MagnitudeAndPhaseToComplexImageFilter
 Implements pixel-wise conversion of magnitude and phase data into complex voxels. More...
class  MahalanobisDistanceThresholdImageFunction
 Returns true if the pixel value of a vector image has a Mahalanobis distance below the value specified by the threshold. More...
class  MapContainer
class  MapData
class  MapFileParser
class  MapRecord
 MapRecord class. More...
class  MaskedMovingHistogramImageFilter
class  MaskedRankHistogram
class  MaskedRankHistogramMap
class  MaskedRankHistogramVec
class  MaskedRankImageFilter
 Rank filter of a greyscale image. More...
class  MaskImageFilter
 Implements an operator for pixel-wise masking of the input image with the mask. More...
class  MaskNegatedImageFilter
 Implements an operator for pixel-wise masking of the input image with the negative of a mask. More...
class  MaskNeighborhoodOperatorImageFilter
 Applies a single NeighborhoodOperator to an image, processing only those pixels that are under a mask. More...
class  MatchCardinalityImageToImageMetric
 Computes similarity between two objects to be registered. More...
class  MatlabTransformIO
class  MatlabTransformIOFactory
 Create instances of MatlabTransformIO objects using an object factory. 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  MatrixCoefficients
 Superclass for all the matrix coefficients computation classes. More...
class  MatrixIndexSelectionImageFilter
 Extracts the selected indices of a matrix image that is the input pixel type. More...
class  MatrixOffsetTransformBase
class  MatrixResizeableDataObject
 Allows for a vnl matrix to be a data object with the flexibility of being resizable. More...
class  MattesMutualInformationImageToImageMetric
 Computes the mutual information between two images to be registered using the method of Mattes et al. More...
class  MaxFunctor
class  MaximumDecisionRule
 A Decision rule that choose the class of which discriminant score is the largest. More...
class  MaximumImageFilter
 Implements a pixel-wise operator Max(a,b) between two images. More...
class  MaximumProjectionImageFilter
 Maximum projection. More...
class  MaximumRatioDecisionRule
 This rule returns $i$ if $\frac{f_{i}(\overrightarrow{x})}{f_{j}(\overrightarrow{x})} > \frac{K_{j}}{K_{i}}$ for all $j \not= i$, where the $i$ is the index of a class which has membership function $f_{i}$ and its prior value (usually, the a priori probability or the size of a class) is $K_{i}$. More...
class  MaxMeasureBoundCriterion
class  MaxPriorityQueueElementWrapper
class  MeanImageFilter
 Applies an averaging filter to an image. More...
class  MeanImageFunction
 Calculate the mean value in the neighborhood of a pixel. More...
class  MeanProjectionImageFilter
 Mean projection. More...
class  MeanReciprocalSquareDifferenceImageToImageMetric
 Computes similarity between two objects to be registered. More...
class  MeanReciprocalSquareDifferencePointSetToImageMetric
 Computes similarity between pixel values of a point set and intensity values in an image. More...
class  MeanSquareRegistrationFunction
class  MeanSquaresHistogramImageToImageMetric
 Computes mean squared difference similarity measure between two images to be registered. More...
class  MeanSquaresImageToImageMetric
 Computes similarity between two objects to be registered. More...
class  MeanSquaresPointSetToImageMetric
 Computes similarity between pixel values of a point set and intensity values of an image. More...
class  MeasurementVectorTraits
class  MedialNodePairCorrespondenceProcess
 This process takes as inputs two core atom images, the distance matrices of the two images, and the unary correspondence matrix between the two images in order to produce an itkCorrespondenceDataStructure containing correspondences between pairs (node cliques of size 2) in the images. More...
class  MedialNodeTripletCorrespondenceProcess
 This process takes as inputs two core atom images, a pair correspondence data structure for the two images, and the distance matrices of the two images in order to produce an itkCorrespondenceDataStructure containing correspondences between triplets (node cliques of size 3) in the images. 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  MedianProjectionImageFilter
 Median projection. More...
class  MemberCommand
 Command subclass that calls a pointer to a member function. More...
class  MemoryProbe
 Class for computing the memory allocated between two points in the code. More...
class  MemoryProbesCollectorBase
 Class for aggregating a set of memory probes. More...
class  MemoryUsageObserverBase
class  MergeLabelMapFilter
 Merges two Label Maps using different methods to create the product. 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  MeshSpatialObject
 Implementation of an Mesh as spatial object. More...
class  MeshToMeshFilter
 MeshToMeshFilter is the base class for all process objects that output mesh data, and require mesh data as input. Specifically, this class defines the SetInput() method for defining the input to a filter. More...
class  MetaArrayReader
class  MetaArrayWriter
class  MetaArrowConverter
class  MetaBlobConverter
class  MetaContourConverter
class  MetaDataDictionary
class  MetaDataObject
class  MetaDataObjectBase
 The MetaDataObjectBase class is designed as the common interface for MetaDataObject's. This class is intended as the value part of the (key,value) pair to be stored in a MetaDataDictionary. More...
class  MetaDTITubeConverter
class  MetaEllipseConverter
class  MetaEvent
 Event abstract class. More...
class  MetaGaussianConverter
class  MetaGroupConverter
class  MetaImageConverter
class  MetaImageIO
 Read MetaImage file format. More...
class  MetaImageIOFactory
 Create instances of MetaImageIO objects using an object factory. More...
class  MetaLandmarkConverter
class  MetaLineConverter
class  MetaMeshConverter
class  MetaSceneConverter
class  MetaSurfaceConverter
class  MetaTubeConverter
class  MetaVesselTubeConverter
class  MINC2ImageIO
 Class that defines how to read MINC2 file format. Note,like ITK, MINC2 is N dimensional and dimensions can be submitted in any arbitrary order. Here we make sure the dimensions are ordered as xspace, yspace, zspace, time and vector_dimension and so on or xfrequencey, yfrequency, zfrequency, tfrequency and vector_dimension and so on NOTE** This class only reads the regularly sampled dimensions as I am not sure how to deal with "iregularly sampled" dimensions yet! More...
class  MINC2ImageIOFactory
 Create instances of MINC2ImageIO objects using an object factory. More...
class  MinFunctor
class  MinimumDecisionRule
 A Decision rule that choose the class that has minimum value. More...
class  MinimumImageFilter
 Implements a pixel-wise operator Min(a,b) between two images. More...
class  MinimumMaximumImageCalculator
class  MinimumMaximumImageFilter
 Computes the minimum and the maximum intensity values of an image. More...
class  MinimumProjectionImageFilter
 Minimum projection. More...
class  MiniPipelineSeparableImageFilter
 A separable filter for filter which are using radius. More...
class  MinMaxCurvatureFlowFunction
class  MinMaxCurvatureFlowImageFilter
 Denoise an image using min/max curvature flow. More...
class  MinMeasureBoundCriterion
class  MinPriorityQueueElementWrapper
class  MIRegistrationFunction
class  MirrorPadImageFilter
 Increase the image size by padding with replicants of the input image value. More...
class  ModifiedEvent
class  ModulusImageFilter
 Computes the modulus (x % dividend) pixel-wise. More...
class  MorphologicalGradientImageFilter
 Morphological gradients enhance the variation of pixel intensity in a given neighborhood. More...
class  MorphologicalWatershedFromMarkersImageFilter
 Morphological watershed transform from markers. More...
class  MorphologicalWatershedImageFilter
 TODO. More...
class  MorphologyHistogram
class  MorphologyHistogramMap
class  MorphologyHistogramVec
class  MorphologyImageFilter
 Base class for the morphological operations such as erosion and dialation. More...
class  MovingHistogramDilateImageFilter
 gray scale dilation of an image More...
class  MovingHistogramErodeImageFilter
 gray scale erosion of an image More...
class  MovingHistogramImageFilter
 Implements a generic moving histogram algorithm. More...
class  MovingHistogramImageFilterBase
 Implements a generic moving histogram algorithm. More...
class  MovingHistogramMorphologicalGradientImageFilter
 Morphological gradients enhance the variation of pixel intensity in a given neighborhood. More...
class  MovingHistogramMorphologyImageFilter
 base class for MovingHistogramDilateImageFilter and MovingHistogramErodeImageFilter More...
class  MRASlabIdentifier
 identifies slab in MR images comparing minimum intensity averages More...
class  MRCHeaderObject
 This class is a light wrapper for a couple of plain old data structures, so that they can be utilized in a MetaDataDictionary. More...
class  MRCImageIO
 An ImageIO class to read the MRC file format. The MRC file format frequently has the extension ".mrc" or ".rec". It is used frequently for electron microscopy and is an emerging standard for cryo-electron tomography and molecular imaging. The format is used to represent 2D, 3D images along with 2D tilt series for tomography. More...
class  MRCImageIOFactory
 Create instances of MRCImageIO objects using an object factory. 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  MultiphaseDenseFiniteDifferenceImageFilter
class  MultiphaseFiniteDifferenceImageFilter
class  MultiphaseSparseFiniteDifferenceImageFilter
 This class implements a finite difference partial differential equation solver for evolving surfaces embedded in volumes as level-sets. More...
class  MultipleLogOutput
 Class MultipleLogOutput allows writing simultaneously to multiple streams. Note that the class derives from std::streambuf and contains a std::set<> of LogOutput. More...
class  MultipleValuedCostFunction
 This class is a base for the CostFunctions returning a multiple values. 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 multi-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  MultiplyByConstantImageFilter
 Multiply input pixels by a constant. More...
class  MultiplyImageFilter
 Implements an operator for pixel-wise multiplication of two images. More...
class  MultiResolutionImageRegistrationMethod
 Base class for multi-resolution image registration methods. More...
class  MultiResolutionPDEDeformableRegistration
 Framework for performing multi-resolution PDE deformable registration. More...
class  MultiResolutionPyramidImageFilter
 Framework for creating images in a multi-resolution pyramid. More...
class  MultiScaleHessianBasedMeasureImageFilter
 A filter to enhance structures using Hessian eigensystem-based measures in a multiscale framework. More...
class  MultiThreader
 A class for performing multithreaded execution. More...
class  MultivariateLegendrePolynomial
 2D and 3D multivariate Legendre Polynomial More...
class  MutexLock
 Mutual exclusion locking class. More...
class  MutexLockHolder
class  MutualInformationHistogramImageToImageMetric
 Computes the mutual information between two images to be registered using the histograms of the intensities in the images. This class is templated over the type of the fixed and moving images to be compared. More...
class  MutualInformationImageToImageMetric
 Computes the mutual information between two images to be registered. More...
class  NarrowBand
class  NarrowBandCurvesLevelSetImageFilter
 Segments structures in images based on user supplied edge potential map. More...
class  NarrowBandImageFilterBase
 This class implements a multi-threaded finite difference image to image solver that can be applied to an arbitrary list of pixels. More...
class  NarrowBandLevelSetImageFilter
 A base class which defines the API for implementing a special class of image segmentation filters using level set methods. More...
class  NarrowBandThresholdSegmentationLevelSetImageFilter
 Segments structures in images based on intensity values. More...
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  NaryMaximumImageFilter
 Implements an operator computing the pixel-wise maximum of several images. More...
class  NCCRegistrationFunction
class  NearestNeighborExtrapolateImageFunction
 Nearest neighbor extrapolation of a scalar image. 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  NeighborhoodAccessorFunctor
 Provides accessor interfaces to Get pixels and is meant to be used on pointers contained within Neighborhoods. A typical user should not need to use this class directly. This class is used by the neighborhood iterators to get pixels from pixel pointers or assign a pixel to an address. 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  NeighborhoodOperatorImageFunction
 Compute the convolution of a neighborhood operator with the image at a specific location in space, i.e. point, index or continuous index. This class is templated over the input image type. More...
class  NeuralNetworkFileReader
 Reader for Neural Network. More...
class  NeuralNetworkFileWriter
 Writer for Neural Network. More...
class  NiftiImageIO
 Class that defines how to read Nifti file format. Nifti IMAGE FILE FORMAT - As much information as I can determine from sourceforge.net/projects/Niftilib. More...
class  NiftiImageIOFactory
 Create instances of NiftiImageIO objects using an object factory. More...
class  NodeList
 Stores secondary lists of nodes with pointers to the contained items. More...
class  NodeOfPermutation
class  NoEvent
class  NoiseImageFilter
 Calculate the local noise in an image. More...
class  NonLinearOptimizer
 Wrap of the vnl_nonlinear_minimizer to be adapted. More...
class  NonThreadedShrinkImageFilter
 Reduce the size of an image by an integer factor. More...
class  NonUniformBSpline
 BSpline with nonuniform knot spacing. More...
class  NormalBandNode
 This is a data storage class that can is used as the node type for the SparseImage class. More...
class  NormalizedCorrelationImageFilter
 Computes the normalized correlation of an image and a template. More...
class  NormalizedCorrelationImageToImageMetric
 Computes similarity between two images to be registered. More...
class  NormalizedCorrelationPointSetToImageMetric
 Computes similarity between pixel values of a point set and intensity values of an image. More...
class  NormalizedMutualInformationHistogramImageToImageMetric
 Computes normalized mutual information between two images to be registered using the histograms of the intensities in the images. More...
class  NormalizeImageFilter
 Normalize an image by setting its mean to zero and variance to one. More...
class  NormalVectorDiffusionFunction
 This class defines all the necessary functionality for performing isotropic and anisotropic diffusion operations on vector neighborhoods from a sparse image. More...
class  NormalVectorFunctionBase
 This class defines the common functionality for Sparse Image neighborhoods of unit vectors. More...
class  NotImageFilter
 Implements the NOT logical operator pixel-wise on an image. More...
class  NrrdImageIO
 Read and write the "Nearly Raw Raster Data" (Nrrd) image format. The Nrrd format was developed as part of the Teem package (teem.sourceforge.net). More...
class  NrrdImageIOFactory
 Create instances of NrrdImageIO objects using an object factory. More...
class  NthElementImageAdaptor
 Presents an image as being composed of the N-th element of its pixels. More...
class  NthElementImageAdaptorHelper
class  NthElementPixelAccessor
 Give access to the N-th of a Container type. More...
class  NumberOfFacesCriterion
class  NumberOfPointsCriterion
class  NumericSeriesFileNames
 Generate an ordered sequence of filenames. 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  Octree
 represent a 3D Image with an Octree data structure. More...
class  OctreeBase
 Provides non-templated access to templated instances of Octree. More...
class  OctreeNode
class  OctreeNodeBranch
class  Offset
 Represent the offset between two n-dimensional indexes in a n-dimensional image. More...
class  OnePlusOneEvolutionaryOptimizer
 1+1 evolutionary strategy optimizer More...
class  OnesMatrixCoefficients
 Compute a matrix filled by 1s wherever two vertices are connected by an edge. More...
class  OneWayEquivalencyTable
 Hash table to manage integral label equivalencies that are order dependent. More...
class  OpeningByReconstructionImageFilter
 Opening by reconstruction of an image. More...
class  Optimizer
 Generic representation for an optimization method. More...
class  OrientationAdapterBase
 base class that converts Orientation representations to direction cosines. More...
class  OrientedImage
 Templated n-dimensional oriented image class. More...
class  OrientImageFilter
 Permute axes and then flip images as needed to obtain agreement in coordinateOrientation codes. More...
class  OrImageFilter
 Implements the OR logical operator pixel-wise between two images. More...
class  OrthogonallyCorrected2DParametricPath
 Represent an orthogonally corrected 2D parametric path. More...
class  OrthogonalSwath2DPathFilter
 Filter that optimizes a 2D path relative to an image. More...
class  OStringStream
class  OtsuMultipleThresholdsCalculator
 Computes Otsu's thresholds for a histogram. More...
class  OtsuMultipleThresholdsImageFilter
 Threshold an image using multiple Otsu Thresholds. More...
class  OtsuThresholdImageCalculator
 Computes the Otsu's threshold for an image. More...
class  OtsuThresholdImageFilter
 Threshold an image using the Otsu Threshold. More...
class  OutputWindow
 Messages sent from the system are collected by this object. More...
class  PadImageFilter
 Increase the image size by padding. Superclass for filters that fill in extra pixels. More...
class  PadLabelMapFilter
 Pad a LabelMap image. More...
struct  par_parameter
class  ParallelSparseFieldCityBlockNeighborList
 A convenience class for storing indicies which reference neighbor pixels within a neighborhood. More...
class  ParallelSparseFieldLevelSetImageFilter
 This class implements a finite difference partial differential equation solver for evolving surfaces embedded in volumes as level-sets. More...
class  ParallelSparseFieldLevelSetNode
class  ParametricPath
 Represent a parametric path through ND Space. More...
class  ParametricSpaceToImageSpaceMeshFilter
 ParametricSpaceToImageSpaceMeshFilter takes an itk::Mesh on which the point Data is expected to contain itk::Index of itk::Image pixels associated with each point of the Mesh, and construct with them a new mesh whose points are in the coordinates of those pixels. More...
class  PasteImageFilter
 Paste an image into another image. More...
class  Path
 Represent a path through ND Space. More...
class  PathAndImageToPathFilter
 Base class for filters that take both a path and an image as input and produce a path as output. More...
class  PathConstIterator
 PathConstIterator iterates (traces) over a path through an image. More...
class  PathIterator
 PathIterator iterates (traces) over a path through an image. More...
class  PathSource
 Base class for all process objects that output path data. More...
class  PathToChainCodePathFilter
 Filter that produces a chain code version of a path. More...
class  PathToImageFilter
 Base class for filters that take a Path as input and produce an image as output. Base class for filters that take a Path 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 path's bounding box is used. The default spacing of the image is given by the spacing of the input path (currently assumed internally to be 1.0). More...
class  PathToPathFilter
 Base class for filters that take a path as input and produce a path as output. More...
class  PCAShapeSignedDistanceFunction
 Compute the signed distance from a N-dimensional PCA Shape. More...
class  PDEDeformableRegistrationFilter
 Deformably register two images using a PDE algorithm. More...
class  PDEDeformableRegistrationFunction
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  PhasedArray3DSpecialCoordinatesImage
 Templated 3D nonrectilinear-coordinate image class for phased-array "range" images. More...
class  PhilipsPAR
 Class for reading parameters from a Philips PAR file. More...
class  PhilipsRECImageIO
 Class that defines how to read Philips REC/PAR image files. This class supports reading only and not writing. More...
class  PhilipsRECImageIOFactory
 Create instances of PhilipsRECImageIO objects using an object factory. More...
class  PickEvent
class  PixelAccessor
 Give access to partial aspects of a type. More...
class  PlaneSpatialObject
class  PNGImageIO
 ImageIO object for reading and writing PNG images. More...
class  PNGImageIOFactory
 Create instances of PNGImageIO objects using an object factory. More...
class  Point
 A templated class holding a geometric point in n-Dimensional space. More...
class  Point1D
class  PointBasedSpatialObject
 This class serves as the base class for point-based spatial objects. 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  PointSetToImageFilter
 Base class for filters that take a PointSet 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 point-set's bounding box is used. More...
class  PointSetToImageMetric
 Computes similarity between a point set and an image. More...
class  PointSetToImageRegistrationMethod
 Base class for PointSet to Image Registration Methods. More...
class  PointSetToPointSetMetric
 Computes similarity between two point sets. More...
class  PointSetToPointSetRegistrationMethod
 Base class for PointSet to PointSet Registration Methods. More...
class  PointSetToSpatialObjectDemonsRegistration
 Implementation of Demons Registration between a PointSet and a SpatialObject. More...
class  PolygonCell
class  PolygonGroupSpatialObject
 Implements a Region Of Interest Type. More...
class  PolygonGroupSpatialObjectXMLFileReader
class  PolygonGroupSpatialObjectXMLFileWriter
class  PolygonSpatialObject
 TODO. More...
class  PolylineMask2DImageFilter
 Implements 2D image masking operation constrained by a contour. More...
class  PolylineMaskImageFilter
 Implements image masking operation constrained by a polyline on a plane perpendicular to certain viewing direction. More...
class  PolyLineParametricPath
 Represent a path of line segments through ND Space. More...
class  PostOrderTreeIterator
class  PowellOptimizer
 Implements Powell optimization using Brent line search. More...
class  PreOrderTreeIterator
class  PriorityQueueContainer
class  ProcessObject
 ProcessObject is the base class for all process objects (source, filters, mappers) in the Insight data processing pipeline. More...
class  ProgressAccumulator
 Facilitates progress reporting for filters that wrap around multiple other filters. More...
class  ProgressEvent
class  ProgressReporter
 Implements progress tracking for a filter. More...
class  ProjectionImageFilter
 Implements an accumulation of an image along a selected direction. More...
class  QuadEdge
 Base class for the implementation of a quad-edge data structure as proposed in "Guibas and Stolfi 1985". More...
class  QuadEdgeMesh
 Mesh class for 2D manifolds embedded in ND space. More...
class  QuadEdgeMeshBaseIterator
 Base iterator class for QuadEdgeMesh. More...
class  QuadEdgeMeshBorderTransform
 Transform the mandatoryly unique border of an itkQE::Mesh into either a circle (conformal) or a square (arclenght-wise). More...
class  QuadEdgeMeshBoundaryEdgesMeshFunction
 Build a list of references to edges (as GeometricalQuadEdge::RawPointer) each one representing a different boundary component. More...
class  QuadEdgeMeshCleanFilter
class  QuadEdgeMeshConstFrontIterator
 Const quad edge mesh front iterator. More...
class  QuadEdgeMeshConstIterator
 Const iterator for QuadEdgeMesh. More...
class  QuadEdgeMeshConstIteratorGeom
 Const geometrical iterator. More...
class  QuadEdgeMeshDecimationCriterion
class  QuadEdgeMeshDecimationFilter
class  QuadEdgeMeshDecimationQuadricElementHelper
 TODO explicit specification for VDimension=3!!! More...
class  QuadEdgeMeshDelaunayConformingFilter
 FIXME Add documentation. More...
class  QuadEdgeMeshDiscreteCurvatureEstimator
 FIXME. More...
class  QuadEdgeMeshDiscreteCurvatureTensorEstimator
 FIXME Add documentation here. More...
class  QuadEdgeMeshDiscreteGaussianCurvatureEstimator
 see the following paper title: Discrete Differential-Geometry Operators for Triangulated 2-Manifolds authors: Mark Meyer, Mathieu Desbrun, Peter Schroder, Alan H. Barr conference: VisMath '02 location: Berlin (Germany) More...
class  QuadEdgeMeshDiscreteMaxCurvatureEstimator
 FIXME Add documentation here. More...
class  QuadEdgeMeshDiscreteMeanCurvatureEstimator
 see the following paper title: Discrete Differential-Geometry Operators for Triangulated 2-Manifolds authors: Mark Meyer, Mathieu Desbrun, Peter Schroder, Alan H. Barr conference: VisMath '02 location: Berlin (Germany) More...
class  QuadEdgeMeshDiscreteMinCurvatureEstimator
 FIXME add documentation here. More...
class  QuadEdgeMeshDiscretePrincipalCurvaturesEstimator
 FIXME add documentation here. More...
class  QuadEdgeMeshEdgeMergeDecimationFilter
class  QuadEdgeMeshEulerOperatorCreateCenterVertexFunction
class  QuadEdgeMeshEulerOperatorDeleteCenterVertexFunction
class  QuadEdgeMeshEulerOperatorFlipEdgeFunction
class  QuadEdgeMeshEulerOperatorJoinFacetFunction
class  QuadEdgeMeshEulerOperatorJoinVertexFunction
class  QuadEdgeMeshEulerOperatorSplitEdgeFunction
class  QuadEdgeMeshEulerOperatorSplitFacetFunction
class  QuadEdgeMeshEulerOperatorSplitVertexFunction
class  QuadEdgeMeshExtendedTraits
 Extended traits for a itkQE::Mesh. More...
class  QuadEdgeMeshFrontBaseIterator
 Front iterator on Mesh class. More...
class  QuadEdgeMeshFrontIterator
 Non const quad edge front iterator. More...
class  QuadEdgeMeshFunctionBase
class  QuadEdgeMeshIterator
 Non const iterator for QuadMesh. More...
class  QuadEdgeMeshIteratorGeom
 Non const geometrical iterator. More...
class  QuadEdgeMeshLineCell
 Class that connects the QuadEdgeMesh with the Mesh. More...
class  QuadEdgeMeshParam
 Compute a planar parameterization of the input mesh. More...
class  QuadEdgeMeshPoint
 Wrapper around a itk::Point in order to add a reference to an entry in the edge ring. More...
class  QuadEdgeMeshPolygonCell
class  QuadEdgeMeshQuadricDecimation
class  QuadEdgeMeshScalarDataVTKPolyDataWriter
class  QuadEdgeMeshSmoothing
 Quad Edge Mesh Smoothing Filter. More...
class  QuadEdgeMeshSquaredEdgeLengthDecimation
class  QuadEdgeMeshTopologyChecker
 Make some basic checks in order to verify that the considered mesh is not degenerated and correctly represents a surface with a potential boundary. More...
class  QuadEdgeMeshToQuadEdgeMeshFilter
 Duplicates the content of a Mesh. More...
class  QuadEdgeMeshTraits
 Class holding the traits of the QuadEdgeMesh. More...
class  QuadEdgeMeshZipMeshFunction
class  QuadraticEdgeCell
class  QuadraticTriangleCell
class  QuadraticTriangleCellTopology
class  QuadrilateralCell
class  QuadrilateralCellTopology
class  QuaternionOrientationAdapter
 converts QuaternionOrientation flags to/from direction cosines More...
class  QuaternionRigidTransform
 QuaternionRigidTransform of a vector space (e.g. space coordinates). More...
class  QuaternionRigidTransformGradientDescentOptimizer
 Implement a gradient descent optimizer. More...
class  RandomImageSource
 Generate an n-dimensional image of random pixel values. More...
class  RandomPermutation
class  RankHistogram
class  RankHistogramMap
class  RankHistogramVec
class  RankImageFilter
 Rank filter of a greyscale image. More...
class  RawImageIO
 Read and write raw binary images. More...
class  RawImageIOFactory
class  RayCastInterpolateImageFunction
 Projective interpolation of an image at specified positions. More...
class  RealAndImaginaryToComplexImageFilter
 Implements pixel-wise conversion of real and imaginar data into complex voxels. More...
class  RealTimeClock
 The RealTimeClock provides a timestamp from a real-time clock. More...
class  ReceptorMemberCommand
 Command subclass that calls a pointer to a member function. More...
class  ReconstructionByDilationImageFilter
 grayscale reconstruction by dilation of an image More...
class  ReconstructionByErosionImageFilter
 grayscale reconstruction by erosion of an image More...
class  ReconstructionImageFilter
 Performs a grayscale geodesic reconstruction -- for performance comparison with GrayscaleGeodesicDilateImageFilter. More...
class  RecursiveGaussianImageFilter
 Base class for computing IIR convolution with an approximation of a Gaussian kernel. More...
class  RecursiveMultiResolutionPyramidImageFilter
 Creates a multi-resolution pyramid using a recursive implementation. 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
 Multi-dimensional image iterator which only walks a region. More...
class  ReflectiveImageRegionIterator
 Multi-dimensional image iterator which only walks a region. More...
class  Region
 A region represents some portion or piece of data. More...
class  RegionalMaximaImageFilter
 Produce a binary image where foreground is the regional maxima of the input image. More...
class  RegionalMinimaImageFilter
 Produce a binary image where foreground is the regional minima of the input image. More...
class  RegionBasedLevelSetFunction
 LevelSet function that computes a speed image based on regional integrals. More...
class  RegionBasedLevelSetFunctionData
 Helper class used to share data in the ScalarChanAndVeseLevelSetFunction. More...
class  RegionBasedLevelSetFunctionSharedData
 Helper class used to share data in the ScalarChanAndVeseLevelSetFunction. More...
class  RegionFromReferenceLabelMapFilter
 Set the region from a reference image. More...
class  RegionGrowImageFilter
 Base class for RegionGrowImageFilter object. More...
class  RegionOfInterestImageFilter
 Extract a region of interest from the input image. More...
class  RegularExpressionSeriesFileNames
 Generate an ordered sequence of filenames that match a regular expression. More...
class  RegularizedHeavisideStepFunction
 Base class of the Regularized (smoothed) Heaviside functions. More...
class  RegularSphereMeshSource
 Inputs are the center of the mesh, the scale (radius in each dimension) of the mesh and a resolution parameter, which corresponds to the recursion depth whlie creating a spherical triangle mesh. More...
class  RegularStepGradientDescentBaseOptimizer
 Implement a gradient descent optimizer. More...
class  RegularStepGradientDescentOptimizer
 Implement a gradient descent optimizer. More...
class  ReinitializeLevelSetImageFilter
 Reinitialize the level set to the signed distance function. More...
class  RelabelComponentImageFilter
 Relabel the components in an image such that consecutive labels are used. More...
class  RelabelLabelMapFilter
 This filter relabels the LabelObjects; the new labels are arranged consecutively with consideration for the background value. More...
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  ResourceProbe
 Class for computing the change of a value between two points in the code. More...
class  ResourceProbesCollectorBase
 Class for aggregating a set of probes. More...
class  RGBAPixel
 Represent Red, Green, Blue cand Alpha component for color images. More...
class  RGBGibbsPriorFilter
 RGBGibbsPriorFilter applies Gibbs Prior model for the segmentation of MRF images. The core of the method is based on the minimization of a Gibbsian energy function. This energy function f can be divided into three part: f = f_1 + f_2 + f_3; f_1 is related to the object homogeneity, f_2 is related to the boundary smoothness, f_3 is related to the constraint of the observation (or the noise model). The two force components f_1 and f_3 are minimized by the GradientEnergy method while f_2 is minized by the GibbsTotalEnergy method. More...
class  RGBPixel
 Represent Red, Green and Blue component for color images. More...
class  RGBToLuminanceImageAdaptor
 Presents a color image as being composed of the Luminance of its pixels. More...
class  RGBToLuminanceImageFilter
 Converts an RGB image into a grayscale image. 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  RobustAutomaticThresholdCalculator
 Compute the robust automatic threshold. More...
class  RobustAutomaticThresholdImageFilter
 Threshold an image using robust automatic threshold selection (RATS) method. More...
class  RootTreeIterator
class  ScalableAffineTransform
 Affine transformation with a specified center of rotation. More...
class  ScalarAnisotropicDiffusionFunction
class  ScalarChanAndVeseDenseLevelSetImageFilter
 Dense implementation of the Chan and Vese multiphase level set image filter. More...
class  ScalarChanAndVeseLevelSetFunction
 LevelSet function that computes a speed image based on regional integrals of probabilities. More...
class  ScalarChanAndVeseLevelSetFunctionData
 Helper class used to share data in the ScalarChanAndVeseLevelSetFunction. More...
class  ScalarChanAndVeseSparseLevelSetImageFilter
 Sparse implementation of the Chan and Vese multiphase level set image filter. More...
class  ScalarConnectedComponentImageFilter
 A connected components filter that labels the objects in an arbitrary image. Two pixels are similar if they are within threshold of each other. Uses ConnectedComponentFunctorImageFilter. More...
class  ScalarImageKmeansImageFilter
 Classifies the intensity values of a scalar image using the K-Means algorithm. More...
class  ScalarRegionBasedLevelSetFunction
 LevelSet function that computes a speed image based on regional integrals. More...
class  ScalarToArrayCastImageFilter
 Creates the output image with vector type pixels filled with the intensity values from one or more input images with scalar pixels. More...
class  ScalarToRGBColormapImageFilter
 Implements pixel-wise intensity->rgb mapping operation on one image. More...
class  ScalarVector
 A templated class holding bot scalar and vector values and responding to the GetScalar() and GetVector() methods. More...
class  ScaleLogarithmicTransform
 Logarithmic Scale transformation of a vector space (e.g. space coordinates). More...
class  ScaleSkewVersor3DTransform
 ScaleSkewVersor3DTransform of a vector space (e.g. space coordinates). More...
class  ScaleTransform
 Scale transformation of a vector space (e.g. space coordinates). More...
class  ScaleVersor3DTransform
 This transform applies a Versor rotation, translation and anisotropic scale to the space. More...
class  ScatterMatrixImageFunction
 Calculate the scatter matrix in the neighborhood of a pixel in a Vector image. More...
class  SceneSpatialObject
 a SceneSpatialObject has a list of SpatialObjects More...
class  SecondaryNodeList
 Stores corresponding lists of nodes with pointers to the contained items. More...
class  SegmentationBorder
 Base class for SegmentationBorder object. More...
class  SegmentationLevelSetFunction
class  SegmentationLevelSetImageFilter
 A base class which defines the API for implementing a special class of image segmentation filters using level set methods. More...
class  SegmentationRegion
 Base class for SegmentationRegion object. More...
class  Semaphore
 The semaphore class is used to synchronize execution between threads. More...
class  ShapeDetectionLevelSetFunction
 This function is used in the ShapeDetectionLevelSetImageFilter to segment structures in an image based on a user supplied edge potential map. More...
class  ShapeDetectionLevelSetImageFilter
 Segments structures in images based on a user supplied edge potential map. More...
class  ShapedFloodFilledFunctionConditionalConstIterator
 Iterates over a flood-filled spatial function. More...
class  ShapedFloodFilledImageFunctionConditionalConstIterator
 Iterates over a flood-filled image function. More...
class  ShapedFloodFilledImageFunctionConditionalIterator
 Iterates over a flood-filled image function. More...
class  ShapedNeighborhoodIterator
 A neighborhood iterator which can take on an arbitrary shape. More...
class  ShapeKeepNObjectsLabelMapFilter
 Keep N objects according to their shape attributes. More...
class  ShapeLabelMapFilter
 The valuator class for the ShapeLabelObject. More...
class  ShapeLabelObject
 A Label object to store the common attributes related to the shape of the object. More...
class  ShapeOpeningLabelMapFilter
 Remove objects according to the value of their shape attribute. More...
class  ShapePriorMAPCostFunction
 Represents the maximum aprior (MAP) cost function used ShapePriorSegmentationLevelSetImageFilter to estimate the shape paramaeters. More...
class  ShapePriorMAPCostFunctionBase
 Represents the base class of maximum aprior (MAP) cost function used ShapePriorSegmentationLevelSetImageFilter to estimate the shape paramaeters. More...
class  ShapePriorSegmentationLevelSetFunction
 This function is used in ShapePriorSegmentationLevelSetFilter to segment structures in an image based on user supplied edge potential map and shape model. More...
class  ShapePriorSegmentationLevelSetImageFilter
 A base class which defines the API for implementing a level set segmentation filter with statistical shape influence. More...
class  ShapeRelabelImageFilter
 relabel objects according to their shape attributes More...
class  ShapeRelabelLabelMapFilter
 Relabels objects according to their shape attributes. More...
class  ShapeSignedDistanceFunction
 Base class for functions which evaluates the signed distance from a shape. More...
class  ShapeUniqueLabelMapFilter
 Remove some pixels in the label object according to the value of their shape attribute to ensure that a pixel is not in to objects. More...
class  ShiftScaleImageFilter
 Shift and scale the pixels in an image. More...
class  ShiftScaleInPlaceImageFilter
 Shift and scale the pixels in an image. More...
class  ShiftScaleLabelMapFilter
 Shifts and scales a label map filter, giving the option to change the background value. More...
class  ShrinkImageFilter
 Reduce the size of an image by an integer factor in each dimension. More...
class  SiemensVisionImageIO
 Class that defines how to read SiemensVision file format. More...
class  SiemensVisionImageIOFactory
 Create instances of SiemensVisionImageIO objects using an object factory. More...
class  SigmoidImageFilter
 Computes the sigmoid function pixel-wise. More...
class  SignedDanielssonDistanceMapImageFilter
class  SignedMaurerDistanceMapImageFilter
 This filter calculates the squared Euclidean distance transform of a binary image in linear time for arbitrary dimensions. More...
class  Similarity2DTransform
 Similarity2DTransform of a vector space (e.g. space coordinates). More...
class  Similarity3DTransform
 Similarity3DTransform of a vector space (e.g. space coordinates). More...
class  SimilarityIndexImageFilter
 Measures the similarity between the set of non-zero pixels of two images. More...
class  SimpleConstMemberCommand
 Command subclass that calls a pointer to a member function. More...
class  SimpleContourExtractorImageFilter
 Computes an image of contours from. More...
class  SimpleDataObjectDecorator
 Decorates any "simple" data type (data types without smart pointers) with a DataObject API. More...
class  SimpleFastMutexLock
 Critical section locking class that can be allocated on the stack. More...
class  SimpleFilterWatcher
 Simple mechanism for monitoring the pipeline events of a filter and reporting these events to std::cout. More...
class  SimpleFuzzyConnectednessImageFilterBase
 Base class for FuzzyConnectednessImageFilter object. More...
class  SimpleFuzzyConnectednessRGBImageFilter
 Perform segmentation on RGB images using method of fuzzy connectedness. More...
class  SimpleFuzzyConnectednessScalarImageFilter
 Perform segmentation on grayscale images using method of fuzzy connectedness. More...
class  SimpleMemberCommand
 Command subclass that calls a pointer to a member function. More...
class  SimpleMutexLock
 Simple mutual exclusion locking class. More...
class  SimplexMesh
 The class represents a 2-simplex mesh. More...
class  SimplexMeshAdaptTopologyFilter
 This filter changes the topology of a 2-simplex mesh. More...
class  SimplexMeshGeometry
 handle geometric properties for vertices of a simplx mesh More...
class  SimplexMeshToTriangleMeshFilter
 This filter converts a 2-simplex mesh into a triangle mesh. More...
class  SimplexMeshVolumeCalculator
 Adapted from itkSimplexMeshToTriangleFilter to calculate the volume of a simplex mesh using the barycenters and normals. call Compute() to calculate the volume and GetVolume() to get the value. For an example see itkDeformableSimplexMesh3DFilter.cxx (Thomas Boettger. Division Medical and Biological Informatics, German Cancer Research Center, Heidelberg.). 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  SinImageAdaptor
 Presents an image as being composed of the vcl_sin() of its pixels. More...
class  SinImageFilter
 Computes the vcl_sin(x) pixel-wise. More...
class  SinRegularizedHeavisideStepFunction
 Sin-based implementation of the Regularized (smoothed) Heaviside functions. More...
class  Size
 Represent the size (bounds) of a n-dimensional image. More...
class  SliceBySliceImageFilter
 Apply a filter or a pipeline slice by slice on an image. More...
class  SliceIterator
 A flexible iterator for itk containers(i.e. itk::Neighborhood) that support pixel access through operator[]. More...
class  SmapsData_2_6
 Read a smaps stream and return the memory usage information. Smaps files have been added since the linux kernel 2.6. More...
class  SmapsFileParser
 Read a smap file (typically located in /proc/PID/smaps) and extract the memory usage information. Any smaps data reader can be used in template as long as they implement a operator>>(istream&) and have GetXXXUsage() methods. More...
class  SmapsRecord
class  SmartPointer
 Implements transparent reference counting. More...
class  SmartPointerForwardReference
 Implements transparent reference counting in situations where forward references / cyclic include dependencies are a problem. More...
class  SmoothingRecursiveGaussianImageFilter
 Computes the smoothing of an image by convolution with the Gaussian kernels implemented as IIR filters. More...
class  SobelEdgeDetectionImageFilter
 A 2D or 3D edge detection using the Sobel operator. More...
class  SobelOperator
 A NeighborhoodOperator for performing a directional Sobel edge-detection operation * at a pixel location. More...
class  SparseFieldCityBlockNeighborList
 A convenience class for storing indicies which reference neighbor pixels within a neighborhood. More...
class  SparseFieldFourthOrderLevelSetImageFilter
 This class implements the fourth order level set PDE framework. 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  SparseImage
 This class implements a storage type for sparse image data. More...
class  SpatialFunction
 N-dimensional spatial function class. More...
class  SpatialFunctionImageEvaluatorFilter
 Evaluates a SpatialFunction onto a source image. More...
class  SpatialObject
 Implementation of the composite pattern. More...
class  SpatialObjectDuplicator
class  SpatialObjectFactory
 Create instances of SpatialObjects. More...
class  SpatialObjectFactoryBase
 Create instances of SpatialObjects. More...
class  SpatialObjectPoint
 Point used for spatial objets. More...
class  SpatialObjectProperty
class  SpatialObjectReader
 TODO. 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  SpatialObjectToImageStatisticsCalculator
class  SpatialObjectToPointSetFilter
 Base class for filters that take a SpatialObject as input and produce a PointSet as output. The pointset created is in physical space. More...
class  SpatialObjectTreeContainer
 Array class with size defined at construction time. More...
class  SpatialObjectTreeNode
 TODO. More...
class  SpatialObjectWriter
 TODO. More...
class  SpatialOrientationAdapter
 converts SpatialOrientation flags to/from direction cosines More...
class  SpecialCoordinatesImage
 Templated n-dimensional nonrectilinear-coordinate image base class. More...
class  SphereMeshSource
 Input the center and resolutions in 2 directions(verizon and horizon) to create a sphere-like deformable model. The cell on the surface is in the shape of triangular. More parameters are added to make the sphere mesh have global and local deform ability. More...
class  SphereSignedDistanceFunction
 Compute the signed distance from a N-dimensional sphere. More...
class  SphereSpatialFunction
 Spatial function implementation of a sphere. More...
class  SPSAOptimizer
 An optimizer based on simultaneous perturbation... More...
class  SqrtImageAdaptor
 Presents an image as being composed of the vcl_sqrt() of its pixels. More...
class  SqrtImageFilter
 Computes the vcl_sqrt(x) pixel-wise. More...
class  SquaredDifferenceImageFilter
 Implements pixel-wise the computation of squared difference. More...
class  SquareImageFilter
 Computes the square of the intensity values pixel-wise. More...
class  StandardDeviationProjectionImageFilter
 Mean projection. More...
class  STAPLEImageFilter
 The STAPLE filter implements the Simultaneous Truth and Performance Level Estimation algorithm for generating ground truth volumes from a set of binary expert segmentations. More...
class  StartEvent
class  StartPickEvent
class  StatisticsImageFilter
 Compute min. max, variance and mean of an Image. More...
class  StatisticsKeepNObjectsLabelMapFilter
 keep N objects according to their statistics attributes More...
class  StatisticsLabelMapFilter
 The valuator class for the ShapeLabelObject. More...
class  StatisticsLabelObject
 A Label object to store the common attributes related to the statistics of the object. More...
class  StatisticsOpeningLabelMapFilter
 remove the objects according to the value of their statistics attribute More...
class  StatisticsRelabelImageFilter
 relabel objects according to their shape attributes More...
class  StatisticsRelabelLabelMapFilter
 relabel objects according to their shape attributes More...
class  StatisticsUniqueLabelMapFilter
 Remove some pixels in the label object according to the value of their statistics attribute to ensure that a pixel is not in to objects. More...
class  StdStreamLogOutput
 Class StdStreamLogOutput represents a standard stream output stream. This class provides thread safety for the standard stream output stream. More...
class  StimulateImageIO
 ImageIO class for reading SDT/SPR (Stimulate) images This format is similar to a MetaImageIO file: The user should specify the .spr file (not the data file : .sdt). More...
class  StimulateImageIOFactory
 Create instances of StimulateImageIO objects using an object factory. More...
class  STLConstContainerAdaptor
class  STLContainerAdaptor
class  StochasticFractalDimensionImageFilter
 This filter computes the stochastic fractal dimension of the input image. More...
class  StreamingImageFilter
 Pipeline object to control data streaming for large data processing. More...
class  StreamingImageIOBase
 A base class for specific ImageIO file formats which support streaming. More...
class  StructHashFunction
 Generic hash function for an arbitrary struct (or class). More...
class  SubtractConstantFromImageFilter
 Subract a constant from all input pixels. More...
class  SubtractImageFilter
 Implements an operator for pixel-wise subtraction of two images. More...
class  SumOfSquaresImageFunction
 Calculate the sum of squares in the neighborhood of a pixel. More...
class  SumProjectionImageFilter
 Sum projection. More...
class  SurfaceSpatialObject
 Representation of a Surface based on the spatial object classes. More...
class  SurfaceSpatialObjectPoint
 Point used for a Surface definition. More...
class  SymmetricEigenAnalysis
 Find Eigen values of a real 2D symmetric matrix. It serves as a thread safe alternative to the class: vnl_symmetric_eigensystem, which uses netlib routines. More...
class  SymmetricEigenAnalysisImageFilter
 Computes the eigen-values of every input symmetric matrix pixel. More...
class  SymmetricEigenSystem
 wrapper of the vnl_symmetric_eigensystem algorithm More...
class  SymmetricEllipsoidInteriorExteriorSpatialFunction
class  SymmetricForcesDemonsRegistrationFilter
 Deformably register two images using the demons algorithm. More...
class  SymmetricForcesDemonsRegistrationFunction
class  SymmetricSecondRankTensor
 Represent a symmetric tensor of second rank. More...
class  SysResourceMemoryUsageObserver
class  TanImageAdaptor
 Presents an image as being composed of the vcl_tan() of its pixels. More...
class  TanImageFilter
 Computes the vcl_tan(x) pixel-wise. More...
class  TargetClass
class  TensorFractionalAnisotropyImageFilter
 Computes the Fractional Anisotropy for every pixel of a input tensor image. More...
class  TensorRelativeAnisotropyImageFilter
 Computes the Relative Anisotropy for every pixel of a input tensor image. 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...
class  TetrahedronCell
class  TetrahedronCellTopology
class  TextOutput
class  ThinPlateR2LogRSplineKernelTransform
class  ThinPlateSplineKernelTransform
class  ThreadLogger
 Class ThreadLogger is meant for providing logging service as a separate thread. More...
class  ThresholdImageFilter
 Set image values to a user-specified value if they are below, above, or between simple threshold values. More...
class  ThresholdLabelerImageFilter
 Label an input image according to a set of thresholds. More...
class  ThresholdMaximumConnectedComponentsImageFilter
 Finds the threshold value of an image based on maximizing the number of objects in the image that are larger than a given minimal size. More...
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  TIFFImageIO
 ImageIO object for reading and writing TIFF images. More...
class  TIFFImageIOFactory
 Create instances of TIFFImageIO objects using an object factory. More...
class  TileImageFilter
 Tile multiple input images into a single output image. More...
class  TimeProbe
 Class for computing the time passed between two points in the code. More...
class  TimeProbesCollectorBase
 Class for aggregating a set of time probes. More...
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  TransformBase
class  TransformFactory
 Create instances of Transforms. More...
class  TransformFactoryBase
 Create instances of Transforms. More...
class  TransformFileReader
 TODO. More...
class  TransformFileWriter
 TODO. More...
class  TransformIOBase
 Abstract superclass defining the Transform IO interface. More...
class  TransformIOFactory
 Create instances of TransformIO objects using an object factory. More...
class  TransformMeshFilter
 TransformMeshFilter applies a transform to all the points of a mesh. More...
class  TransformToDeformationFieldSource
 Generate a deformation field from a coordinate transform. More...
class  TranslationTransform
 Translation transformation of a vector space (e.g. space coordinates). More...
class  TreeAddEvent
 This class derives from TreeChangeEvent and check if a node has been added to the tree. More...
class  TreeChangeEvent
 This class derives from ModifiedEvent and check if the position of a node in the tree has been changed. More...
class  TreeContainer
 TreeContainer class. More...
class  TreeContainerBase
class  TreeIteratorBase
 TreeIteratorBase class. More...
class  TreeIteratorClone
class  TreeNode
 TreeNode class. More...
class  TreeNodeChangeEvent
class  TreePruneEvent
class  TreeRemoveEvent
 This class derives from TreeChangeEvent and check if a node has been removed from the tree. More...
class  TriangleCell
class  TriangleCellTopology
class  TriangleHelper
 Convenient class for various triangles elements computation in 2D or 3D. More...
class  TriangleMeshToBinaryImageFilter
 3D Rasterization algorithm Courtesy of Dr David Gobbi of Atamai Inc. More...
class  TriangleMeshToSimplexMeshFilter
 This filter converts a triangle mesh into a 2-simplex mesh. More...
class  TubeSpatialObject
 Representation of a tube based on the spatial object classes. More...
class  TubeSpatialObjectPoint
 Point used for a tube definition. More...
class  TwoOutputExampleImageFilter
 Example of a filter that produce two outputs. More...
class  TxtTransformIO
class  TxtTransformIOFactory
 Create instances of TxtTransformIO objects using an object factory. More...
class  UnaryCorrespondenceMatrix
 A matrix used to store the Unary Metric for medial node comparisons between two images. More...
class  UnaryFunctorImageFilter
 Implements pixel-wise generic operation on one image. More...
class  UnaryMedialNodeMetric
 Compares the scale and dimensionality of two medial nodes. More...
class  UnconstrainedRegionBasedLevelSetFunctionSharedData
 Helper class used to share data in the ScalarChanAndVeseLevelSetFunction. More...
class  UnsharpMaskLevelSetImageFilter
 This class implements a detail enhancing filter by making use of the 4th-order level set isotropic diffusion (smoothing) PDE. More...
class  UserEvent
class  ValarrayImageContainer
class  ValuedRegionalExtremaImageFilter
 Uses a flooding algorithm to set all voxels that are not a regional extrema to the max or min of the pixel type. More...
class  ValuedRegionalMaximaImageFilter
 Transforms the image so that any pixel that is not a regional maxima is set to the minimum value for the pixel type. Pixels that are regional maxima retain their value. More...
class  ValuedRegionalMinimaImageFilter
 Transforms the image so that any pixel that is not a regional minima is set to the maximum value for the pixel type. Pixels that are regional minima retain their value. More...
class  VanHerkGilWermanDilateImageFilter
class  VanHerkGilWermanErodeDilateImageFilter
 class to implement erosions and dilations using anchor methods. This is the base class that must be instantiated with appropriate definitions of greater, less and so on. The SetBoundary facility isn't necessary for operation of the anchor method but is included for compatability with other morphology classes in itk. More...
class  VanHerkGilWermanErodeImageFilter
class  VariableLengthVector
 VariableLengthVector is intended to represent an array whose length can be defined at run-time. More...
class  VariableSizeMatrix
 A templated class holding a M x N size Matrix This class contains a vnl_matrix in order to make all the vnl mathematical methods available. This class is meant to be used when the matrix length cannot be determined at compile time. More...
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  VectorCentralDifferenceImageFunction
 Calculate the derivative by central differencing. More...
class  VectorConfidenceConnectedImageFilter
 Segment pixels with similar statistics using connectivity. More...
class  VectorConnectedComponentImageFilter
 A connected components filter that labels the objects in a vector image. Two vectors are pointing similar directions if one minus their dot product is less than a threshold. Vectors that are 180 degrees out of phase are similar. Assumes that vectors are normalized. 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  VectorFuzzyConnectednessImageFilter
class  VectorGradientAnisotropicDiffusionImageFilter
class  VectorGradientMagnitudeImageFilter
 Computes a scalar, gradient magnitude image from a multiple channel (pixels are vectors) input. More...
class  VectorGradientNDAnisotropicDiffusionFunction
class  VectorImage
 Templated n-dimensional vector image class. More...
class  VectorImageNeighborhoodAccessorFunctor
 Provides accessor interfaces to Access pixels and is meant to be used on pointers to pixels held by the Neighborhood class. More...
class  VectorImageToImageAdaptor
 Presents a VectorImage and extracts a component from it into an image. More...
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  VectorLinearInterpolateNearestNeighborExtrapolateImageFunction
 Linearly interpolate or NN extrapolate a vector image at specified positions. More...
class  VectorMeanImageFunction
 Calculate the mean value in the neighborhood of a pixel in a Vector image. More...
class  VectorNearestNeighborInterpolateImageFunction
 Nearest neighbor 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  VectorResampleImageFilter
 Resample an image via a coordinate transform. More...
class  VectorRescaleIntensityImageFilter
 Applies a linear transformation to the magnitude of pixel vectors in a vector Image. More...
class  VectorThresholdSegmentationLevelSetFunction
 This function is used in VectorThresholdSegmentationLevelSetImageFilter to segment structures in images based on the Mahalanobis distance. More...
class  VectorThresholdSegmentationLevelSetImageFilter
 Segments structures in images based on intensity values. 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  VersorRigid3DTransformOptimizer
 Implement a gradient descent optimizer for the VersorRigid3DTransform parameter space. More...
class  VersorTransform
class  VersorTransformOptimizer
 Implement a gradient descent optimizer. More...
class  VertexCell
class  VesselTubeSpatialObject
 Representation of a tube based on the spatial object classes. More...
class  VesselTubeSpatialObjectPoint
 Point used for a tube definition. More...
class  VMMapData_10_2
class  VMMapFileParser
 Read the output of a vmmap command and extract the memory usage information. Used for MAC OS X machines. More...
class  VMMapRecord
class  VMMapSummaryRecord
class  VnlFFTComplexConjugateToRealImageFilter
 TODO. More...
class  VnlFFTRealToComplexConjugateImageFilter
 TODO. More...
class  VolumeSplineKernelTransform
class  VoronoiDiagram2D
 Implements the 2-Dimensional Voronoi Diagram. More...
class  VoronoiDiagram2DGenerator
 Implement the Sweep Line Algorithm for the construction of the 2D Voronoi Diagram. More...
class  VoronoiPartitioningImageFilter
class  VoronoiSegmentationImageFilter
class  VoronoiSegmentationImageFilterBase
 Base class for VoronoiSegmentationImageFilter. More...
class  VoronoiSegmentationRGBImageFilter
class  VotingBinaryHoleFillingImageFilter
 Fills in holes and cavities by applying a voting operation on each pixel. More...
class  VotingBinaryImageFilter
 Applies a voting operation in a neighborhood of each pixel. More...
class  VotingBinaryIterativeHoleFillingImageFilter
 Fills in holes and cavities by iteratively applying a voting operation. More...
class  VoxBoCUBImageIO
 Read VoxBoCUBImage file format. More...
class  VoxBoCUBImageIOFactory
 Create instances of VoxBoCUBImageIO objects using an object factory. More...
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  VTKImageIO2
 ImageIO class for reading VTK images. More...
class  VTKImageIO2Factory
 Create instances of VTKImageIO2 objects using an object factory. More...
class  VTKImageIOFactory
 Create instances of VTKImageIO objects using an object factory. More...
class  VTKPolyDataReader
 Reads a vtkPolyData file and create an itkMesh. More...
class  VTKPolyDataWriter
 Writes an itkMesh to a file in VTK file format. More...
class  WarpHarmonicEnergyCalculator
 Compute the harmonic energy of a deformation field. More...
class  WarpImageFilter
 Warps an image using an input deformation field. More...
class  WarpMeshFilter
 WarpMeshFilter applies a deformation field to all the points of a mesh. The deformation field is represented as an image of Vectors. More...
class  WarpVectorImageFilter
 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  WeightedAddImageFilter
 Implements an operator for computing a weighted sum of two images pixel-wise. More...
class  WhiteTopHatImageFilter
 White top hat extract local maxima that are larger than the structuring element. More...
class  Win32OutputWindow
 Collect error and debug messages on Win32-based systems. More...
class  WindowedSincInterpolateImageFunction
 Use the windowed sinc function to interpolate. More...
class  WrapPadImageFilter
 Increase the image size by padding with replicants of the input image value. More...
class  XMLFileOutputWindow
 Messages sent from the system are sent to a file with each message enclosed by XML tags. More...
class  XMLFilterWatcher
 Simple mechanism for monitoring the pipeline events of a filter and reporting these events to std::cout. Formats reports with xml. More...
class  XMLReader
class  XMLReaderBase
class  XMLWriterBase
class  XorImageFilter
 Implements the XOR logical operator pixel-wise between two images. 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...

Typedefs

typedef int FastMutexType
typedef std::vector< std::string > FilenamesContainer
typedef std::istream InputStreamType
typedef
::itksysFundamentalType_Int16 
int16_t
typedef
::itksysFundamentalType_Int32 
int32_t
typedef
::itksysFundamentalType_Int64 
int64_t
typedef
::itksysFundamentalType_Int8 
int8_t
typedef int16_t int_fast16_t
typedef int32_t int_fast32_t
typedef int64_t int_fast64_t
typedef int8_t int_fast8_t
typedef int16_t int_least16_t
typedef int32_t int_least32_t
typedef int64_t int_least64_t
typedef int8_t int_least8_t
typedef int64_t intmax_t
typedef ::ptrdiff_t intptr_t
typedef
itksys::DynamicLoader::LibraryHandle 
LibHandle
typedef int MutexType
typedef std::ostream OutputStreamType
typedef
PolygonGroupSpatialObject< 3 > 
PGroupSpatialObjectType
typedef int SemaphoreType
typedef std::vector< std::string > SerieUIDContainer
typedef
itksys::DynamicLoader::SymbolPointer 
SymbolPointer
typedef void(* ThreadFunctionType )(void *)
typedef int ThreadProcessIDType
typedef
::itksysFundamentalType_UInt16 
uint16_t
typedef
::itksysFundamentalType_UInt32 
uint32_t
typedef
::itksysFundamentalType_UInt64 
uint64_t
typedef
::itksysFundamentalType_UInt8 
uint8_t
typedef uint16_t uint_fast16_t
typedef uint32_t uint_fast32_t
typedef uint64_t uint_fast64_t
typedef uint8_t uint_fast8_t
typedef uint16_t uint_least16_t
typedef uint32_t uint_least32_t
typedef uint64_t uint_least64_t
typedef uint8_t uint_least8_t
typedef uint64_t uintmax_t
typedef ::vcl_size_t uintptr_t

Enumerations

enum  {
  B2_MASKFILE_BLACK = 0,
  B2_MASKFILE_WHITE = 1,
  B2_MASKFILE_GRAY = 2
}
enum  { num_primes = 28 }
enum  LeafIdentifier {
  ZERO = 0,
  ONE = 1,
  TWO = 2,
  THREE = 3,
  FOUR = 4,
  FIVE = 5,
  SIX = 6,
  SEVEN = 7
}
enum  OctreePlaneType
enum  PolygonGroupOrientation {
  Axial = 0,
  Coronal = 1,
  Sagittal = 2,
  UserPlane = 3,
  Unknown = 4
}

Functions

template<class TInputImage , class TOutputImage >
void BoxAccumulateFunction (const TInputImage *inputImage, const TOutputImage *outputImage, typename TInputImage::RegionType inputRegion, typename TOutputImage::RegionType outputRegion, ProgressReporter &progress)
template<class TInputImage , class TOutputImage >
void BoxMeanCalculatorFunction (const TInputImage *accImage, TOutputImage *outputImage, typename TInputImage::RegionType inputRegion, typename TOutputImage::RegionType outputRegion, typename TInputImage::SizeType Radius, ProgressReporter &progress)
template<class TInputImage , class TOutputImage >
void BoxSigmaCalculatorFunction (const TInputImage *accImage, TOutputImage *outputImage, typename TInputImage::RegionType inputRegion, typename TOutputImage::RegionType outputRegion, typename TInputImage::SizeType Radius, ProgressReporter &progress)
template<class TInputImage , class TOutputImage >
void BoxSquareAccumulateFunction (const TInputImage *inputImage, TOutputImage *outputImage, typename TInputImage::RegionType inputRegion, typename TOutputImage::RegionType outputRegion, ProgressReporter &progress)
template<class TLabelImage , class TIntensityImage , class TGenericImage >
bool CalculateOrientedImage (LabelGeometryImageFilter< TLabelImage, TIntensityImage > *filter, vnl_symmetric_eigensystem< double > eig, typename LabelGeometryImageFilter< TLabelImage, TIntensityImage >::LabelGeometry &labelGeometry, bool useLabelImage=true)
template<class TLabelImage , class TIntensityImage >
LabelGeometryImageFilter
< TLabelImage, TIntensityImage >
::MatrixType 
CalculateRotationMatrix (vnl_symmetric_eigensystem< double > eig)
template<class TInputMesh , class TOutputMesh >
void CopyMeshToMeshCellData (const TInputMesh *in, TOutputMesh *out)
template<class TInputMesh , class TOutputMesh >
void CopyMeshToMeshCells (const TInputMesh *in, TOutputMesh *out)
template<class TInputMesh , class TOutputMesh >
void CopyMeshToMeshEdgeCells (const TInputMesh *in, TOutputMesh *out)
template<class TInputMesh , class TOutputMesh >
void CopyMeshToMeshPointData (const TInputMesh *in, TOutputMesh *out)
template<class TInputMesh , class TOutputMesh >
void CopyMeshToMeshPoints (const TInputMesh *in, TOutputMesh *out)
template<class ImType >
std::vector< typename
ImType::OffsetType > 
CornerOffsets (const ImType *im)
ITKCommon_EXPORT Vector
< double, 3 > 
CrossProduct (const Vector< double, 3 > &, const Vector< double, 3 > &)
ITKCommon_EXPORT Vector< float, 3 > CrossProduct (const Vector< float, 3 > &, const Vector< float, 3 > &)
ITKCommon_EXPORT Vector< int, 3 > CrossProduct (const Vector< int, 3 > &, const Vector< int, 3 > &)
ITKCommon_EXPORT void CrossProduct (CovariantVector< double, 3 > &, const Vector< double, 3 > &, const Vector< double, 3 > &)
ITKCommon_EXPORT void CrossProduct (CovariantVector< float, 3 > &, const Vector< float, 3 > &, const Vector< float, 3 > &)
ITKCommon_EXPORT void CrossProduct (CovariantVector< int, 3 >, const Vector< int, 3 > &, const Vector< int, 3 > &)
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 >
ptrdiff_t * distance_type (const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &)
template<class T >
void EncapsulateMetaData (MetaDataDictionary &Dictionary, const char *key, const T &invalue)
template<class T >
bool ExposeMetaData (MetaDataDictionary &Dictionary, const std::string key, T &outval)
template<class T >
bool ExposeMetaData (MetaDataDictionary &Dictionary, const char *const key, T &outval)
template<class T >
bool ExposeMetaData (const MetaDataDictionary &Dictionary, const std::string key, T &outval)
template<class T >
bool ExposeMetaData (const MetaDataDictionary &Dictionary, const char *const key, T &outval)
virtual MemoryLoadType GetMemoryUsage ()
vcl_size_t hash_string (const char *s)
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 >
std::forward_iterator_tag iterator_category (const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &)
 ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE (float)
 ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE (double)
 ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE (signed int)
 ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE (unsigned int)
 ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO (FixedArray)
 ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO (Vector)
 ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO (CovariantVector)
 ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO (Point)
 ITK_DEFAULTCONVERTTRAITS_MATRIX_TYPE_ALL_TYPES_MACRO (Matrix)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, char)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, unsigned char)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, signed char)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, short)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, int)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, long)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, float)
 itkNumericTraitsDiffusionTensor3DMacro (DiffusionTensor3D, double)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, int)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, short)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, char)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, unsigned char)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, long)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, float)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, double)
 itkNumericTraitsGenericArrayDimensionsMacro (FixedArray, signed char)
 itkNumericTraitsRGBAPixelMacro (char)
 itkNumericTraitsRGBAPixelMacro (unsigned char)
 itkNumericTraitsRGBAPixelMacro (short)
 itkNumericTraitsRGBAPixelMacro (float)
 itkNumericTraitsRGBAPixelMacro (double)
 itkNumericTraitsRGBAPixelMacro (long)
 itkNumericTraitsRGBAPixelMacro (int)
 itkNumericTraitsRGBPixelMacro (short)
 itkNumericTraitsRGBPixelMacro (int)
 itkNumericTraitsRGBPixelMacro (long)
 itkNumericTraitsRGBPixelMacro (float)
 itkNumericTraitsRGBPixelMacro (double)
 itkNumericTraitsRGBPixelMacro (char)
 itkNumericTraitsRGBPixelMacro (unsigned char)
template<class TChainCodePath , class TPathInput >
void MakeChainCodeTracePath (TChainCodePath &chainPath, const TPathInput &inPath, bool restrictMovement=false)
template<class TInputIter >
std::pair< TInputIter, TInputIter > min_max_element (TInputIter first, TInputIter last)
template<class TInputIter , class TCompare >
std::pair< TInputIter, TInputIter > min_max_element (TInputIter first, TInputIter last, TCompare comp)
float MvtSunf (int numb)
unsigned long next_prime (unsigned long n)
template<class TValueType , class T >
VariableLengthVector< TValueType > operator* (const T &scalar, const VariableLengthVector< TValueType > &v)
template<class T , unsigned int NVectorDimension>
CovariantVector< T,
NVectorDimension > 
operator* (const T &scalar, const CovariantVector< T, NVectorDimension > &v)
template<class T , unsigned int NVectorDimension>
Vector< T, NVectorDimension > operator* (const T &scalar, const Vector< T, NVectorDimension > &v)
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)
template<unsigned int VOffsetDimension>
std::ostream & operator<< (std::ostream &os, const Offset< VOffsetDimension > &ind)
template<typename TComponent >
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const RGBPixel< TComponent > &c)
template<typename TValueType , unsigned int VLength>
std::ostream & operator<< (std::ostream &os, const FixedArray< TValueType, VLength > &arr)
template<typename T >
std::ostream & operator<< (std::ostream &os, SmartPointer< T > p)
template<typename TValueType >
std::ostream & operator<< (std::ostream &os, const Array< TValueType > &arr)
template<typename T >
std::ostream & operator<< (std::ostream &os, AutoPointer< T > p)
template<typename TComponent >
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const RGBAPixel< TComponent > &c)
template<class TPixel , unsigned int VDimension, class TContainer >
std::ostream & operator<< (std::ostream &os, const Neighborhood< TPixel, VDimension, TContainer > &neighborhood)
std::ostream & operator<< (std::ostream &os, MultivariateLegendrePolynomial &poly)
template<class TPixel >
std::ostream & operator<< (std::ostream &o, const NeighborhoodAllocator< TPixel > &a)
template<typename TMatrix , typename TVector , typename TEigenMatrix >
std::ostream & operator<< (std::ostream &os, const SymmetricEigenAnalysis< TMatrix, TVector, TEigenMatrix > &s)
template<typename T >
std::ostream & operator<< (std::ostream &os, TreeIteratorClone< T > p)
template<typename TValueType >
std::ostream & operator<< (std::ostream &os, const VariableLengthVector< TValueType > &arr)
template<unsigned int VImageDimension>
std::ostream & operator<< (std::ostream &os, const ImageRegion< VImageDimension > &region)
template<typename T >
std::ostream & operator<< (std::ostream &os, SmartPointerForwardReference< T > p)
template<unsigned int VDimension>
std::ostream & operator<< (std::ostream &os, const Size< VDimension > &size)
template<class T , unsigned int NVectorDimension>
std::ostream & operator<< (std::ostream &os, const Vector< T, NVectorDimension > &v)
template<typename TComponent , unsigned int NDimension>
ITK_EXPORT OutputStreamTypeoperator<< (OutputStreamType &os, const SymmetricSecondRankTensor< TComponent, NDimension > &c)
template<class T >
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const Versor< T > &v)
template<class T >
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const VariableSizeMatrix< T > &v)
template<class T , unsigned int NRows, unsigned int NColumns>
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const Matrix< T, NRows, NColumns > &v)
template<typename T >
std::ostream & operator<< (std::ostream &os, WeakPointer< T > p)
std::ostream & operator<< (std::ostream &os, const ImageIORegion &region)
template<class T , unsigned int NPointDimension>
ITK_EXPORT std::ostream & operator<< (std::ostream &os, const Point< T, NPointDimension > &v)
template<typename TValueType >
std::ostream & operator<< (std::ostream &os, const Array2D< TValueType > &arr)
template<unsigned int VIndexDimension>
std::ostream & operator<< (std::ostream &os, const Index< VIndexDimension > &ind)
template<class Key , class T , class HashFcn , class EqualKey , class Alloc >
bool operator== (const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &, const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &)
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)
template<class Key , class T , class HashFcn , class EqualKey , class Alloc >
bool operator== (const hash_map< Key, T, HashFcn, EqualKey, Alloc > &, const hash_map< Key, T, HashFcn, EqualKey, Alloc > &)
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<typename TComponent , unsigned int NDimension>
ITK_EXPORT InputStreamTypeoperator>> (InputStreamType &is, SymmetricSecondRankTensor< TComponent, NDimension > &c)
template<class T , unsigned int NVectorDimension>
std::istream & operator>> (std::istream &is, Vector< T, NVectorDimension > &v)
template<typename TComponent >
ITK_EXPORT std::istream & operator>> (std::istream &is, RGBPixel< TComponent > &c)
template<typename TComponent >
ITK_EXPORT std::istream & operator>> (std::istream &is, RGBAPixel< TComponent > &c)
template<class T >
ITK_EXPORT std::istream & operator>> (std::istream &is, Versor< T > &v)
template<class T , unsigned int NPointDimension>
ITK_EXPORT std::istream & operator>> (std::istream &is, Point< T, NPointDimension > &v)
template<class TIterator >
TIterator * setConnectivity (TIterator *it, bool fullyConnected=false)
template<class TIterator >
TIterator * setConnectivityEarlyBox (TIterator *it, bool fullyConnected=false)
template<class TIterator >
TIterator * setConnectivityLater (TIterator *it, bool fullyConnected=false)
template<class TIterator >
TIterator * setConnectivityPrevious (TIterator *it, bool fullyConnected=false)
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 >
Value * value_type (const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &)
virtual ~SysResourceMemoryUsageObserver ()

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<typename TAutoPointerBase , typename TAutoPointerDerived >
void ITK_EXPORT TransferAutoPointer (TAutoPointerBase &pa, TAutoPointerDerived &pb)

std::ostream & operator<< (std::ostream &os, EventObject &e)

ITKCommon_EXPORT void OutputWindowDisplayText (const char *)
ITKCommon_EXPORT void OutputWindowDisplayErrorText (const char *)
ITKCommon_EXPORT void OutputWindowDisplayWarningText (const char *)
ITKCommon_EXPORT void OutputWindowDisplayGenericOutputText (const char *)
ITKCommon_EXPORT void OutputWindowDisplayDebugText (const char *)

template<class T >
void EncapsulateMetaData (MetaDataDictionary &Dictionary, const std::string &key, const T &invalue)

template<class TFourierSeriesPath , class TChainCodePath >
void MakeFourierSeriesPathTraceChainCode (TFourierSeriesPath &FSPath, const TChainCodePath &chainPath, unsigned int numHarmonics=8)

Variables

const char *const ACQ_DIM
const char *const ACQ_ECHO_TIME
const char *const ACQ_INVERSION_TIME
const char *const ACQ_REPETITION_TIME
const char *const ACQ_SLICE_SEPN
const char *const ACQ_SLICE_SEPN_MODE
const char *const ACQ_SLICE_THICK
const char *const ANALYZE_AUX_FILE_NAME
const char *const ANALYZE_CAL_MAX
const char *const ANALYZE_CAL_MIN
const char *const ANALYZE_CALIBRATIONUNITS
const char *const ANALYZE_GLMAX
const char *const ANALYZE_GLMIN
const char *const ANALYZE_O_MAX
const char *const ANALYZE_O_MIN
const char *const ANALYZE_S_MAX
const char *const ANALYZE_S_MIN
const char *const ANALYZE_ScanNumber
class ITKCommon_EXPORT
itk::MemoryUsageObserverBase 
endif
const char *const ITK_CoordinateOrientation
const char *const ITK_ExperimentDate
const char *const ITK_ExperimentTime
const char *const ITK_FileNotes
const char *const ITK_FileOriginator
const char *const ITK_ImageFileBaseName
const char *const ITK_ImageType
const char *const ITK_InputFilterName
const char *const ITK_NumberOfDimensions
const char *const ITK_OnDiskBitPerPixel
const char *const ITK_OnDiskStorageTypeName
const char *const ITK_Origin
const char *const ITK_OriginationDate
const char *const ITK_PatientID
const char *const ITK_PatientName
const char *const ITK_ScanID
const char *const ITK_Spacing
const char *const ITK_VoxelUnits
class ITK_EXPORT LBFGSBOptimizerHelper
const char *const magicMAP = "MAP "
const char *const NECHOES
const char *const NI
const char *const NR
static const unsigned long prime_list [num_primes]
const char *const RECO_BYTE_ORDER
const char *const RECO_FOV
const char *const RECO_IMAGE_TYPE
const char *const RECO_SIZE
const char *const RECO_TRANSPOSITION
const char *const RECO_WORDTYPE
const char *const ROI_NAME
const char *const ROI_NUM_SEGMENTS
const char *const ROI_PLANE
const char *const ROI_SCAN_ID
const char *const ROI_X_RESOLUTION
const char *const ROI_X_SIZE
const char *const ROI_Y_RESOLUTION
const char *const ROI_Y_SIZE
const char *const ROI_Z_RESOLUTION
const char *const ROI_Z_SIZE
const char *const SPM_ROI_SCALE

Detailed Description

Hashtable class, used to implement the hashed associative containers itk_hash_set, itk_hash_map, itk_hash_multiset, and itk_hash_multimap.

The "itk" namespace contains all Insight Segmentation and Registration Toolkit (ITK) classes. There are several nested namespaces within the itk:: namespace.

Copyright (c) 1996 Silicon Graphics Computer Systems, Inc.

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Silicon Graphics makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Copyright (c) 1994 Hewlett-Packard Company

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Hewlett-Packard Company makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Copyright (c) 1997 Moscow Center for SPARC Technology

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Moscow Center for SPARC Technology makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Copyright (c) 1996 Silicon Graphics Computer Systems, Inc.

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Silicon Graphics makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Copyright (c) 1994 Hewlett-Packard Company

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Hewlett-Packard Company makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Exception Handling: Copyright (c) 1997 Mark of the Unicorn, Inc.

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Mark of the Unicorn makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

Adaptation: Copyright (c) 1997 Moscow Center for SPARC Technology

Permission to use, copy, modify, distribute and sell this software and its documentation for any purpose is hereby granted without fee, provided that the above copyright notice appear in all copies and that both that copyright notice and this permission notice appear in supporting documentation. Moscow Center for SPARC Technology makes no representations about the suitability of this software for any purpose. It is provided "as is" without express or implied warranty.

itkMacro.h defines standard system-wide macros, constants, and other parameters. One of its most important functions is to define macros used to interface to instance variables in a standard fashion. For example, these macros manage modified time, debugging information, and provide a standard interface to set and get instance variables. Macros are available for built-in types; for string classe; vector arrays; object pointers; and debug, warning, and error printout information.

Octree data structure

The specification for this file format is taken from the web site http://www.mayo.edu/bir/PDF/ANALYZE75.pdf.

Author:
Hans J. Johnson The University of Iowa 2002

The specification for this file format is taken from the web site http://www.bic.mni.mcgill.ca/software/minc

Author:
Leila Baghdadi Mouse Imaging Centre, Toronto, Canada 2005.

TODO: This class needs to be more tightly integrated with the new multi-threaded ImageToImageMetric.


Typedef Documentation

typedef int itk::FastMutexType

Definition at line 58 of file itkSimpleFastMutexLock.h.

typedef std::vector<std::string> itk::FilenamesContainer

Definition at line 50 of file itkGDCMSeriesFileNames.h.

typedef std::istream itk::InputStreamType

Definition at line 199 of file itkSymmetricSecondRankTensor.h.

typedef ::itksysFundamentalType_Int16 itk::int16_t

Definition at line 151 of file itkIntTypes.h.

typedef ::itksysFundamentalType_Int32 itk::int32_t

Definition at line 153 of file itkIntTypes.h.

typedef ::itksysFundamentalType_Int64 itk::int64_t

Optional 64-bit sized types. As not all systems have 64-bit integers, usage of these types must conditional on the preprocessor definition of ITK_HAS_INT_64.

Definition at line 184 of file itkIntTypes.h.

typedef ::itksysFundamentalType_Int8 itk::int8_t

Fixed width interger types.

Definition at line 149 of file itkIntTypes.h.

Definition at line 169 of file itkIntTypes.h.

Definition at line 171 of file itkIntTypes.h.

Definition at line 188 of file itkIntTypes.h.

Types which are at least a certain size but may be greater if performace benifits, these are prefered over fixed width.

Definition at line 167 of file itkIntTypes.h.

Definition at line 160 of file itkIntTypes.h.

Definition at line 162 of file itkIntTypes.h.

Definition at line 186 of file itkIntTypes.h.

Types which are at least a certain size, these are prefered over fixed width.

Definition at line 158 of file itkIntTypes.h.

Types which contain the largest represetable integer.

Definition at line 192 of file itkIntTypes.h.

typedef ::ptrdiff_t itk::intptr_t

Definition at line 197 of file itkIntTypes.h.

typedef itksys::DynamicLoader::LibraryHandle itk::LibHandle

Definition at line 37 of file itkDynamicLoader.h.

typedef int itk::MutexType

Definition at line 56 of file itkMutexLock.h.

typedef std::ostream itk::OutputStreamType

This extra typedef is necessary for preventing an Internal Compiler Error in Microsoft Visual C++ 6.0. This typedef is not needed for any other compiler.

Definition at line 198 of file itkSymmetricSecondRankTensor.h.

Definition at line 30 of file itkPolygonGroupSpatialObjectXMLFile.h.

typedef int itk::SemaphoreType

Definition at line 83 of file itkSemaphore.h.

typedef std::vector<std::string> itk::SerieUIDContainer

Definition at line 51 of file itkGDCMSeriesFileNames.h.

typedef itksys::DynamicLoader::SymbolPointer itk::SymbolPointer

Definition at line 39 of file itkDynamicLoader.h.

typedef void(* itk::ThreadFunctionType)(void *)
Note
If ITK_USE_PTHREADS is defined, then the multithreaded function is of type void *, and returns NULL Otherwise the type is void which is correct for WIN32 and SPROC.

Definition at line 132 of file itkMultiThreader.h.

Definition at line 133 of file itkMultiThreader.h.

typedef ::itksysFundamentalType_UInt16 itk::uint16_t

Definition at line 152 of file itkIntTypes.h.

typedef ::itksysFundamentalType_UInt32 itk::uint32_t

Definition at line 154 of file itkIntTypes.h.

typedef ::itksysFundamentalType_UInt64 itk::uint64_t

Definition at line 185 of file itkIntTypes.h.

typedef ::itksysFundamentalType_UInt8 itk::uint8_t

Definition at line 150 of file itkIntTypes.h.

Definition at line 170 of file itkIntTypes.h.

Definition at line 172 of file itkIntTypes.h.

Definition at line 189 of file itkIntTypes.h.

Definition at line 168 of file itkIntTypes.h.

Definition at line 161 of file itkIntTypes.h.

Definition at line 163 of file itkIntTypes.h.

Definition at line 187 of file itkIntTypes.h.

Definition at line 159 of file itkIntTypes.h.

Definition at line 193 of file itkIntTypes.h.

typedef ::vcl_size_t itk::uintptr_t

Definition at line 198 of file itkIntTypes.h.


Enumeration Type Documentation

anonymous enum
Enumerator:
B2_MASKFILE_BLACK 
B2_MASKFILE_WHITE 
B2_MASKFILE_GRAY 

Definition at line 27 of file itkOctree.h.

anonymous enum
Enumerator:
num_primes 

Definition at line 267 of file itk_hashtable.h.

Enumerator:
ZERO 
ONE 
TWO 
THREE 
FOUR 
FIVE 
SIX 
SEVEN 

Definition at line 22 of file itkOctreeNode.h.

The enumeration to define the planar orientation of the octree

Definition at line 36 of file itkOctree.h.

enumerates the possible spatial orientations

Enumerator:
Axial 
Coronal 
Sagittal 
UserPlane 
Unknown 

Definition at line 24 of file itkPolygonGroupOrientation.h.


Function Documentation

template<class TInputImage , class TOutputImage >
void itk::BoxAccumulateFunction ( const TInputImage *  inputImage,
const TOutputImage *  outputImage,
typename TInputImage::RegionType  inputRegion,
typename TOutputImage::RegionType  outputRegion,
ProgressReporter &  progress 
)
template<class TInputImage , class TOutputImage >
void itk::BoxMeanCalculatorFunction ( const TInputImage *  accImage,
TOutputImage *  outputImage,
typename TInputImage::RegionType  inputRegion,
typename TOutputImage::RegionType  outputRegion,
typename TInputImage::SizeType  Radius,
ProgressReporter &  progress 
)
template<class TInputImage , class TOutputImage >
void itk::BoxSigmaCalculatorFunction ( const TInputImage *  accImage,
TOutputImage *  outputImage,
typename TInputImage::RegionType  inputRegion,
typename TOutputImage::RegionType  outputRegion,
typename TInputImage::SizeType  Radius,
ProgressReporter &  progress 
)
template<class TInputImage , class TOutputImage >
void itk::BoxSquareAccumulateFunction ( const TInputImage *  inputImage,
TOutputImage *  outputImage,
typename TInputImage::RegionType  inputRegion,
typename TOutputImage::RegionType  outputRegion,
ProgressReporter &  progress 
)
template<class TLabelImage , class TIntensityImage , class TGenericImage >
bool itk::CalculateOrientedImage ( LabelGeometryImageFilter< TLabelImage, TIntensityImage > *  filter,
vnl_symmetric_eigensystem< double >  eig,
typename LabelGeometryImageFilter< TLabelImage, TIntensityImage >::LabelGeometry &  labelGeometry,
bool  useLabelImage = true 
)
template<class TLabelImage , class TIntensityImage >
LabelGeometryImageFilter<TLabelImage,TIntensityImage>::MatrixType itk::CalculateRotationMatrix ( vnl_symmetric_eigensystem< double >  eig  ) 
template<class TInputMesh , class TOutputMesh >
void itk::CopyMeshToMeshCellData ( const TInputMesh *  in,
TOutputMesh *  out 
)
template<class TInputMesh , class TOutputMesh >
void itk::CopyMeshToMeshCells ( const TInputMesh *  in,
TOutputMesh *  out 
)

Definition at line 196 of file itkQuadEdgeMeshToQuadEdgeMeshFilter.h.

template<class TInputMesh , class TOutputMesh >
void itk::CopyMeshToMeshEdgeCells ( const TInputMesh *  in,
TOutputMesh *  out 
)

Definition at line 237 of file itkQuadEdgeMeshToQuadEdgeMeshFilter.h.

template<class TInputMesh , class TOutputMesh >
void itk::CopyMeshToMeshPointData ( const TInputMesh *  in,
TOutputMesh *  out 
)
template<class TInputMesh , class TOutputMesh >
void itk::CopyMeshToMeshPoints ( const TInputMesh *  in,
TOutputMesh *  out 
)

Definition at line 266 of file itkQuadEdgeMeshToQuadEdgeMeshFilter.h.

template<class ImType >
std::vector<typename ImType::OffsetType> itk::CornerOffsets ( const ImType *  im  ) 
ITKCommon_EXPORT void itk::CrossProduct ( CovariantVector< int, 3 >  ,
const Vector< int, 3 > &  ,
const Vector< int, 3 > &   
)
ITKCommon_EXPORT Vector<double,3> itk::CrossProduct ( const Vector< double, 3 > &  ,
const Vector< double, 3 > &   
)
ITKCommon_EXPORT Vector<float,3> itk::CrossProduct ( const Vector< float, 3 > &  ,
const Vector< float, 3 > &   
)
ITKCommon_EXPORT Vector<int,3> itk::CrossProduct ( const Vector< int, 3 > &  ,
const Vector< int, 3 > &   
)
ITKCommon_EXPORT void itk::CrossProduct ( CovariantVector< double, 3 > &  ,
const Vector< double, 3 > &  ,
const Vector< double, 3 > &   
)
ITKCommon_EXPORT void itk::CrossProduct ( CovariantVector< float, 3 > &  ,
const Vector< float, 3 > &  ,
const Vector< float, 3 > &   
)
template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
ptrdiff_t* itk::distance_type ( const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]

Definition at line 746 of file itk_hashtable.h.

template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
ptrdiff_t* itk::distance_type ( const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]

Definition at line 725 of file itk_hashtable.h.

template<class T >
void itk::EncapsulateMetaData ( MetaDataDictionary &  Dictionary,
const std::string &  key,
const T &  invalue 
) [inline]

EncapsulateMetaData is a convenience function that encapsulates raw MetaData into a MetaDataObject that can be put into the MetaDataDictionary.

Parameters:
Dictionary TODO
key TODO
invalue the value of type T that is to be encapsulated.
Returns:
A smartpointer ot a MetaDataObject that is suitable for insertion into a MetaDataDictionary.

Definition at line 160 of file itkMetaDataObject.h.

References itk::MetaDataObject< MetaDataObjectType >::New().

Referenced by EncapsulateMetaData().

template<class T >
void itk::EncapsulateMetaData ( MetaDataDictionary &  Dictionary,
const char *  key,
const T &  invalue 
) [inline]

Definition at line 169 of file itkMetaDataObject.h.

References EncapsulateMetaData().

template<class T >
bool itk::ExposeMetaData ( MetaDataDictionary &  Dictionary,
const std::string  key,
T &  outval 
) [inline]

FindValInDictionary provides a shortcut for pulling a value of type T out of a MetaDataDictionary. If Dictionary[key] isn't set, return false, otherwise copy into outval reference and return true.

Parameters:
Dictionary -- reference to a dictionary
key -- string identifier for this object
outval -- where to store value found in table.

Definition at line 184 of file itkMetaDataObject.h.

References itk::MetaDataDictionary::HasKey().

Referenced by ExposeMetaData().

template<class T >
bool itk::ExposeMetaData ( MetaDataDictionary &  Dictionary,
const char *const   key,
T &  outval 
) [inline]

Definition at line 235 of file itkMetaDataObject.h.

References ExposeMetaData().

template<class T >
bool itk::ExposeMetaData ( const MetaDataDictionary &  Dictionary,
const std::string  key,
T &  outval 
) [inline]

Definition at line 242 of file itkMetaDataObject.h.

References ExposeMetaData().

template<class T >
bool itk::ExposeMetaData ( const MetaDataDictionary &  Dictionary,
const char *const   key,
T &  outval 
) [inline]

Definition at line 249 of file itkMetaDataObject.h.

References ExposeMetaData().

virtual MemoryLoadType itk::GetMemoryUsage (  )  [virtual]
vcl_size_t itk::hash_string ( const char *  s  )  [inline]
template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
std::forward_iterator_tag itk::iterator_category ( const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]

Definition at line 711 of file itk_hashtable.h.

template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
std::forward_iterator_tag itk::iterator_category ( const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]

Definition at line 732 of file itk_hashtable.h.

itk::ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE ( float   ) 
itk::ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE ( signed  int  ) 
itk::ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE ( unsigned  int  ) 
itk::ITK_DEFAULTCONVERTTRAITS_COMPLEX_TYPE ( double   ) 
itk::ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO ( Vector   ) 
itk::ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO ( CovariantVector   ) 
itk::ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO ( Point   ) 
itk::ITK_DEFAULTCONVERTTRAITS_FIXEDARRAY_TYPE_ALL_TYPES_MACRO ( FixedArray   ) 
itk::ITK_DEFAULTCONVERTTRAITS_MATRIX_TYPE_ALL_TYPES_MACRO ( Matrix   ) 
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
int   
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
float   
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
double   
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
unsigned  char 
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
char   
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
signed  char 
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
short   
)
itk::itkNumericTraitsDiffusionTensor3DMacro ( DiffusionTensor3D  ,
long   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
unsigned  char 
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
short   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
char   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
signed  char 
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
int   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
long   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
double   
)
itk::itkNumericTraitsGenericArrayDimensionsMacro ( FixedArray  ,
float   
)
itk::itkNumericTraitsRGBAPixelMacro ( unsigned  char  ) 
itk::itkNumericTraitsRGBAPixelMacro ( char   ) 
itk::itkNumericTraitsRGBAPixelMacro ( short   ) 
itk::itkNumericTraitsRGBAPixelMacro ( int   ) 
itk::itkNumericTraitsRGBAPixelMacro ( long   ) 
itk::itkNumericTraitsRGBAPixelMacro ( float   ) 
itk::itkNumericTraitsRGBAPixelMacro ( double   ) 
itk::itkNumericTraitsRGBPixelMacro ( long   ) 
itk::itkNumericTraitsRGBPixelMacro ( char   ) 
itk::itkNumericTraitsRGBPixelMacro ( unsigned  char  ) 
itk::itkNumericTraitsRGBPixelMacro ( short   ) 
itk::itkNumericTraitsRGBPixelMacro ( int   ) 
itk::itkNumericTraitsRGBPixelMacro ( float   ) 
itk::itkNumericTraitsRGBPixelMacro ( double   ) 
template<class TChainCodePath , class TPathInput >
void itk::MakeChainCodeTracePath ( TChainCodePath &  chainPath,
const TPathInput &  inPath,
bool  restrictMovement = false 
)

Make a chain code trace another path of same dimensionality. If restrictMovement is true, then individual steps are allowed to move through only one dimension at a time; for 2D paths this results in an 8-connected chain code.

Definition at line 34 of file itkPathFunctions.h.

template<class TFourierSeriesPath , class TChainCodePath >
void itk::MakeFourierSeriesPathTraceChainCode ( TFourierSeriesPath &  FSPath,
const TChainCodePath &  chainPath,
unsigned int  numHarmonics = 8 
)

Make a Fourier series path trace a chain code path of same dimensionality. numHarmonics is the number of harmonics (frequency coefficients, which include the "DC" term) to compute. If chainPath has too few steps to calculate numHarmonics (due to the Nyquist criterion), then as many harmonics as possible (chainPath->NumberOfSteps()/2) will be calculated. No fewer than 2 harmonics will be calcualted.

Definition at line 82 of file itkPathFunctions.h.

template<class TInputIter , class TCompare >
std::pair<TInputIter, TInputIter> itk::min_max_element ( TInputIter  first,
TInputIter  last,
TCompare  comp 
)

returns the min and max of a

Uses the provided binary functor If first == last then return is pair(first,first); otherwise is it pair(min, max)

Definition at line 81 of file itkGenericUtilities.h.

template<class TInputIter >
std::pair<TInputIter, TInputIter> itk::min_max_element ( TInputIter  first,
TInputIter  last 
)

returns the min and max of a sequence defined by two iterators

Uses the < operator to determin ordering If first == last then return is pair(first,first); otherwise is it pair(min, max)

Definition at line 38 of file itkGenericUtilities.h.

float itk::MvtSunf ( int  numb  ) 
unsigned long itk::next_prime ( unsigned long  n  )  [inline]

Definition at line 294 of file itk_hashtable.h.

References prime_list.

template<class TValueType , class T >
VariableLengthVector<TValueType> itk::operator* ( const T &  scalar,
const VariableLengthVector< TValueType > &  v 
) [inline]

Premultiply Operator for product of a VariableLengthVector and a scalar. VariableLengthVector< TValueType > = T * VariableLengthVector< TValueType >

Definition at line 409 of file itkVariableLengthVector.h.

template<class T , unsigned int NVectorDimension>
Vector<T,NVectorDimension> itk::operator* ( const T &  scalar,
const Vector< T, NVectorDimension > &  v 
) [inline]

Premultiply Operator for product of a vector and a scalar. Vector< T, N > = T * Vector< T,N >

Definition at line 240 of file itkVector.h.

template<class T , unsigned int NVectorDimension>
CovariantVector<T,NVectorDimension> itk::operator* ( const T &  scalar,
const CovariantVector< T, NVectorDimension > &  v 
) [inline]

Premultiply Operator for product of a vector and a scalar. CovariantVector< T, N > = T * CovariantVector< T,N >

Definition at line 243 of file itkCovariantVector.h.

template<class TImage >
ConstNeighborhoodIterator<TImage> itk::operator+ ( const ConstNeighborhoodIterator< TImage > &  it,
const typename ConstNeighborhoodIterator< TImage >::OffsetType &  ind 
) [inline]

Definition at line 521 of file itkConstNeighborhoodIterator.h.

template<class TImage >
ConstNeighborhoodIterator<TImage> itk::operator+ ( const typename ConstNeighborhoodIterator< TImage >::OffsetType &  ind,
const ConstNeighborhoodIterator< TImage > &  it 
) [inline]

Definition at line 533 of file itkConstNeighborhoodIterator.h.

template<class TImage >
ConstNeighborhoodIterator<TImage> itk::operator- ( const ConstNeighborhoodIterator< TImage > &  it,
const typename ConstNeighborhoodIterator< TImage >::OffsetType &  ind 
) [inline]

Definition at line 540 of file itkConstNeighborhoodIterator.h.

template<unsigned int VOffsetDimension>
std::ostream& itk::operator<< ( std::ostream &  os,
const Offset< VOffsetDimension > &  ind 
)

Definition at line 264 of file itkOffset.h.

template<typename TValueType >
std::ostream& itk::operator<< ( std::ostream &  os,
const VariableLengthVector< TValueType > &  arr 
)
template<unsigned int VIndexDimension>
std::ostream& itk::operator<< ( std::ostream &  os,
const Index< VIndexDimension > &  ind 
)

Definition at line 356 of file itkIndex.h.

template<class TPixel >
std::ostream& itk::operator<< ( std::ostream &  o,
const NeighborhoodAllocator< TPixel > &  a 
) [inline]
template<typename TValueType >
std::ostream& itk::operator<< ( std::ostream &  os,
const Array2D< TValueType > &  arr 
)

Definition at line 77 of file itkArray2D.h.

template<class T , unsigned int NRows, unsigned int NColumns>
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const Matrix< T, NRows, NColumns > &  v 
)

Definition at line 243 of file itkMatrix.h.

template<class T >
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const Versor< T > &  v 
)
template<typename T >
std::ostream& itk::operator<< ( std::ostream &  os,
TreeIteratorClone< T >  p 
)

Definition at line 173 of file itkTreeIteratorClone.h.

template<typename TComponent >
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const RGBAPixel< TComponent > &  c 
)
template<typename TComponent >
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const RGBPixel< TComponent > &  c 
)
std::ostream& itk::operator<< ( std::ostream &  os,
const ImageIORegion &  region 
)
template<typename T >
std::ostream& itk::operator<< ( std::ostream &  os,
SmartPointer< T >  p 
)

Definition at line 157 of file itkSmartPointer.h.

template<typename TValueType , unsigned int VLength>
std::ostream& itk::operator<< ( std::ostream &  os,
const FixedArray< TValueType, VLength > &  arr 
)
template<class TPixel , unsigned int VDimension, class TContainer >
std::ostream& itk::operator<< ( std::ostream &  os,
const Neighborhood< TPixel, VDimension, TContainer > &  neighborhood 
)

Definition at line 278 of file itkNeighborhood.h.

std::ostream& itk::operator<< ( std::ostream &  os,
MultivariateLegendrePolynomial &  poly 
)
template<class T >
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const VariableSizeMatrix< T > &  v 
)
template<typename TMatrix , typename TVector , typename TEigenMatrix >
std::ostream& itk::operator<< ( std::ostream &  os,
const SymmetricEigenAnalysis< TMatrix, TVector, TEigenMatrix > &  s 
)
template<typename TComponent , unsigned int NDimension>
ITK_EXPORT OutputStreamType& itk::operator<< ( OutputStreamType &  os,
const SymmetricSecondRankTensor< TComponent, NDimension > &  c 
)
template<typename T >
std::ostream& itk::operator<< ( std::ostream &  os,
SmartPointerForwardReference< T >  p 
)

Definition at line 110 of file itkSmartPointerForwardReference.h.

template<typename T >
std::ostream& itk::operator<< ( std::ostream &  os,
WeakPointer< T >  p 
)

Definition at line 131 of file itkWeakPointer.h.

template<class T , unsigned int NVectorDimension>
std::ostream& itk::operator<< ( std::ostream &  os,
const Vector< T, NVectorDimension > &  v 
)
template<class T , unsigned int NPointDimension>
ITK_EXPORT std::ostream& itk::operator<< ( std::ostream &  os,
const Point< T, NPointDimension > &  v 
)
template<typename T >
std::ostream& itk::operator<< ( std::ostream &  os,
AutoPointer< T >  p 
)

Definition at line 221 of file itkAutoPointer.h.

template<unsigned int VImageDimension>
std::ostream& itk::operator<< ( std::ostream &  os,
const ImageRegion< VImageDimension > &  region 
)
std::ostream& itk::operator<< ( std::ostream &  os,
EventObject &  e 
) [inline]

Generic inserter operator for EventObject and its subclasses.

Definition at line 101 of file itkEventObject.h.

template<unsigned int VDimension>
std::ostream& itk::operator<< ( std::ostream &  os,
const Size< VDimension > &  size 
)

Definition at line 212 of file itkSize.h.

template<typename TValueType >
std::ostream& itk::operator<< ( std::ostream &  os,
const Array< TValueType > &  arr 
)

Definition at line 141 of file itkArray.h.

template<class Key , class T , class HashFcn , class EqualKey , class Alloc >
bool itk::operator== ( const hash_map< Key, T, HashFcn, EqualKey, Alloc > &  hm1,
const hash_map< Key, T, HashFcn, EqualKey, Alloc > &  hm2 
)

This method MUST NOT be declared "inline" because it a specialization of its template is declared as friend of a class. The hash_map class, in this case

Definition at line 332 of file itk_hash_map.h.

Referenced by itk::SliceIterator< TPixel, TContainer >::operator!=(), and itk::ConstSliceIterator< TPixel, TContainer >::operator!=().

template<class Key , class T , class HashFcn , class EqualKey , class Alloc >
bool itk::operator== ( const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &  hm1,
const hash_multimap< Key, T, HashFcn, EqualKey, Alloc > &  hm2 
)

This method MUST NOT be declared "inline" because it a specialization of its template is declared as friend of a class. The hash_map class, in this case

Definition at line 341 of file itk_hash_map.h.

template<class Value , class HashFcn , class EqualKey , class Alloc >
bool itk::operator== ( const hash_set< Value, HashFcn, EqualKey, Alloc > &  hs1,
const hash_set< Value, HashFcn, EqualKey, Alloc > &  hs2 
)

This method MUST NOT be declared "inline" because it a specialization of its template is declared as friend of a class. The hash_set class, in this case

Definition at line 301 of file itk_hash_set.h.

template<class Value , class HashFcn , class EqualKey , class Alloc >
bool itk::operator== ( const hash_multiset< Value, HashFcn, EqualKey, Alloc > &  hs1,
const hash_multiset< Value, HashFcn, EqualKey, Alloc > &  hs2 
)

This method MUST NOT be declared "inline" because it a specialization of its template is declared as friend of a class. The hash_set class, in this case

Definition at line 310 of file itk_hash_set.h.

template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
bool itk::operator== ( const hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &  ht1,
const hashtable< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &  ht2 
)

This method MUST NOT be declared "inline" because it a specialization of its template is declared as friend of a class. The hashtable class, in this case

Definition at line 754 of file itk_hashtable.h.

References itk::hashtable_base< Value, Alloc >::buckets.

template<typename TComponent >
ITK_EXPORT std::istream& itk::operator>> ( std::istream &  is,
RGBPixel< TComponent > &  c 
)
template<typename TComponent >
ITK_EXPORT std::istream& itk::operator>> ( std::istream &  is,
RGBAPixel< TComponent > &  c 
)
template<class T >
ITK_EXPORT std::istream& itk::operator>> ( std::istream &  is,
Versor< T > &  v 
)
template<class T , unsigned int NVectorDimension>
std::istream& itk::operator>> ( std::istream &  is,
Vector< T, NVectorDimension > &  v 
)
template<class T , unsigned int NPointDimension>
ITK_EXPORT std::istream& itk::operator>> ( std::istream &  is,
Point< T, NPointDimension > &  v 
)
template<typename TComponent , unsigned int NDimension>
ITK_EXPORT InputStreamType& itk::operator>> ( InputStreamType &  is,
SymmetricSecondRankTensor< TComponent, NDimension > &  c 
)
ITKCommon_EXPORT void itk::OutputWindowDisplayDebugText ( const char *   ) 

The following is used to output debug, warning, and error messages. Use a global function which actually calls: OutputWindow::GetInstance()->DisplayText(); This is to avoid Object include of OutputWindow while OutputWindow includes Object.

ITKCommon_EXPORT void itk::OutputWindowDisplayErrorText ( const char *   ) 

The following is used to output debug, warning, and error messages. Use a global function which actually calls: OutputWindow::GetInstance()->DisplayText(); This is to avoid Object include of OutputWindow while OutputWindow includes Object.

ITKCommon_EXPORT void itk::OutputWindowDisplayGenericOutputText ( const char *   ) 

The following is used to output debug, warning, and error messages. Use a global function which actually calls: OutputWindow::GetInstance()->DisplayText(); This is to avoid Object include of OutputWindow while OutputWindow includes Object.

ITKCommon_EXPORT void itk::OutputWindowDisplayText ( const char *   ) 

The following is used to output debug, warning, and error messages. Use a global function which actually calls: OutputWindow::GetInstance()->DisplayText(); This is to avoid Object include of OutputWindow while OutputWindow includes Object.

ITKCommon_EXPORT void itk::OutputWindowDisplayWarningText ( const char *   ) 

The following is used to output debug, warning, and error messages. Use a global function which actually calls: OutputWindow::GetInstance()->DisplayText(); This is to avoid Object include of OutputWindow while OutputWindow includes Object.

template<class TIterator >
TIterator* itk::setConnectivity ( TIterator *  it,
bool  fullyConnected = false 
)

Definition at line 29 of file itkConnectedComponentAlgorithm.h.

template<class TIterator >
TIterator* itk::setConnectivityEarlyBox ( TIterator *  it,
bool  fullyConnected = false 
)

Definition at line 38 of file itkBoxUtilities.h.

Referenced by BoxAccumulateFunction(), and BoxSquareAccumulateFunction().

template<class TIterator >
TIterator* itk::setConnectivityLater ( TIterator *  it,
bool  fullyConnected = false 
)

Definition at line 100 of file itkConnectedComponentAlgorithm.h.

template<class TIterator >
TIterator* itk::setConnectivityPrevious ( TIterator *  it,
bool  fullyConnected = false 
)

Definition at line 65 of file itkConnectedComponentAlgorithm.h.

template<typename TAutoPointerBase , typename TAutoPointerDerived >
void ITK_EXPORT itk::TransferAutoPointer ( TAutoPointerBase &  pa,
TAutoPointerDerived &  pb 
)

This templated function is intended to facilitate the transfer between AutoPointers of Derived class to Base class

Definition at line 233 of file itkAutoPointer.h.

template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
Value* itk::value_type ( const hashtable_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]
template<class Value , class Key , class HashFcn , class ExtractKey , class EqualKey , class Alloc >
Value* itk::value_type ( const hashtable_const_iterator< Value, Key, HashFcn, ExtractKey, EqualKey, Alloc > &   )  [inline]

Definition at line 739 of file itk_hashtable.h.

virtual itk::~SysResourceMemoryUsageObserver (  )  [virtual]

Variable Documentation

const char* const itk::ACQ_DIM
const char* const itk::ACQ_ECHO_TIME
const char* const itk::ACQ_INVERSION_TIME
const char* const itk::ACQ_REPETITION_TIME
const char* const itk::ACQ_SLICE_SEPN
const char* const itk::ACQ_SLICE_SEPN_MODE
const char* const itk::ACQ_SLICE_THICK
const char* const itk::ANALYZE_AUX_FILE_NAME
const char* const itk::ANALYZE_CAL_MAX
const char* const itk::ANALYZE_CAL_MIN
const char* const itk::ANALYZE_CALIBRATIONUNITS
const char* const itk::ANALYZE_GLMAX
const char* const itk::ANALYZE_GLMIN
const char* const itk::ANALYZE_O_MAX
const char* const itk::ANALYZE_O_MIN
const char* const itk::ANALYZE_S_MAX
const char* const itk::ANALYZE_S_MIN
const char* const itk::ANALYZE_ScanNumber
class ITKCommon_EXPORT itk::MemoryUsageObserverBase itk::endif
const char* const itk::ITK_CoordinateOrientation
const char* const itk::ITK_ExperimentDate
const char* const itk::ITK_ExperimentTime
const char* const itk::ITK_FileNotes
const char* const itk::ITK_FileOriginator
const char* const itk::ITK_ImageFileBaseName
const char* const itk::ITK_ImageType
const char* const itk::ITK_InputFilterName
const char* const itk::ITK_NumberOfDimensions
const char* const itk::ITK_OnDiskBitPerPixel
const char* const itk::ITK_OnDiskStorageTypeName
const char* const itk::ITK_Origin
const char* const itk::ITK_OriginationDate
const char* const itk::ITK_PatientID
const char* const itk::ITK_PatientName
const char* const itk::ITK_ScanID
const char* const itk::ITK_Spacing
const char* const itk::ITK_VoxelUnits
class ITK_EXPORT itk::LBFGSBOptimizerHelper

Definition at line 31 of file itkLBFGSBOptimizer.h.

const char* const itk::magicMAP = "MAP "

This is a very easy way to declare a string constant

Definition at line 30 of file itkMRCHeaderObject.h.

const char* const itk::NECHOES
const char* const itk::NI
const char* const itk::NR
const unsigned long itk::prime_list[num_primes] [static]
Initial value:


{
  53,         97,         193,       389,       769,
  1543,       3079,       6151,      12289,     24593,
  49157,      98317,      196613,    393241,    786433,
  1572869,    3145739,    6291469,   12582917,  25165843,
  50331653,   100663319,  201326611, 402653189, 805306457,
  1610612741, 3221225473U, 4294967291U
}

Definition at line 282 of file itk_hashtable.h.

Referenced by itk::hashtable< std::pair< const unsigned long, unsigned long >, unsigned long, HashFcn, sel1st, EqualKey, Alloc >::elems_in_bucket(), and next_prime().

const char* const itk::RECO_BYTE_ORDER
const char* const itk::RECO_FOV
const char* const itk::RECO_IMAGE_TYPE
const char* const itk::RECO_SIZE
const char* const itk::RECO_TRANSPOSITION
const char* const itk::RECO_WORDTYPE
const char* const itk::ROI_NAME
const char* const itk::ROI_NUM_SEGMENTS
const char* const itk::ROI_PLANE
const char* const itk::ROI_SCAN_ID
const char* const itk::ROI_X_RESOLUTION
const char* const itk::ROI_X_SIZE
const char* const itk::ROI_Y_RESOLUTION
const char* const itk::ROI_Y_SIZE
const char* const itk::ROI_Z_RESOLUTION
const char* const itk::ROI_Z_SIZE
const char* const itk::SPM_ROI_SCALE

Generated at Mon Jul 12 2010 20:21:07 for ITK by doxygen 1.7.1 written by Dimitri van Heesch, © 1997-2000