Cicl::math::Octree< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE >::AABB | Internally used axis-aligned bounding box |
Cicl::math::QuadTree< Scalar, CAPACITY, SF, ALLOC_CHUNK_SIZE, VECTOR_TYPE >::AABB | Internally used axis-aligned bounding box |
Cicl::geom::PointCloudSegment::AABB | |
Cicl::io::pylon::AcquisitionInterruptor | Utility Structure |
Cicl::math::Octree< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE >::Allocator | Inernally used block allocator |
Cicl::math::QuadTree< Scalar, CAPACITY, SF, ALLOC_CHUNK_SIZE, VECTOR_TYPE >::Allocator | Inernally used block allocator |
►Cicl::geom::AlphaFuncProperty | Extra base class for primitives, that use a special alpha function (in particular textures) |
Cicl::geom::GenericTexturePrimitive | Texture Primitive for rendering textures with arbitrary texture coordinates |
Cicl::geom::SharedTexturePrimitive | The shared texture primitive references a texture from the parent SceneObject |
►Cicl::geom::TextureGridPrimitive | Special texture Primitive for single textures spread over a regular grid of vertices |
Cicl::geom::TwoSidedTextureGridPrimitive | |
►Cicl::geom::TexturePrimitive | Texture Primitive |
Cicl::geom::TextPrimitive | Text Texture |
Cicl::utils::CLKernel::Arg | Utility structure for the CLKernel's index operator |
Cicl::utils::Array2D< T > | Simple 2D-Array class that provides shallow copy per default |
Cicl::utils::Array2D< icl::math::FixedColVector > | |
Cicl::utils::Array2D< int > | |
►Cicl::utils::Array2D< Marker > | |
Cicl::markers::AdvancedMarkerGridDetector::MarkerGrid | Represents whole grid of markers |
Cicl::qt::DataStore::Assign | Internally used assignment structure |
Cicl::qt::MultiDrawHandle::Assigner | |
Cicl::qt::ICLApplication::AsynchronousEvent | Interface for events that must be executed in the GUI Thread |
►Cstd::basic_string< Char > | STL class |
►Cstd::string | STL class |
Cicl::utils::Any | Simple generic data type implementation that uses a string based data representation |
Cicl::physics::BendingConstraint | |
►Cicl::filter::BinaryOp | Abstract base class for binary image operations |
Cicl::filter::BinaryArithmeticalOp | Class for arithmetic operations performed on two images |
Cicl::filter::BinaryCompareOp | Class for comparing two images pixel-wise |
Cicl::filter::BinaryLogicalOp | Class for logical operations performed on two images. (and, or, xor) |
Cicl::filter::ProximityOp | Class for computing proximity measures |
Cicl::cv::SimpleBlobSearcher::Blob | Internal blob-result type |
Cicl::io::PixelSenseGrabber::Blob | Blob structure |
►CbtMotionState | |
Cicl::physics::MotionState | This class is a MotionState for updating SceneObjects to match the PhysicsObject state |
Cicl::core::DataSegmentBase::Bytes | Very simple Byte Vector class to provide binary access to DataSegmentBase data |
Cicl::io::IntrinsicCalibrator::CalibrationData | |
Cicl::geom::Camera | Camera class |
Cicl::qt::ThreadedUpdatableSlider::CB | Internally callback type |
Cicl::core::CCLUT | |
Cicl::core::Channel< T > | Utility helper class for faster and more convenient access to single channel image data |
Cicl::cv::CheckerboardDetector::Checkerboard | Internally used and returned result structure |
Cicl::core::ChromaAndRGBClassifier | Combination classifier using RG-chroma. as well as RGB-thresholded reference color classifiation |
Cicl::core::ChromaClassifier | Classifier interface using RG-chromaticity space and two parables |
Cicl::qt::ChromaClassifierIO | |
Cicl::utils::CLDeviceContext | Allows preparation of the device used for CLPrograms |
Cicl::core::AbstractCanvas::ClipRect | |
Cicl::utils::CLKernel | Wrapper for an OpenCL Kernel |
►Cicl::utils::CLMemory | Base class for CLBuffer and CLImage2D |
Cicl::utils::CLBuffer | Wrapper for an OpenCL Buffer |
Cicl::utils::CLImage2D | Wrapper for an OpenCL Image2D |
Cicl::utils::CLMemoryAssistant | Helper class to maintain buffers and images for opencl-program pipelines |
Cicl::utils::CLProgram | Main class for OpenCL based accelleration |
Cicl::utils::VisualizationDescription::Color | Utility Color class |
Cicl::qt::Dragger::Color | Utility class which helps to convert rgb to RG-Chroma and back |
►Cicl::io::pylon::ColorConverter | Pure virtual interface for color converters |
Cicl::io::pylon::BayerToRgb8Icl | This ColorConverter uses the icl Bayer to Rgb conversion |
Cicl::io::pylon::Mono16sToMono16s | This ColorConverter is used for pylon-mono16s to icl-mono16s conversion |
Cicl::io::pylon::Mono8uToMono8u | This ColorConverter is used for pylon-mono8u to icl-mono8u conversion |
Cicl::io::pylon::MonoToMono8u | This ColorConverter is used for other pylon-mono to icl-mono8u conversion |
Cicl::io::pylon::PylonColorToRgb | This ColorConverter is used for pylon-bayer/yuv to icl-rgb conversion |
Cicl::io::pylon::Rgb8uToRgb8u | This ColorConverter is used for pylon-rgb to icl-rgb conversion |
Cicl::io::pylon::Yuv422ToRgb8Icl | This ColorConverter uses the icl Yuv422 to Rgb conversion |
Cicl::io::pylon::Yuv422YUYVToRgb8Icl | This ColorConverter uses the icl Yuv422YUYV to Rgb conversion |
Cicl::io::ColorFormatDecoder | The ColorFormatDecoder allows for easy conversion of special color formats to RGB |
Cicl::cv::ImageRegionData::ComplexInformation | Complex information, |
Cicl::io::ImageCompressor::CompressedData | Most simple dyn-size array with given data and length |
Cicl::io::ImageCompressor::CompressionSpec | Compression specification |
Cicl::io::pylon::ConcGrabberBuffer | This is used for concurrent writing and reading of ConvBuffers |
►Cicl::utils::Configurable | Interface for classes that can be configured from configuration-files and GUI-Components |
Cicl::cv::CheckerboardDetector | Utility class wrapping OpenCV's cvFindChessboardCorners |
Cicl::cv::CornerDetectorCSS | Curvature Corner Detector |
Cicl::cv::HoughLineDetector | |
Cicl::cv::ORBFeatureDetector | |
►Cicl::cv::RegionDetector | Complex utility class for detection of connected image components |
Cicl::utils::UncopiedInstance< icl::cv::RegionDetector > | |
Cicl::cv::TemplateTracker | Utility class vor viewbased template tracking |
Cicl::filter::ProximityOp | Class for computing proximity measures |
►Cicl::filter::UnaryOp | Abstract Base class for Unary Operators |
►Cicl::filter::BaseAffineOp | Abtract base class for arbitrary affine operation classes \ |
►Cicl::filter::AffineOp | Class to apply an arbitrary series of affine transformations \ |
Cicl::filter::RotateOp | Class to rotate images \ |
Cicl::filter::ScaleOp | Class to scale images \ |
Cicl::filter::TranslateOp | Class to translate images \ |
Cicl::filter::MirrorOp | Class to mirror images vertically or horizontally \ |
Cicl::filter::BilateralFilterOp | BilateralFilterICL class Gaussian bilateral filtering Implements the gaussian bilateral filtering like described in "A Fast Approximation of the Bilateral Filter using a Signal Processing Approach" (http://people.csail.mit.edu/sparis/publi/2006/tr/Paris_06_Fast_Bilateral_Filter_MIT_TR_low-res.pdf) on the GPU using OpenCL (no CPU-backend at the moment) |
Cicl::filter::CannyOp | Class for the canny edge detector |
Cicl::filter::ChamferOp | Chamfering Unit |
Cicl::filter::ColorDistanceOp | Class for creating a color distance map |
Cicl::filter::ColorSegmentationOp | Class for fast LUT-based color segmentation |
Cicl::filter::DitheringOp | Class that implements dithering mechanisms |
Cicl::filter::FFTOp | |
Cicl::filter::GaborOp | Applies Gabor filter operation on images |
Cicl::filter::IFFTOp | This class implements the unary operator for the inverse fast and discrete 2D fourier transformation |
Cicl::filter::IntegralImgOp | Class for creating integral images |
Cicl::filter::LocalThresholdOp | LocalThreshold Filter class |
Cicl::filter::LUTOp | Class for applying table lookup transformation to Img8u images |
Cicl::filter::LUTOp3Channel< T > | Class for applying table look-up transformation to 3-channel integer-valued images |
Cicl::filter::MotionSensitiveTemporalSmoothing | |
►Cicl::filter::NeighborhoodOp | Unary operators that work on each pixels neighborhood \ |
►Cicl::filter::ConvolutionOp | Class for Image convolutions |
Cicl::filter::DynamicConvolutionOp | Convolution using the ROI of an ICL image as its kernel \ |
Cicl::filter::MedianOp | Class that provides median filter abilities \ |
Cicl::filter::MorphologicalOp | Class for Morphological operations \ |
Cicl::filter::WienerOp | Class for Wiener Filter \ |
Cicl::filter::ThresholdOp | Class for thresholding operations |
Cicl::filter::UnaryArithmeticalOp | Class for Arithmetic Functions |
Cicl::filter::UnaryCompareOp | Class for comparing operations |
Cicl::filter::UnaryLogicalOp | Class for bitwise logical operations on pixel values |
Cicl::filter::UnaryOpPipe | Utility class that helps applying UnaryOps one after another |
Cicl::filter::WarpOp | Operator that remaps an image with given look-up map |
Cicl::filter::WeightChannelsOp | Weight pixel values of all image channels |
Cicl::filter::WeightedSumOp | Accumulate weighted pixel values of all image channels |
Cicl::geom::ConfigurableDepthImageSegmenter | |
Cicl::geom::CoplanarPointPoseEstimator | Utility class that allows for 6D pose estimation from a set of at least 4 coplanar points |
►Cicl::geom::PointCloudGrabber | Generic interface for PointCloud sources |
Cicl::geom::DepthCameraPointCloudGrabber | PointCloudGrabber implementation for 2D core::depth-image based creation of point clouds |
Cicl::geom::GenericPointCloudGrabber | Generic interface for PointCloud sources |
Cicl::geom::PCDFileGrabber | |
Cicl::geom::RSBPointCloudGrabber | Grabs points clouds from RSB |
►Cicl::geom::Scene | Scene Implementation that is used to handle a list of objects and cameras |
Cicl::physics::PhysicsScene | |
Cicl::geom::RansacBasedPoseEstimator | RANSAC-based pose estimation |
Cicl::io::DCDeviceFeatures | Utility class for handling DC-Device features |
Cicl::io::DCDeviceFeaturesImpl | |
►Cicl::io::Grabber | Common interface class for all grabbers |
Cicl::io::CreateGrabber | Create Grabber class that provides an image from ICL's create function |
Cicl::io::DCGrabber | Grabber implementation for handling DC-Devices using libdc1394 (Version >= 2.0.rc9) \ |
Cicl::io::DemoGrabber | Demo Grabber class providing am image with a moving rect |
Cicl::io::FileGrabber | Grabber implementation to grab from files \ |
Cicl::io::Kinect2Grabber | Special Grabber implementation for Microsoft's Kinect2 Device |
Cicl::io::KinectGrabber | Special Grabber implementation for Microsoft's Kinect Device |
Cicl::io::OpenCVCamGrabber | Grabber class that uses OpenCV's grabbing function to grab camera images |
Cicl::io::OpenCVVideoGrabber | Opencv base grabber implementation for movie files |
Cicl::io::OpenNIGrabber | Grabber implementation for OpenNI based camera access |
Cicl::io::OptrisGrabber | Grabber class that grabs images using the libImager library from Optris |
Cicl::io::PixelSenseGrabber | PixelSense Grabber class |
Cicl::io::pylon::PylonGrabber | Grabber implementation for a Basler Pylon-based GIG-E Grabber |
Cicl::io::RSBGrabber | Grabber implementation for RSB based image transfer |
Cicl::io::SharedMemoryGrabber | Grabber class that grabs images from SharedMemorySegment instances |
Cicl::io::SwissRangerGrabber | Grabber-Implementation for the SwissRanger time-of-flight camera using the libMesaSR library |
Cicl::io::V4L2Grabber | The Video for Linux 2 Grabber uses the v4l2-api to access video capturing devices \ |
Cicl::io::VideoGrabber | Xine-based Video Grabber (grabs most common image formats) |
Cicl::io::XiGrabber | Grabber class that grabs images using the XiAPI (extension of the M3API) |
Cicl::io::ZmqGrabber | Grabber class that grabs images from ZeroMQ-based network interfaces |
Cicl::qt::QtCameraGrabber | |
Cicl::qt::QtVideoGrabber | |
►Cicl::io::icl_openni::MapGeneratorOptions | This class interprets and sets Properties of OpenNI MapGenerators |
Cicl::io::icl_openni::DepthGeneratorOptions | This class interprets and sets Properties of OpenNI DepthGenerators |
Cicl::io::icl_openni::ImageGeneratorOptions | This class interprets and sets Properties of OpenNI ImageGenerators |
Cicl::io::pylon::PylonCameraOptions | This is a helper class for Pylon camera settings |
Cicl::markers::FiducialDetector | Main Fiducial Detector class |
►Cicl::markers::FiducialDetectorPlugin | Generic Interface class for FiducialDetector plugins |
►Cicl::markers::FiducialDetectorPluginForQuads | FiducialDetectorPlugin for quad-markers like ARToolkit and BCH-Code markers |
Cicl::markers::FiducialDetectorPluginART | FiducialDetectorPlugin for ARToolkit like markers using binary image patches as marker IDs |
Cicl::markers::FiducialDetectorPluginBCH | FiducialDetectorPlugin for ARToolkit+ like markers using BCH coded IDs |
►Cicl::markers::FiducialDetectorPluginHierarchical | Extra abstraction layer that defines a basic skeleton for the detection of hierarchical fiducials |
Cicl::markers::FiducialDetectorPluginAmoeba | FiducialDetectorPlugin for reacTIVision's 'amoeba' markers |
Cicl::markers::FiducialDetectorPluginICL1 | FiducialDetectorPlugin for ARToolkit+ like markers using BCH coded IDs |
►Cicl::markers::MarkerGridDetector | Utility class that allows a regular grid of fiducial markers to be tracked |
Cicl::markers::AdvancedMarkerGridDetector | Extension of the MarkerGridDetector class that provides a more advanced output |
Cicl::markers::MarkerGridPoseEstimator | Utility class that can estimate the pose of a defined marker grid |
Cicl::markers::MultiCamFiducialDetector | Fiducial detector class that allows for using multiple cameras at once for fiducial detection |
Cicl::markers::QuadDetector | Tool-class for detecting tilted quads in images |
Cicl::math::LLM | Local Linear Map implementation (LLM) |
►Cicl::physics::SoftObject | This class combines a soft-body physics object and it's graphical representation in ICL |
►Cicl::physics::PhysicsPaper | This class represents cloth or paper like soft-body objects |
Cicl::physics::ManipulatablePaper | Extension of the standard physical paper class |
Cicl::physics::PhysicsPaper3 | |
Cicl::physics::PhysicsPaper3 | |
►Cicl::qt::AbstractPlotWidget | The PlotWidget is an abstract base class for 2D plotting components |
►Cicl::qt::LowLevelPlotWidget | Default AbstractPlotWidget implementation for plotting different kinds of data |
►Cicl::qt::PlotWidget | Easy to use widget component for 2D data visualization |
Cicl::qt::HistogrammWidget | Utility class used within the ICLWidget class |
►Cicl::utils::ConfigurableProxy | This class provides the getter and setter methods of an internally set Configurable |
Cicl::io::GenericGrabber | Common interface class for all grabbers |
►Cicl::qt::ContainerHandle | Base class for Container like GUI handles as Box- or Tab widgets |
Cicl::qt::BoxHandle | A Handle for container GUI components (hbox, vbox, hscroll and vscroll) |
Cicl::qt::SplitterHandle | A Handle for SplitterWidget container GUI components |
Cicl::qt::TabHandle | A Handle for TabWidget container GUI components |
Cicl::cv::Contour | Utility class used by the ContourDetector |
Cicl::cv::ContourImpl | |
Cicl::io::pylon::ConvBuffers | This class holds all buffers needed for ColorConversion |
Cicl::filter::ConvolutionKernel | Utility struct for managing convolution kernel data |
Cicl::geom::CoPlanarityFeatureExtractor | Class for coplanarity feature |
Cicl::cv::ImageRegionData::CSSParams | |
Cicl::geom::CurvatureFeatureExtractor | Class for curvature feature (open and occluded objects) |
Cicl::geom::CutfreeAdjacencyFeatureExtractor | |
Cicl::math::GraphCutter::CutNode | |
Cicl::qt::DataStore::Data | Arbitrary Data encapsulation type |
Cicl::math::LevenbergMarquardtFitter< Scalar >::Data | Utility structure that is used in the static create_data utlity method |
Cicl::utils::ConfigFile::Data | Data- type used for the []-operator of ConfigFile instances |
Cicl::utils::MultiTypeMap::DataArray | Internally used data handling structure |
►Cicl::core::DataSegmentBase | Abstract data segment class |
Cicl::core::DataSegment< float, 2 > | |
Cicl::core::DataSegment< float, 4 > | |
Cicl::core::DataSegment< T, N > | The DataSegment class defines a strided data segment (or 1D or 2D ordred array of vectors) |
Cicl::core::DataSegment< T, 1 > | Template specialization for data-segments, where each entry is just 1D |
Cicl::io::DCDevice | Device struct, used by the DCGrabber class to identify devices |
Cicl::io::DCDeviceFeaturesImplDelOp | |
Cicl::io::DCDeviceOptions | Utility struct for DC Camera device options |
Cicl::io::dc::DCFrameQueue | Internal used utility class for fast handling of DMA buffers |
►Cicl::markers::DecodedBCHCode | BCH decoder result |
Cicl::markers::DecodedBCHCode2D | Slightly more comples decoding result that does also contain an rotation value |
Cicl::cv::FloodFiller::DefaultCriterion< T > | Predefined criterion for simple reference-value based filling for 1-channel images |
►Cicl::utils::DelOpBase | Pure Interface class for DelOps |
Cicl::core::CvMatDelOp | Utility Delete Operator used within CvMatWrapper |
Cicl::utils::ArrayDelOp | Array delete operation class for the SmartPtr class |
Cicl::utils::FreeDelOp | C-Style delete operation class for the SmartPtr class |
Cicl::utils::PointerDelOp | Pointer delete operation class for the SmartPtr class |
►Cicl::geom::PointCloudSerializer::DeserializationDevice | |
Cicl::geom::PointCloudSerializer::DefaultDeserializationDevice | |
Cicl::geom::ProtoBufSerializationDevice | |
Cicl::geom::IterativeClosestPoint< T >::DistanceID | |
Cicl::qt::Dragger | Utility class that implements draggable rects on the ChromaWidget surface |
►Cicl::math::DynMatrix< T > | Highly flexible and optimized matrix class implementation |
Cicl::math::DynColVector< T > | Extension class for the DynMatrix<T> template, that restricts the the matrix column count to 'one' |
Cicl::math::DynRowVector< T > | |
Cicl::math::DynMatrix< bool > | |
Cicl::math::DynMatrix< double > | |
►Cicl::math::DynMatrix< float > | |
Cicl::math::DynColVector< float > | |
Cicl::math::DynMatrix< icl64f > | |
►Cicl::math::DynMatrix< Scalar > | |
Cicl::math::DynColVector< Scalar > | |
Cicl::math::DynMatrix< T >::DynMatrixColumn | Internally used Utility structure referencing a matrix column shallowly |
Cicl::io::JPEGEncoder::EncodedData | Encoded data type |
Cicl::utils::ConfigFile::Entry | Internal utility structure for contained data |
Cicl::utils::MultiTypeMap::Entry | Entry struct used in getEntryList function |
Cicl::cv::RegionGrower::EqualThreshold | |
Cicl::geom::EuclideanBlobSegmenter | |
Cicl::geom::SQFitter::eulerPosError | Structure, that contains the error function for the euler angles and position parameters |
Cicl::qt::DataStore::Data::Event | Internally used Data- Structure |
►Cstd::exception | STL class |
►Cstd::runtime_error | STL class |
►Cicl::utils::ICLException | Base class for Exception handling in the ICL |
Cicl::geom::Camera::NotEnoughDataPointsException | We need at least 6 Data points in general positions |
Cicl::math::FFTException | Special exception implementation for the FFT package |
Cicl::math::IncompatibleMatrixDimensionException | Special linear algebra exception type \ |
Cicl::math::InvalidIndexException | Special linear algebra exception type \ |
Cicl::math::InvalidMatrixDimensionException | Special linear algebra exception type \ |
Cicl::math::SingularMatrixException | Special linear algebra exception type \ |
Cicl::qt::DataStore::KeyNotFoundException | Internal Exception type thrown if operator[] is given an unknown index string |
Cicl::qt::DataStore::UnassignableTypesException | Internal Exception type thrown if Data::operator= is called for incompatible values |
Cicl::qt::GUISyntaxErrorException | Internally used and caught exception class for the GUI API |
Cicl::qt::ICLApplication::SecondSingeltonException | Such an exception is returned if a 2nd instance of ICLApplication is created |
►Cicl::utils::CLException | Base class for an OpenCL Exception |
Cicl::utils::CLBufferException | Class for an OpenCL Exception associated with buffers |
Cicl::utils::CLBuildException | Class for an OpenCL Exception during kernel compiling |
Cicl::utils::CLInitException | Class for an OpenCL Exception during initialization |
Cicl::utils::CLKernelException | Class for an OpenCL Exception associated with kernels |
Cicl::utils::ConfigFile::EntryNotFoundException | Internal exception type, thrown if an entry was not found |
Cicl::utils::ConfigFile::InvalidTypeException | Internal exception type, thrown if an entry type missmatch occurs |
Cicl::utils::ConfigFile::UnregisteredTypeException | Thrown if unregistered types are used |
Cicl::utils::FileNotFoundException | Exception thrown if a file could not be found |
Cicl::utils::FileOpenException | Exception thrown if a file could not be opend |
Cicl::utils::ICLDynamicFunctionLoadException | |
Cicl::utils::ICLDynamicLibLoadException | |
Cicl::utils::InvalidDepthException | Exception thrown if a function should process an unsupported image depth |
Cicl::utils::InvalidFileException | Exception thrown if a file could not be read properly |
Cicl::utils::InvalidFileFormatException | Exception for invalid file formats |
Cicl::utils::InvalidFormatException | Exception thrown if a function should process an unsupported image format |
Cicl::utils::InvalidImgParamException | Exception called if an image gets invalid params |
Cicl::utils::InvalidNumChannelException | Exception thrown if a function should process an unsupported image depth |
Cicl::utils::InvalidRegularExpressionException | Thrown by iclStringUtils::match if regular Expression is not valid |
Cicl::utils::InvalidSizeException | Exception thrown if a function should process an unsupported sizes (e.g. with negative dim..) |
Cicl::utils::ParseException | Exception thrown if a string is parsed into a specific type (or something) |
Cicl::utils::ProgArgException | Programm argument environment exception type \ |
Cicl::cv::Extrapolator< valueType, timeType > | Class for linear and quadatic extrapolation |
Cicl::physics::PhysicsPaper3::Structure::Face | |
Cicl::utils::FastMedianList | Utility class for fast calculation of a median (calculating a median in O(N)) |
Cicl::geom::FeatureGraphSegmenter | |
Cicl::markers::Fiducial | Main class for detected image markers/fiducials |
Cicl::markers::FiducialImpl | Hidden implemetation for fiduical classes |
►Cicl::io::FileGrabberPlugin | Interface for ImageGrabber Plugins for reading different file types |
Cicl::io::FileGrabberPluginBICL | Plugin to grab binary icl image (.bicl or .bicl.gz) |
Cicl::io::FileGrabberPluginCSV | FileGrabber plugins for writing ".csv" files (Comma-Separated Values) |
Cicl::io::FileGrabberPluginImageMagick | Interface class for reading images using an ImageMagick++ wrapper |
Cicl::io::FileGrabberPluginJPEG | Plugin class to read "jpeg" and "jpg" images |
Cicl::io::FileGrabberPluginPNG | Plugin class to read "png" images |
Cicl::io::FileGrabberPluginPNM | Plugin to grab ".ppm", ".pgm", ".pgm" and ".icl" images |
►Cicl::io::FileWriterPlugin | Interface class for writer plugins writing images in different file formats |
Cicl::io::FileWriterPluginBICL | Writer plugin to write binary icl image (extension bicl / bicl.gz) |
Cicl::io::FileWriterPluginCSV | Writer plugins for ".csv"-files (Comma-Separated Values) |
Cicl::io::FileWriterPluginImageMagick | Interface class for writing images using an ImageMagick++ wrapper |
Cicl::io::FileWriterPluginJPEG | A Writer Plugin for writing ".jpeg" and ".jpg" images |
Cicl::io::FileWriterPluginPNG | A Writer Plugin for writing ".png" images |
Cicl::io::FileWriterPluginPNM | Writer plugin to write images as ".ppm", ".pgm", ".pnm" and ".icl" |
►Cicl::geom::Primitive3DFilter::FilterAction | General filter action |
Cicl::geom::Primitive3DFilter::ColorAction | Color action |
Cicl::geom::Primitive3DFilter::FilterDepthImgAction | Filterdepthimg action |
Cicl::geom::Primitive3DFilter::IntensityAction | Intensity action |
Cicl::geom::Primitive3DFilter::LabelAction | Label action |
Cicl::geom::Primitive3DFilter::RemoveAction | Remove action |
Cicl::geom::Primitive3DFilter::SetposAction | Setpos action |
Cicl::geom::Primitive3DFilter::FilterConfig | Filter config |
Cicl::utils::FixedArray< T, DIM > | Fixed C++-array wrapper class for data handling |
►Cicl::utils::FixedArray< float, COLS *ROWS > | |
►Cicl::math::FixedMatrix< float, 1, DIM > | |
Cicl::math::FixedColVector< float, 2 > | |
Cicl::math::FixedColVector< float, 3 > | |
Cicl::math::FixedColVector< float, 4 > | |
Cicl::math::FixedMatrix< float, 2, 2 > | |
Cicl::math::FixedMatrix< float, 3, 3 > | |
►Cicl::utils::FixedArray< icl32f, COLS *ROWS > | |
►Cicl::math::FixedMatrix< icl32f, 1, DIM > | |
Cicl::math::FixedColVector< icl32f, 3 > | |
Cicl::math::FixedColVector< icl32f, 4 > | |
Cicl::math::FixedMatrix< icl32f, 3, 3 > | |
►Cicl::math::FixedMatrix< icl32f, 4, 4 > | |
Cicl::geom::Posit::Result | Result type (basically a 4x4 homogeneous transformation matrix) |
►Cicl::utils::FixedArray< icl8u, COLS *ROWS > | |
►Cicl::math::FixedMatrix< icl8u, 1, DIM > | |
Cicl::math::FixedColVector< icl8u, 3 > | |
Cicl::math::FixedColVector< icl8u, 4 > | |
►Cicl::utils::FixedArray< int, COLS *ROWS > | |
►Cicl::math::FixedMatrix< int, 1, DIM > | |
►Cicl::math::FixedColVector< int, 2 > | |
Cicl::geom::LinePrimitive | Line primitive (the line references 2 vertices) |
Cicl::math::FixedColVector< int, 4 > | |
►Cicl::math::FixedColVector< int, 6 > | |
Cicl::geom::TrianglePrimitive | Triangle primitive |
►Cicl::math::FixedColVector< int, 8 > | |
►Cicl::geom::QuadPrimitive | Quad primitive |
Cicl::geom::SharedTexturePrimitive | The shared texture primitive references a texture from the parent SceneObject |
Cicl::geom::TexturePrimitive | Texture Primitive |
Cicl::utils::FixedArray< T, 1u > | Specialization for 1D-vectors providing a value x |
Cicl::utils::FixedArray< T, 2u > | Specialization for 2D-matrics providing direct access to values x, y |
Cicl::utils::FixedArray< T, 3u > | Specialization for 3D-matrics providing direct access to values x, y, z |
Cicl::utils::FixedArray< T, 4u > | Specialization for 4D-matrics providing direct access to values x, y, z and h |
►Cicl::utils::FixedArray< T, COLS *ROWS > | |
►Cicl::math::FixedMatrix< T, 1, DIM > | |
Cicl::math::FixedColVector< T, DIM > | |
►Cicl::math::FixedMatrix< T, 3, 3 > | |
Cicl::math::GenericHomography2D< T > | Utility structure that represents a 2D homography (implemented for float and double) |
►Cicl::math::FixedMatrix< T, DIM, 1 > | |
Cicl::math::FixedRowVector< T, DIM > | |
Cicl::math::FixedMatrix< T, COLS, ROWS > | Powerful and highly flexible matrix class implementation |
►Cicl::math::FixedMatrixBase | FixedMatrix base struct defining datamode enum |
Cicl::math::FixedMatrix< float, 1, DIM > | |
Cicl::math::FixedMatrix< float, 2, 2 > | |
Cicl::math::FixedMatrix< float, 3, 3 > | |
Cicl::math::FixedMatrix< icl32f, 1, DIM > | |
Cicl::math::FixedMatrix< icl32f, 3, 3 > | |
Cicl::math::FixedMatrix< icl32f, 4, 4 > | |
Cicl::math::FixedMatrix< icl8u, 1, DIM > | |
Cicl::math::FixedMatrix< int, 1, DIM > | |
Cicl::math::FixedMatrix< T, 1, DIM > | |
Cicl::math::FixedMatrix< T, 3, 3 > | |
Cicl::math::FixedMatrix< T, DIM, 1 > | |
Cicl::math::FixedMatrix< T, COLS, ROWS > | Powerful and highly flexible matrix class implementation |
Cicl::math::FixedMatrixPart< T, N, Iterator > | Utility struct for FixedMatrix sub-parts |
Cicl::cv::RegionGrower::Float4EuclideanDistance | |
Cicl::cv::FloodFiller | Utility class for image flood filling |
Cicl::FoldMap | Discretized paper space representing folds |
Cicl::physics::FoldMap | Discretized paper space representing folds |
Cicl::io::FourCC | Wrapper class for fourcc color codes |
►Cicl::utils::FPSEstimator | Utility clas for online FPS estimation |
Cicl::utils::FPSLimiter | An fps limiter can be used to limit online applications FPS |
Cicl::utils::Function< R, A, B, C > | The General Function Template |
Cicl::utils::Function< icl64f, const Model &, const DataPoint & > | |
Cicl::utils::Function< Matrix, const Params &, const Matrix & > | |
Cicl::utils::Function< Model, const DataSet & > | |
Cicl::utils::Function< T *, const Data & > | |
Cicl::utils::Function< Vector, const Params &, const Vector & > | |
Cicl::utils::Function< void > | |
Cicl::utils::Function< void, const DataPoint &, T * > | |
Cicl::utils::Function< void, const Result & > | |
Cicl::utils::Function< void, const std::string & > | |
Cicl::utils::Function< void, const utils::Point32f &, double * > | |
Cicl::utils::Function< void, icl::physics::PhysicsObject *, icl::physics::PhysicsObject *, icl::math::FixedColVector > | |
►Cicl::utils::FunctionImpl< R, A, B, C > | General Implementation for binary functions |
Cicl::utils::ConstFunctorFunctionImpl< Object, R, A, B, C > | FunctionImpl implementation for functors of const objects |
Cicl::utils::ConstMemberFunctionImpl< Object, R, A, B, C > | FunctionImpl implementation for const member functions |
Cicl::utils::FunctorFunctionImpl< Object, R, A, B, C > | FunctionImpl implementation for Functors |
Cicl::utils::GlobalFunctionImpl< R, A, B, C > | FunctionImpl implementation for global functions |
Cicl::utils::MemberFunctionImpl< Object, R, A, B, C > | FunctionImpl implementation for member functions |
Cicl::utils::FunctionImpl< icl64f, const Model &, const DataPoint &, NO_ARG > | |
Cicl::utils::FunctionImpl< Matrix, const Params &, const Matrix &, NO_ARG > | |
Cicl::utils::FunctionImpl< Model, const DataSet &, NO_ARG, NO_ARG > | |
Cicl::utils::FunctionImpl< R, A, B, NO_ARG > | Special Implementation for unary functions |
Cicl::utils::FunctionImpl< R, A, NO_ARG > | Special Implementation for unary functions |
Cicl::utils::FunctionImpl< R, NO_ARG > | Special Implementation for void functions |
Cicl::utils::FunctionImpl< T *, const Data &, NO_ARG, NO_ARG > | |
Cicl::utils::FunctionImpl< Vector, const Params &, const Vector &, NO_ARG > | |
Cicl::utils::FunctionImpl< void, const DataPoint &, T *, NO_ARG > | |
Cicl::utils::FunctionImpl< void, const Result &, NO_ARG, NO_ARG > | |
Cicl::utils::FunctionImpl< void, const std::string &, NO_ARG, NO_ARG > | |
Cicl::utils::FunctionImpl< void, const utils::Point32f &, double *, NO_ARG > | |
Cicl::utils::FunctionImpl< void, icl::physics::PhysicsObject *, icl::physics::PhysicsObject *, icl::math::FixedColVector > | |
Cicl::utils::FunctionImpl< void, NO_ARG, NO_ARG, NO_ARG > | |
Cicl::cv::CornerDetectorCSS::GaussianKernel | 1 dim gaussian kernel |
Cicl::qt::ICLDrawWidget3D::GLCallback | Internally used callback class type |
Cicl::io::GrabberDeviceDescription | Defines and explains an available grabber device |
Cicl::io::pylon::GrabbingInterruptor | Utility Structure |
Cicl::filter::GradientImage | Class for calculation of gradient image information |
Cicl::utils::GRand | Lightweight Random generator class for gaussian distributed numbers |
Cicl::utils::GRandClip | Lightweight Random generator class for gaussian distributed numbers clipped to a given range |
Cicl::math::GraphCutter | Class for graph cut algorithms on undirected graphs (a graph is represented by an adjacency matrix) |
►Cicl::markers::MarkerGridDetector::GridDefinition | Marker Grid geometry definition type |
Cicl::markers::AdvancedMarkerGridDetector::AdvancedGridDefinition | |
►Cicl::qt::GUI | Main Class of ICL's GUI creation framework |
Cicl::qt::ChromaGUI | Dedicated GUI component which can be used to adjust segmentation parameters |
►Cicl::qt::ContainerGUIComponent | Special GUI extension, that mimics the GUIComponent interface |
Cicl::qt::Border | Internally used component |
Cicl::qt::HBox | Horizonal Box container component |
Cicl::qt::HScroll | Horizontal scroll area |
Cicl::qt::HSplit | Horizontal split-component |
Cicl::qt::Tab | Tab-compnent |
Cicl::qt::VBox | Vertical Box container component |
Cicl::qt::VScroll | Vertical scroll area |
Cicl::qt::VSplit | Vertical split-component |
Cicl::qt::DynamicGUI | Special GUI implementation that allows for defining the GUI layout in an XML-file |
►Cicl::qt::GUIComponent | Servers as a generic interface for GUI definitions |
Cicl::geom::Plot3D | Specialized 3D visualization component intended for 3D-box plots (needs ICLGeom-library to be linked) |
Cicl::qt::CamCfg | Camera configuration component |
Cicl::qt::Combo | ComboBox GUI component |
Cicl::qt::Create | Finalizes GUI creation (actually creates the Qt-GUI but initially hidden) |
Cicl::qt::Disp | Display component for a 2D Array of labels |
Cicl::qt::Draw | Image visualization component that allows for overlayed 2D image annotation |
Cicl::qt::Draw3D | Image visualization compoent that allows for 2D and 3D image annotation |
Cicl::qt::Dummy | Creates not component |
Cicl::qt::Fps | Frames per second estimator component |
►Cicl::qt::GUIComponentWithOutput | |
Cicl::qt::Button | Button Component |
Cicl::qt::ButtonGroup | ButtonGroup component (aka vertical list of radio buttons) |
Cicl::qt::CheckBox | CheckBox component |
Cicl::qt::ColorSelect | Color selection component |
Cicl::qt::Float | Text Input component, that allows float inputs in a given range |
Cicl::qt::FSlider | Float-valued Slider component |
Cicl::qt::Int | Text Input component, that allows integer inputs in a given range |
Cicl::qt::Slider | Slider component for int-ranges |
Cicl::qt::Spinner | SpinBox component |
Cicl::qt::Image | Image visualization component |
Cicl::qt::Label | Label component for displaying text |
Cicl::qt::Plot | 2D function and data plotting component |
Cicl::qt::Prop | Propery adjustment component for configuable instances |
Cicl::qt::Ps | Process status component |
Cicl::qt::Show | Finalizes GUI creation (actually creates the Qt-GUI and makes it visible) |
Cicl::qt::State | For a state log panel |
Cicl::qt::String | Text Input component, that allows float inputs with a given maximun length |
Cicl::qt::GUIDefinition | Utilty class to simplify creation of GUI components |
►Cicl::qt::GUIHandleBase | Base class for GUIHandles providing functions to register callbacks |
►Cicl::qt::GUIHandle< ColorLabel > | |
Cicl::qt::ColorHandle | Class wrapping ColorLabel GUI compoenent handling |
►Cicl::qt::GUIHandle< CompabilityLabel > | |
Cicl::qt::FPSHandle | Class for Frames-per-second GUI-Label |
Cicl::qt::LabelHandle | Class for GUI-Label handling |
►Cicl::qt::GUIHandle< ICLDrawWidget > | |
Cicl::qt::DrawHandle | Handle class for image components |
Cicl::qt::MultiDrawHandle | Handle class for image components |
►Cicl::qt::GUIHandle< ICLDrawWidget3D > | |
Cicl::qt::DrawHandle3D | Handle class for image components |
►Cicl::qt::GUIHandle< ICLWidget > | |
Cicl::qt::ImageHandle | Handle class for image components |
►Cicl::qt::GUIHandle< LabelMatrix > | |
Cicl::qt::DispHandle | Handle class for disp components |
►Cicl::qt::GUIHandle< PlotWidget > | |
Cicl::qt::PlotHandle | Handle class for image components |
►Cicl::qt::GUIHandle< PlotWidget3D > | |
Cicl::geom::PlotHandle3D | Handle class for image components |
►Cicl::qt::GUIHandle< QCheckBox > | |
Cicl::qt::CheckBoxHandle | Special Utiltiy class for handling Button clicks in the ICL GUI API |
►Cicl::qt::GUIHandle< QComboBox > | |
Cicl::qt::ComboHandle | Handle class for combo components |
►Cicl::qt::GUIHandle< QGroupBox > | |
Cicl::qt::BorderHandle | Handle class for "border" gui components (only for explicit "border" components) |
►Cicl::qt::GUIHandle< QLineEdit > | |
Cicl::qt::FloatHandle | Class for handling "float" textfield components |
Cicl::qt::IntHandle | Class for handling "int" textfield components |
Cicl::qt::StringHandle | Class for handling "string" textfield components |
►Cicl::qt::GUIHandle< QPushButton > | |
Cicl::qt::ButtonHandle | Special Utiltiy class for handling Button clicks in the ICL GUI API |
►Cicl::qt::GUIHandle< QSpinBox > | |
Cicl::qt::SpinnerHandle | Handle class for spinner components |
►Cicl::qt::GUIHandle< QSplitter > | |
Cicl::qt::SplitterHandle | A Handle for SplitterWidget container GUI components |
►Cicl::qt::GUIHandle< QTabWidget > | |
Cicl::qt::TabHandle | A Handle for TabWidget container GUI components |
►Cicl::qt::GUIHandle< QWidget > | |
Cicl::qt::BoxHandle | A Handle for container GUI components (hbox, vbox, hscroll and vscroll) |
►Cicl::qt::GUIHandle< RadioButtonVec > | |
Cicl::qt::ButtonGroupHandle | Class for handling button goups |
►Cicl::qt::GUIHandle< ThreadedUpdatableSlider > | |
Cicl::qt::FSliderHandle | Handle class for slider componets |
Cicl::qt::SliderHandle | Handle class for slider componets |
►Cicl::qt::GUIHandle< ThreadedUpdatableTextView > | |
Cicl::qt::StateHandle | Class for GUI-Label handling a so called state component |
Cicl::qt::GUIHandle< T > | Abstract base class for Handle classes |
Cicl::io::ImageCompressor::Header | Compressed image header |
Cicl::io::FileGrabberPlugin::HeaderInfo | Internally used collection of image parameters |
Cicl::geom::Hit | Utility structure that defines a hit between a ViewRay and SceneObjects |
Cicl::cv::HoughLine | Line Equation structure |
Cicl::cv::HungarianAlgorithm< real > | Implementation of the Hungarian Algorithm to solve Linear Assignment problems |
Cicl::qt::IconFactory | Simple utility class providing static functions to create some icons |
Cicl::filter::ImageRectification< T > | The ImageRectification class can be use to rectify an image quadrangle (IPP accellerated) |
Cicl::cv::ImageRegion | ImageRegion Structure providing region feature information |
Cicl::cv::ImageRegionData | Utility class for shallow copied data of image region class |
Cicl::cv::ImageRegionPart | The ImageRegionPart represents a intermediate region part for the connected component analysis |
Cicl::core::ImageSerializer | Utility class for binary Image Serialization |
Cicl::filter::ImageSplitter | Utility class to split an images roi into a set of shallow copies |
Cicl::qt::ImageStatistics | |
►Cicl::io::ImageUndistortion | |
Cicl::io::IntrinsicCalibrator::Result | Simple struct for handle result of computation of intrinsics |
►Cicl::core::ImgBase | ImgBase is the Image-Interface class that provides save access to underlying Img-template \ |
►Cicl::core::Img< Type > | The Img class implements the ImgBase Image interface with type specific functionalities \ |
Cicl::utils::UncopiedInstance< icl::core::Img > | |
Cicl::core::Img< icl32f > | |
Cicl::core::Img< icl8u > | |
Cicl::core::Img< ICL_QUICK_TYPE > | |
Cicl::core::Img< T > | |
Cicl::core::ImgBasePtrPtr< T > | Utility class that helps for an implicit conversion between Img<T>* to ImgBase** |
Cicl::core::ImgBorder | Class to setup an images border pixels |
Cicl::core::ImgParams | Stores all image parameters \ |
Cicl::qt::ImgROI | Internal stuct, used for deep image copies |
Cicl::cv::LensUndistortionCalibrator::Info | Internally used info structure (also returned by LensUndistortionCalibrator::getInfo) |
Cicl::utils::ProcessMonitor::Info | Utility struct, that is used to pass available information at once |
Cicl::markers::FiducialImpl::Info2D | Set of 2D features |
Cicl::markers::FiducialImpl::Info3D | Set of 3D features |
►Cicl::filter::InplaceOp | Interface class for inplace operators |
Cicl::filter::InplaceArithmeticalOp | Inplace implementation for arithmetical operations |
Cicl::filter::InplaceLogicalOp | Filter class for logical in-place operations |
►Cicl::io::pylon::Interruptable | Utility Structure |
Cicl::io::pylon::PylonGrabber | Grabber implementation for a Basler Pylon-based GIG-E Grabber |
Cicl::physics::TriangleIntersectionEstimator::Intersection | |
►CIppiPoint | |
Cicl::utils::Point | Point class of the ICL used e.g. for the Images ROI offset |
►CIppiRect | |
►Cicl::utils::Rect | Rectangle class of the ICL used e.g. for the Images ROI-rect |
Cicl::qt::DefineRectanglesMouseHandler::DefinedRect | Internally used utils::Rect structure |
►CIppiSize | |
►Cicl::utils::Size | Size class of the ICL |
Cicl::geom::Scene::PBufferIndex | |
Cicl::geom::IterativeClosestPoint< T > | |
►Citerator | |
Cicl::math::DynMatrix< T >::col_iterator | Internal column iterator struct (using height-stride) |
Cicl::math::FixedMatrix< T, COLS, ROWS >::col_iterator | Internal struct for row-wise iteration with stride=COLS |
►Cicl::math::MatrixSubRectIterator< Type > | Iterator class used to iterate through a sub rect of 2D data |
Cicl::core::ImgIterator< Type > | Iterator class used to iterate through an Images ROI-pixels |
Cicl::io::JPEGDecoder | Utility class for decoding JPEG-Data streams (with ICL_HAVE_LIBJPEG only) |
Cicl::math::LLM::Kernel | Internally used Kernel structure |
Cicl::markers::Fiducial::KeyPoint | Key point structure |
Cicl::markers::AdvancedMarkerGridDetector::Marker::KeyPoints | Internal key-point structure |
Cicl::utils::ConfigFile::KeyRestriction | Utility Type for restriction of type values |
Cicl::io::Kinect11BitCompressor | |
Cicl::math::KMeans< Vector, Scalar > | Generic Implementation of the K-Means algorithm |
Cicl::cv::opensurf::Kmeans | Kmeans clustering |
Cicl::math::LeastSquareModelFitting< T, DataPoint > | Direct Least Square Fitting Algorithm |
►Cicl::math::LeastSquareModelFitting< double, utils::Point32f > | |
Cicl::math::LeastSquareModelFitting2D | Direct Least Square Fitting specialization for 2D input data |
Cicl::math::LevenbergMarquardtFitter< Scalar > | Utility class implementing the multidimensional Levenberg Marquardt Algorithm for non-linear Optimization |
Cicl::math::LevenbergMarquardtFitter< float > | |
Cicl::core::Line | The ICLs abstract line class describing a line from Point "start" to Point "end" |
Cicl::markers::MarkerGridEvaluater::Line | |
Cicl::core::Line32f | The ICLs abstract line class describing a line from Point "start" to Point "end" |
Cicl::math::LinearTransform1D | A standard linear mapping class for the 1D case f(x) = m * x + b |
Cicl::core::LineSampler | Utility class for line sampling |
►Cicl::cv::LineSegment | Line segment class (e.g. used for run-length coding) |
Cicl::cv::WorkingLineSegment | The working line segment class extends the LineSegment class by some working parameters |
Cicl::physics::PhysicsPaper3::LinkState | |
Cicl::utils::CLKernel::LocalMemory | Struct that represents the dynamic local memory for a kernel |
►Cicl::utils::Lockable | Interface for objects, that can be locked using an internal mutex |
Cicl::geom::Scene | Scene Implementation that is used to handle a list of objects and cameras |
►Cicl::physics::PhysicsWorld | A physical world that handles physical objects |
Cicl::physics::PhysicsScene | |
Cicl::qt::AdjustGridMouseHandler | Special MouseHandler Implementation that allows several quadrangular grids to be defined |
Cicl::qt::DefineQuadrangleMouseHandler | Special MouseHandler Implementation that allows for defining a quadrangle |
Cicl::qt::DefineRectanglesMouseHandler | Utility mouse handler implementation that allows to define rectangles via drag and drop |
Cicl::qt::DragRectangleMouseHandler | Special MouseHandler implementation that allows for dragging a Rectangle |
Cicl::utils::ConfigFile | Utility class for creating and reading XML-based hierarchical configuration files |
Cicl::qt::AbstractPlotWidget::Locker | Utility class for scoped locking |
Cicl::filter::LUT2D< RESULT_T, IDX_T > | Simple 2D indexed LUT Implementation |
Cicl::geom::ObjectEdgeDetectorData::m_kernel | |
Cicl::geom::ObjectEdgeDetectorData::m_params | |
Cicl::geom::PointCloudSerializer::MandatoryInfo | Mandatory information provided by each point cloud |
►Cstd::map< K, T > | STL class |
Cicl::utils::ParamList | Utility structure that utilizes an std::map as parameter list |
Cicl::utils::ConfigFile::Maps | Internally used type map class |
Cicl::markers::AdvancedMarkerGridDetector::Marker | Internal data-class the represents a more sophisticated |
►Cicl::markers::MarkerCodeICL1 | Utility class for markers of type "icl1" |
Cicl::markers::MarkerMetricsICL1 | Marker metrics for "icl1" markers |
Cicl::markers::MarkerGridBasedUndistortionOptimizer | |
Cicl::markers::MarkerGridEvaluater | |
Cicl::cv::ORBFeatureDetector::Match | |
Cicl::utils::MatchResult::Match | |
Cicl::utils::MatchResult | Utility structure for matching results |
Cicl::core::MatWrapper | Very simply wrapper about the opencv C++ matrix type cv::Mat |
Cicl::cv::MeanShiftTracker | |
Cicl::io::DCDevice::Mode | Internally used Mode struct (combination of videomode and framerate) |
Cicl::qt::MouseEvent | Provided by interface MouseGrabber |
Cicl::geom::MouseMappingTableEntry | Mouse mapping table entry |
Cicl::geom::MouseSensitivities | Mouse sensitivities |
Cicl::markers::MultiCamFiducial | Fiducial Type for the MuliCamFiducialDetector |
Cicl::markers::MultiCamFiducialImpl | Internal Implementation class for the MutiCamFiducial |
►Cicl::utils::MultiTypeMap | Abstract and associative Data Container for Data of different types |
Cicl::qt::DataStore | Extension of the associative container MultiTypeMap |
Cicl::io::MyrmexDecoder | |
Cicl::math::SOM::Neuron | SOM internal Neuron struct |
Cicl::math::KDTree::Node | Keeps data of node |
Cicl::math::Octree< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE >::Node | Internally used node structure |
Cicl::math::QuadTree< Scalar, CAPACITY, SF, ALLOC_CHUNK_SIZE, VECTOR_TYPE >::Node | Internally used node structure |
Cicl::qt::DynamicGUI::Node | Internal xml-parsing node class |
Cicl::physics::PhysicsPaper3::NodeMovement | |
Cicl::geom::ObjectEdgeDetector | |
Cicl::geom::ObjectEdgeDetectorData | |
►Cicl::math::Octree< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE > | Generic Octree Implementation |
Cicl::geom::OctreeObject< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE > | The OctreeObjects provides a visualizable SceneObject interface for the Octree class |
►Cicl::math::Octree< float, CAPACITY, SF, Vec, ALLOC_CHUNK_SIZE > | |
►Cicl::geom::OctreeObject< float, 16, 1, Vec, 1024 > | |
Cicl::geom::RayCastOctreeObject | Special Octree implemenation that supports to query points close to caste rays |
Cicl::math::Octree< icl32f, 16, 1, FixedColVector< icl32f, 4 > > | |
Cicl::filter::OpROIHandler | Utility base class for Image Operators |
Cicl::qt::GUIComponent::Options | Actual options (set using the .xxx methods) |
Cicl::qt::DefineRectanglesMouseHandler::Options | Cummulative Options structure |
►Cicl::qt::PaintEngine | Pure virtual Paint engine interface |
Cicl::qt::GLPaintEngine | Paint engine to be used in QGLWigets for a high performance image visualization |
Cicl::core::Parable | Utility class for the parable-based chromaticity segmentation |
Cicl::io::ImageCompressor::Header::Params | |
Cicl::utils::VisualizationDescription::Part | Single part of the the visualization pipeline |
Cicl::markers::MarkerGridEvaluater::Line::PCAInfo | |
Cicl::qt::AbstractPlotWidget::Pen | Utility structure for styles usend in subclasses |
Cicl::core::PixelRef< T > | Pixel-Type class for copying image pixles to image pixels |
Cicl::geom::PlanarRansacEstimator | Class for planar RANSAC estimation on poincloud data (xyzh) |
Cicl::geom::PlaneEquation | Utility structure for calculation of view-ray / plane intersections |
Cicl::utils::PluginRegister< T >::Plugin | Internally used instance type: |
Cicl::filter::LUTOp3Channel< T >::Plugin | Internal plugin class for the LUTOp3Channel |
Cicl::utils::PluginRegister< T > | Utility class for plugin registration |
►Cicl::utils::Point32f | Single precission 3D Vectors Point class of the ICL |
Cicl::cv::RDPApproximation::ChainPoint | |
Cicl::geom::PointCloudCreator | Utility class that allows to create 3D (optionally colored) point clouds from given 2D core::depth images |
Cicl::geom::PointCloudCreatorCL | |
►Cicl::geom::PointCloudOutput | Generic interface for PointCloud sources |
Cicl::geom::GenericPointCloudOutput | Generic interface for PointCloud sources |
Cicl::geom::RSBPointCloudSender | RSB-based sendig of point cloud data |
Cicl::geom::PointCloudSerializer | Utility class used as intermediate layer for point cloud serialization |
Cicl::geom::OctreeObject< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE >::PointFilter | Internal most common fill-Filter to filter out single points |
Cicl::math::PolynomialRegression< T > | Generic Implementation of the Polynomial Regression algorithm |
Cicl::geom::PoseEstimator | Utility class for 6D PoseEstimation |
Cicl::geom::Posit | Implementation of the posit algorithm for 6D pose detection from a single camera |
Cicl::cv::PositionTracker< valueType > | Class for tracking 2D positions |
►Cicl::geom::Primitive | Abastract base type for geoemtric primitives |
Cicl::geom::GenericTexturePrimitive | Texture Primitive for rendering textures with arbitrary texture coordinates |
Cicl::geom::LinePrimitive | Line primitive (the line references 2 vertices) |
Cicl::geom::PolygonPrimitive | Polygon primitive |
Cicl::geom::QuadPrimitive | Quad primitive |
Cicl::geom::TextureGridPrimitive | Special texture Primitive for single textures spread over a regular grid of vertices |
Cicl::geom::TrianglePrimitive | Triangle primitive |
Cicl::geom::TwoSidedGridPrimitive | Grid primitive that renders a two-sided grid (sides have different colors) |
Cicl::geom::Primitive3DFilter::Primitive3D | Primitive |
Cicl::geom::Primitive3DFilter | Class for filtering point clouds according to a set of primitives and a filter configuration |
►CProgArgData | |
Cicl::utils::ProgArg | Programm argument utility class |
Cicl::math::Projective4PointTransform | Utility class that provides functions to perspectively map 4 points of a source frame into 4 points of a destination frame |
Cicl::utils::Configurable::Property | Represents a single property |
Cicl::qt::ProxyLayout | Just a helper class for GUI Layouting |
Cicl::core::PseudoColorConverter | Utility class for speudocolor conversion |
Cicl::io::pylon::PylonAutoEnv | Utility Structure |
Cicl::io::pylon::PylonColorConverter | This is the color-conversion-class for Pylon images |
Cicl::io::pylon::PylonGrabberBuffer< T > | Buffer, registered to the Pylon-drivers StreamGrabber |
Cicl::io::pylon::PylonGrabberBuffer< uint16_t > | |
►CQAbstractVideoSurface | |
Cicl::qt::ICLVideoSurface | |
►CQEvent | |
Cicl::qt::SliderUpdateEvent | Utility class for threaded updatable sliders |
Cicl::qt::ThreadedUpdatableTextView::AddTextEvent | |
Cicl::qt::ThreadedUpdatableTextView::ClearTextEvent | |
►CQGLWidget | |
►Cicl::qt::ICLWidget | Class for openGL-based image visualization components |
►Cicl::qt::ICLDrawWidget | Extended Image visualization widget, with a drawing state machine interface |
►Cicl::qt::ICLDrawWidget3D | Extended ICLDrawWidget, able to draw 2D and 3D primitives using OpenGL |
Cicl::geom::PlotWidget3D | |
►CQGroupBox | |
Cicl::qt::BorderBox | A simple utility class (QWidget with titled border) |
Cicl::qt::QImageConverter | Class for conversion between QImage and core::ImgBase/Img<T> |
►CQObject | |
Cicl::qt::ChromaGUI | Dedicated GUI component which can be used to adjust segmentation parameters |
Cicl::qt::ICLApplication | QApplication extension for ICL based applications |
►Cicl::qt::MouseHandler | MouseEvent Handler |
►Cicl::geom::SceneMouseHandler | Class providing a mouse handler for class scene |
Cicl::physics::PhysicsMouseHandler | This mousehandler can pick up object and move them around |
Cicl::physics::PhysicsPaper3MouseHandler | |
Cicl::qt::AdjustGridMouseHandler | Special MouseHandler Implementation that allows several quadrangular grids to be defined |
Cicl::qt::DefineQuadrangleMouseHandler | Special MouseHandler Implementation that allows for defining a quadrangle |
Cicl::qt::DefineRectanglesMouseHandler | Utility mouse handler implementation that allows to define rectangles via drag and drop |
Cicl::qt::DragRectangleMouseHandler | Special MouseHandler implementation that allows for dragging a Rectangle |
Cicl::qt::MultiDrawHandle | Handle class for image components |
►CQPushButton | |
Cicl::qt::StringSignalButton | Internally used button that emits a signal with its text |
Cicl::qt::ToggleButton | |
►CQSlider | |
Cicl::qt::ThreadedUpdatableSlider | Compability class |
►CQTextEdit | |
Cicl::qt::ThreadedUpdatableTextView | |
Cicl::math::QuadTree< Scalar, CAPACITY, SF, ALLOC_CHUNK_SIZE, VECTOR_TYPE > | Generic QuadTree Implementation |
Cicl::geom::Primitive3DFilter::Quaternion | Quaternion describing the orientation of the primitive |
►CQWidget | |
Cicl::qt::CamCfgWidget | Special QWidget implementation for configuring grabber properties |
Cicl::qt::DoubleSlider | A utiltiy class which implements a labeld, double valued QSlider |
Cicl::qt::GUIWidget | Abstract class for GUI components |
Cicl::qt::ImgParamWidget | Internally used widget to define image params |
►Cicl::qt::ThreadedUpdatableWidget | Compability class |
Cicl::qt::AbstractPlotWidget | The PlotWidget is an abstract base class for 2D plotting components |
Cicl::qt::ColorLabel | Utility class to avoid Qt warning when accesing QLabels from differnt Threads |
Cicl::qt::CompabilityLabel | Utility class to avoid Qt warning when accesing QLabels from differnt Threads |
Cicl::utils::RandomSeeder | Object based random seed caller |
►Cicl::utils::Range< Type > | Class representing a range defined by min and max value |
Cicl::utils::SteppingRange< Type > | Class representing a range with defined stepping |
Cicl::utils::Range< float > | |
Cicl::math::RansacFitter< DataPoint, Model > | Generic RANSAC (RAndom SAmpling Consensus) Implementation |
Cicl::geom::CoplanarPointPoseEstimator::RANSACSpec | Parameter struct that is used to specify optional RANSAC parameters for the internal pose estimation |
Cicl::cv::RDPApproximation | Ramer-Douglas-Peucker algorithm |
Cicl::io::icl_openni::ReadWriteBuffer< T > | This is used for concurrent writing and reading of Buffers |
Cicl::io::icl_openni::ReadWriteBuffer< icl::core::ImgBase > | |
Cicl::io::icl_openni::ReadWriteBufferHandler< T > | A BufferHandlers only task is to create T's |
►Cicl::io::icl_openni::ReadWriteBufferHandler< core::ImgBase > | |
►Cicl::io::icl_openni::OpenNIMapGenerator | Abstract super-class of all Image generators |
Cicl::io::icl_openni::OpenNIDepthGenerator | Depth Image Generator |
Cicl::io::icl_openni::OpenNIIRGenerator | IR Image Generator |
Cicl::io::icl_openni::OpenNIRgbGenerator | RGB Image Generator |
Cicl::io::icl_openni::ReadWriteBufferHandler< icl::core::ImgBase > | |
►Cicl::utils::Rect32f | Floating point precision implementation of the Rect class |
Cicl::markers::MarkerMetricsICL1::CR | Child region struct |
Cicl::cv::FloodFiller::ReferenceColorCriterion< T > | Predefined criterion for simple reference-value based filling for 3-channel images |
Cicl::cv::ImageRegionData::RegionGraphInfo | Structure for representing region-graph information |
Cicl::cv::RegionGrower | Class for region growing on images and DataSegments (e.g. poincloud xyzh) |
Cicl::cv::RegionGrower::RegionGrowerDataAccessor< T, DataT, DIM > | |
Cicl::cv::RegionGrower::RegionGrowerDataAccessor< core::DataSegment< float, 4 >, float, 4 > | |
Cicl::cv::RegionGrower::RegionGrowerDataAccessor< core::Img8u, icl8u, 1 > | |
Cicl::cv::RegionGrower::RegionGrowerDataAccessor< core::Img8u, icl8u, 3 > | |
Cicl::cv::RegionPCAInfo | Data-struct to represent local PCA information |
►Cicl::markers::RegionStructure | Region structure interface class |
Cicl::markers::TwoLevelRegionStructure | Defines a common two level RegionStructure |
Cicl::geom::RemainingPointsFeatureExtractor | Class for remaining points feature |
Cicl::geom::Primitive::RenderContext | Accumulated context information for rendering primitives |
Cicl::geom::Camera::RenderParams | |
Cicl::cv::opensurf::ResponseLayer | Response Layer class |
Cicl::math::PolynomialRegression< T >::Result | Result type |
Cicl::math::KMeans< Vector, Scalar >::Result | Restult type |
Cicl::cv::FloodFiller::Result | Result structure, returned by the 'apply' methods |
Cicl::cv::TemplateTracker::Result | Result class that describes a tracking result |
Cicl::geom::ICP::Result | Simple result structure |
Cicl::geom::ICP3D::Result | The Result struct contains results of an ICP-loop |
Cicl::math::RansacFitter< DataPoint, Model >::Result | Result structure |
Cicl::geom::PlanarRansacEstimator::Result | |
Cicl::math::LevenbergMarquardtFitter< Scalar >::Result | Utility structure, that represents a fitting result |
Cicl::core::LineSampler::Result | Result type providing a Point-pointer and number of sample points |
Cicl::geom::RansacBasedPoseEstimator::Result | |
Cicl::geom::RGBDMapping | Utility class for RGBDMapping |
Cicl::utils::TextTable::RowAssigner | Utility class that is used, to assign a table row at once |
►Cicl::io::RSBIOUtilDataBase< T > | |
►Cicl::io::RSBIOUtilDataExtra< T > | Tier 3: branding for using protocol-buffer types by default! |
Cicl::io::RSBIOUtil< T > | Simple and ready to use RSB-Informer and RSB-Listener Interface |
Cicl::io::RSBListener< T > | |
Cicl::io::RSBSender< T > | |
Cicl::cv::RunLengthEncoder | Simple class for creation of a run-length encoding of an image |
Cicl::physics::SceneMultiCamCapturer | |
►CSceneObject | |
Cicl::physics::ManipulatablePaper::DraggedPositionIndicator | |
Cicl::physics::ManipulatablePaper::LineAnnotation | Utility class for extra annotations, rendered in paper coordinates |
Cicl::physics::ManipulatablePaper::VertexAttractor | |
►Cicl::geom::SceneObject | Defines visible objects in scenes or scene graph nodes |
Cicl::geom::ComplexCoordinateFrameSceneObject | Special SceneObject implementation that define a visible coordinate frame |
Cicl::geom::CoordinateFrameSceneObject | Special SceneObject implementation that define a visible coordinate frame |
Cicl::geom::GridSceneObject | SceneObject specialization for grid like objects |
Cicl::geom::OctreeObject< Scalar, CAPACITY, SF, Pt, ALLOC_CHUNK_SIZE > | The OctreeObjects provides a visualizable SceneObject interface for the Octree class |
►Cicl::geom::PointCloudObjectBase | Base class for point cloud data types |
Cicl::geom::PCLPointCloudObject< PCLPointType > | PointCloudObject implementation for the PCLPointCloud types |
►Cicl::geom::PointCloudObject | Base implementation of the SceneObjectBase interface for compability with common icl::SceneObjects |
Cicl::geom::PointCloudSegment | PointCloudSegment class used to describe data segments in the scene |
Cicl::geom::SceneLightObject | The scene light object looks like a light bulb and represents an OpenGL light |
Cicl::physics::ManipulatablePaper::Shadow | |
►Cicl::physics::PhysicsObject | This class combines an physical object and it's graphical representation in ICL |
►Cicl::physics::RigidObject | This class combines a movable but rigid physics object and it's graphical representation in ICL |
Cicl::physics::RigidBoxObject | A Box that can with RigidObject features |
Cicl::physics::RigidCompoundObject | A Box that can with RigidObject features |
Cicl::physics::RigidConvexHullObject | ConvexHullObject witht he features of a RigidObject that can be created from a pointcloud |
Cicl::physics::RigidCylinderObject | Cylinder with the features of a RigidObject |
Cicl::physics::RigidSphereObject | Sphere with the features of a RigidObject |
Cicl::physics::SoftObject | This class combines a soft-body physics object and it's graphical representation in ICL |
Cicl::geom::OctreeObject< float, 16, 1, Vec, 1024 > | |
Cicl::geom::SceneObjectBase | Defines and abstract interface for visible entities in 3D scenes |
Cicl::geom::Segmentation3D | |
Cicl::geom::SegmenterUtils | Support class for segmentation algorithms |
Cicl::utils::SelectFunctor< R, A, B, C > | Empty utility template that can be used to select a special functor |
►Cicl::geom::PointCloudSerializer::SerializationDevice | |
Cicl::geom::PointCloudSerializer::DefaultSerializationDevice | Utilitty class used for |
Cicl::geom::ProtoBufSerializationDevice | |
Cicl::utils::ShallowCopyable< Impl, DelOp > | Interface class for cheap copyable classes using a smart ptr |
►Cicl::utils::ShallowCopyable< DCDeviceFeaturesImpl, DCDeviceFeaturesImplDelOp > | |
Cicl::io::DCDeviceFeatures | Utility class for handling DC-Device features |
►Cicl::utils::ShallowCopyable< FileImpl, FileImplDelOp > | |
Cicl::utils::File | Utility class for file handling (reading files is buffered) |
►Cicl::utils::ShallowCopyable< FileListImpl, FileListImplDelOp > | |
Cicl::io::FileList | Utility class implementing a list of files |
►Cicl::utils::ShallowCopyable< FilenameGeneratorImpl, FilenameGeneratorImplDelOp > | |
Cicl::io::FilenameGenerator | Utility class for generating a stream of filenames |
►Cicl::utils::ShallowCopyable< MultiThreaderImpl, MultiThreaderImplDelOp > | |
Cicl::utils::MultiThreader | Utility class for parallelizing algorithms |
►Cicl::utils::ShallowCopyable< SemaphoreImpl, SemaphoreImplDelOp > | |
Cicl::utils::Semaphore | Simple Semaphore implementation wrapping the standard linux "sem_t"-struct |
►Cicl::utils::ShallowCopyable< ThreadImpl, ThreadImplDelOp > | |
►Cicl::utils::Thread | Simple object oriented thread class wrapping the pthread library |
Cicl::io::dc::DCGrabberThread | Internally spawned thread class to provide continuous grabbing without drop frames |
Cicl::io::OpenNIGrabberThread | Internally spawned thread class for continuous grabbing. Only one instance needed |
Cicl::io::pylon::PylonGrabberThread | Internally spawned thread class for continuous grabbing |
Cicl::utils::ProcessMonitor | Grants access to processes memory and CPU usage |
Cicl::geom::SQFitter::shapeError | Structure, that contains the error function for the shape parameters |
Cicl::io::SharedMemorySegment | Implementation of a cross-process shared memory |
Cicl::io::SharedMemorySegmentLocker | Easy way to lock a SharedMemorySegment, unlocking at destruction |
Cicl::io::SharedMemorySegmentRegister | This is used to register all created SharedMemorySegments |
Cicl::utils::SignalHandler | C++ Signal-Handler interface class |
Cicl::cv::ImageRegionData::SimpleInformation | |
Cicl::math::SimplexOptimizationResult< T, Vector > | Utility structure, that is used as accumulator for results of the SimplexOptimizer class |
Cicl::utils::Size32f | Size32f class of the ICL (float valued) |
Cicl::utils::SmartPtrBase< T, delOp > | Base class for reference counting smart-pointers |
►Cicl::utils::SmartPtrBase< bool, PointerDelOp > | |
Cicl::utils::SmartPtr< bool > | |
Cicl::utils::SmartPtrBase< CvMat, icl::core::CvMatDelOp > | |
►Cicl::utils::SmartPtrBase< DataMap, PointerDelOp > | |
Cicl::utils::SmartPtr< DataMap > | |
Cicl::utils::SmartPtrBase< DCDeviceFeaturesImpl, DCDeviceFeaturesImplDelOp > | |
Cicl::utils::SmartPtrBase< FileImpl, FileImplDelOp > | |
Cicl::utils::SmartPtrBase< FileListImpl, FileListImplDelOp > | |
Cicl::utils::SmartPtrBase< FilenameGeneratorImpl, FilenameGeneratorImplDelOp > | |
►Cicl::utils::SmartPtrBase< float, PointerDelOp > | |
Cicl::utils::SmartPtr< float > | |
►Cicl::utils::SmartPtrBase< GLCallback, PointerDelOp > | |
Cicl::utils::SmartPtr< GLCallback > | |
►Cicl::utils::SmartPtrBase< icl32f, ArrayDelOp > | |
Cicl::utils::SmartArray< icl32f > | |
►Cicl::utils::SmartPtrBase< icl8u, ArrayDelOp > | |
Cicl::utils::SmartArray< icl8u > | |
►Cicl::utils::SmartPtrBase< icl::geom::Primitive3DFilter::FilterAction, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::geom::Primitive3DFilter::FilterAction > | |
►Cicl::utils::SmartPtrBase< icl::geom::SceneLight, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::geom::SceneLight > | |
►Cicl::utils::SmartPtrBase< icl::geom::SceneMouseHandler, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::geom::SceneMouseHandler > | |
►Cicl::utils::SmartPtrBase< icl::geom::SceneObject, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::geom::SceneObject > | |
►Cicl::utils::SmartPtrBase< icl::io::GenericImageOutput, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::io::GenericImageOutput > | |
►Cicl::utils::SmartPtrBase< icl::io::ImageOutput, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::io::ImageOutput > | |
►Cicl::utils::SmartPtrBase< icl::io::RSBIOUtil< T >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::io::RSBIOUtil< T > > | |
►Cicl::utils::SmartPtrBase< icl::math::DynMatrix< double >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::math::DynMatrix< double > > | |
►Cicl::utils::SmartPtrBase< icl::math::DynMatrix< T >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::math::DynMatrix< T > > | |
►Cicl::utils::SmartPtrBase< icl::math::FixedColVector, ArrayDelOp > | |
Cicl::utils::SmartArray< icl::math::FixedColVector > | |
►Cicl::utils::SmartPtrBase< icl::math::FixedColVector, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::math::FixedColVector > | |
►Cicl::utils::SmartPtrBase< icl::physics::ManipulatablePaper::Shadow, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::physics::ManipulatablePaper::Shadow > | |
►Cicl::utils::SmartPtrBase< icl::qt::GLImg, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::qt::GLImg > | |
►Cicl::utils::SmartPtrBase< icl::qt::MouseHandler, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::qt::MouseHandler > | |
►Cicl::utils::SmartPtrBase< icl::utils::ConfigFile::KeyRestriction, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::ConfigFile::KeyRestriction > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< icl64f, const Model &, const DataPoint &, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< icl64f, const Model &, const DataPoint &, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< Matrix, const Params &, const Matrix &, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< Matrix, const Params &, const Matrix &, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< Model, const DataSet &, NO_ARG, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< Model, const DataSet &, NO_ARG, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< R, A, B, C >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< R, A, B, C > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< T *, const Data &, NO_ARG, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< T *, const Data &, NO_ARG, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< Vector, const Params &, const Vector &, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< Vector, const Params &, const Vector &, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, const DataPoint &, T *, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, const DataPoint &, T *, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, const Result &, NO_ARG, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, const Result &, NO_ARG, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, const std::string &, NO_ARG, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, const std::string &, NO_ARG, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, const utils::Point32f &, double *, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, const utils::Point32f &, double *, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, icl::physics::PhysicsObject *, icl::physics::PhysicsObject *, icl::math::FixedColVector >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, icl::physics::PhysicsObject *, icl::physics::PhysicsObject *, icl::math::FixedColVector > > | |
►Cicl::utils::SmartPtrBase< icl::utils::FunctionImpl< void, NO_ARG, NO_ARG, NO_ARG >, PointerDelOp > | |
Cicl::utils::SmartPtr< icl::utils::FunctionImpl< void, NO_ARG, NO_ARG, NO_ARG > > | |
►Cicl::utils::SmartPtrBase< ICL_QUICK_TYPE, ArrayDelOp > | |
Cicl::utils::SmartArray< ICL_QUICK_TYPE > | |
Cicl::utils::SmartPtrBase< Impl, DelOp > | |
►Cicl::utils::SmartPtrBase< int, ArrayDelOp > | |
Cicl::utils::SmartArray< int > | |
►Cicl::utils::SmartPtrBase< Marker, ArrayDelOp > | |
Cicl::utils::SmartArray< Marker > | |
Cicl::utils::SmartPtrBase< MultiThreaderImpl, MultiThreaderImplDelOp > | |
►Cicl::utils::SmartPtrBase< Mutex, PointerDelOp > | |
Cicl::utils::SmartPtr< Mutex > | |
►Cicl::utils::SmartPtrBase< Node, PointerDelOp > | |
Cicl::utils::SmartPtr< Node > | |
Cicl::utils::SmartPtrBase< pugi::xml_document, XMLDocumentDelOp > | |
Cicl::utils::SmartPtrBase< SemaphoreImpl, SemaphoreImplDelOp > | |
►Cicl::utils::SmartPtrBase< T, ArrayDelOp > | |
Cicl::utils::SmartArray< T > | Specialization of the SmartPtrBase class for Arrays |
►Cicl::utils::SmartPtrBase< T, PointerDelOp > | |
Cicl::utils::SmartPtr< T > | Specialization of the SmartPtrBase class for Pointers |
Cicl::utils::SmartPtrBase< ThreadImpl, ThreadImplDelOp > | |
►Cicl::utils::SmartPtrBase< Type, ArrayDelOp > | |
Cicl::utils::SmartArray< Type > | |
►Cicl::utils::SmartPtrBase< utils::Range32f, ArrayDelOp > | |
Cicl::utils::SmartArray< utils::Range32f > | |
Cicl::geom::SoftPosit | |
►Cicl::math::SOM | Generic implementation of D to K dim Self Organizing Map (SOM) |
Cicl::math::SOM2D | Simple Wrapper class of the generic SOM Implementation for 2D SOMs |
Cicl::geom::SQFitter | |
Cicl::geom::SQParams | Utility structure, that represents a superquadric |
Cicl::utils::StackTimer | Tool for benchmarking method calls |
Cicl::utils::StackTimer::StackTimerNotifier | StackTimerNotifier constructor, USE BENCHMARK_THIS_FUNCTION-MACRO instead |
Cicl::core::AbstractCanvas::State | |
Cicl::math::StochasticOptimizer< T > | The StochasticOptimizer is a tiny frame-work for simple stochastic optimization processes |
Cicl::math::StochasticOptimizerResult< T > | Utility structure for the stochastic optimizer class |
Cicl::core::PseudoColorConverter::Stop | This is for creation of color gradients |
Cicl::math::StraightLine2D | A straight line is parameterized in offset/direction form |
Cicl::utils::StrTok | String Tokenizer Utility class |
Cicl::physics::PhysicsPaper3::Structure | |
Cicl::cv::clsurf::Surf | OpenCL-based Surf Feature detector implmentation (by AMD) |
Cicl::cv::opensurf::Surf | Surf Feation class |
Cicl::geom::SurfaceFeatureExtractor::SurfaceFeature | |
Cicl::geom::SurfaceFeatureExtractor | Class for extraction of surface features |
Cicl::cv::SurfFeature | Generic SURF Feature type |
Cicl::cv::SurfFeatureDetector | ICL's New Generic Surf Feature detection class |
Cicl::filter::TemporalSmoothingCL | |
Cicl::io::TestImages | Utility class for creating test images |
Cicl::utils::VisualizationDescription::Text | Utility class for Text |
Cicl::utils::TextTable | Utility class for pretty console output |
Cicl::markers::TiltedQuad | Utility class that represents a tilted quad in an image |
Cicl::utils::Time | ICL Time class (taken from the Ice lib) |
Cicl::utils::Timer | |
Cicl::physics::TriangleIntersectionEstimator::Triangle | |
Cicl::physics::TriangleIntersectionEstimator | |
Cicl::io::pylon::TsBuffer< T > | A buffer holding image information and timestamp |
Cicl::cv::RegionGrower::U8EuclideanDistance | |
►Cicl::utils::Uncopyable | Class interface for un-copyable classes |
Cicl::core::AbstractCanvas | |
Cicl::core::BayerConverter | Utiltity class for bayer pattern conversion |
Cicl::core::Converter | General Image Converter |
Cicl::core::CvMatWrapper< T > | Utility class that wraps around a CvMat of type CV_32FC1 |
Cicl::core::FixedConverter | Special converter "producing" images with fixed parameters |
Cicl::core::ImageRenderer | |
Cicl::core::ImgBuffer | Singelton class that provides access to reusable temporary images |
Cicl::cv::CheckerboardDetector | Utility class wrapping OpenCV's cvFindChessboardCorners |
Cicl::cv::ContourDetector | The ContourDetector extracts all contours of a given image |
Cicl::cv::CornerDetectorCSS | Curvature Corner Detector |
Cicl::cv::CurvatureExtractor | The RegionCurvature class |
Cicl::cv::HeartrateDetector | Heartrate Detector |
Cicl::cv::LensUndistortionCalibrator | Utility class for estimation of compensation parameters of lens-distortion |
Cicl::cv::OpenCVCamCalib | Cameracalibration using OpenCV functions |
Cicl::cv::ORBFeatureDetector::FeatureSetClass | |
Cicl::cv::RegionDetector | Complex utility class for detection of connected image components |
Cicl::cv::SimpleBlobSearcher | Utility class for region-based colored blob detection |
Cicl::cv::TemplateTracker | Utility class vor viewbased template tracking |
Cicl::filter::AffineOp | Class to apply an arbitrary series of affine transformations \ |
Cicl::filter::BilateralFilterOp | BilateralFilterICL class Gaussian bilateral filtering Implements the gaussian bilateral filtering like described in "A Fast Approximation of the Bilateral Filter using a Signal Processing Approach" (http://people.csail.mit.edu/sparis/publi/2006/tr/Paris_06_Fast_Bilateral_Filter_MIT_TR_low-res.pdf) on the GPU using OpenCL (no CPU-backend at the moment) |
Cicl::filter::CannyOp | Class for the canny edge detector |
Cicl::filter::ConvolutionOp | Class for Image convolutions |
Cicl::filter::DitheringOp | Class that implements dithering mechanisms |
Cicl::filter::GaborOp | Applies Gabor filter operation on images |
Cicl::filter::LocalThresholdOp | LocalThreshold Filter class |
Cicl::filter::LUTOp | Class for applying table lookup transformation to Img8u images |
Cicl::filter::LUTOp3Channel< T > | Class for applying table look-up transformation to 3-channel integer-valued images |
Cicl::filter::MirrorOp | Class to mirror images vertically or horizontally \ |
Cicl::filter::MorphologicalOp | Class for Morphological operations \ |
Cicl::filter::MotionSensitiveTemporalSmoothing | |
Cicl::filter::ProximityOp | Class for computing proximity measures |
Cicl::geom::GenericPointCloudOutput | Generic interface for PointCloud sources |
Cicl::geom::ICP | Implementaiton of the Iterator Closest utils::Point (ICP) Algorithm |
Cicl::geom::ICP3D | Special ICP-case for homogeneous 3D-vectors |
Cicl::geom::PointCloudNormalEstimator | |
Cicl::geom::RSBPointCloudSender | RSB-based sendig of point cloud data |
Cicl::geom::SceneLight | Wrapper class for OpenGL lights |
Cicl::geom::ShaderUtil | |
Cicl::InverseUndistortionProcessor | Utility class that performs gradient-descent based inverse undistortion mapping |
Cicl::io::ConfigurableRemoteServer | |
Cicl::io::GenericGrabber | Common interface class for all grabbers |
Cicl::io::Grabber | Common interface class for all grabbers |
Cicl::io::icl_openni::OpenNIContext | A Context object encapsulating the OpenNI-Context-object |
►Cicl::io::ImageCompressor | Encoder class for optimized encoding of images |
►Cicl::io::ImageOutput | Minimal interface for image output classes |
Cicl::io::FileWriter | File Writer implementation writing images to the hard disc |
Cicl::io::GenericImageOutput | Generic Sink for images |
Cicl::io::LibAVVideoWriter | |
Cicl::io::OpenCVVideoWriter | |
Cicl::io::RSBImageOutput | Image output implementation using the "Robotics Service Bus (RSB)" |
Cicl::io::SharedMemoryPublisher | Publisher, that can be used to publish images via SharedMemorySegment |
Cicl::io::V4L2LoopBackOutput | ImageOutput implementation for V4L2-Looback devices |
Cicl::io::ZmqImageOutput | Image output implementation using the ZeroMQ (ZMQ) framwork |
Cicl::io::IntrinsicCalibrator | |
Cicl::io::JPEGEncoder | Encoding class for data-to-data jpeg compression |
Cicl::io::RSBIOUtil< T > | Simple and ready to use RSB-Informer and RSB-Listener Interface |
Cicl::markers::BCHCoder | Main class for BCH encoding/decoding |
Cicl::markers::FiducialDetector | Main Fiducial Detector class |
Cicl::markers::QuadDetector | Tool-class for detecting tilted quads in images |
Cicl::math::KDTree | Simple KD-Tree implementation |
Cicl::math::SimplexOptimizer< T, Vector > | Template based implementation for the Downhill Simplex Optimiztation method |
►Cicl::physics::Constraint | Base Class for constraints |
Cicl::physics::Object2PointConstraint | This constraint binds an object to a point with a spring |
►Cicl::physics::SixDOFConstraint | This is a generic constraint that allows to free configuration of the limits on all 6 degrees of freedom |
Cicl::physics::BallSocketConstraint | This constraint simulates a ballsocket joint |
►Cicl::physics::SliderConstraint | This constraint simulates a Slider joint |
Cicl::physics::HingeConstraint | This constraint simulates a Hinge joint |
Cicl::physics::MotionState | This class is a MotionState for updating SceneObjects to match the PhysicsObject state |
Cicl::physics::PhysicsObject | This class combines an physical object and it's graphical representation in ICL |
Cicl::physics::PhysicsPaper3ContextMenu | |
Cicl::physics::PhysicsWorld | A physical world that handles physical objects |
Cicl::qt::AdjustGridMouseHandler | Special MouseHandler Implementation that allows several quadrangular grids to be defined |
Cicl::qt::DefineQuadrangleMouseHandler | Special MouseHandler Implementation that allows for defining a quadrangle |
Cicl::qt::DynamicGUI | Special GUI implementation that allows for defining the GUI layout in an XML-file |
Cicl::qt::GLFragmentShader | Simple wrapper class for OpenGL 2.0 Fragment Shader Programs |
Cicl::qt::GLImg | OpenGL Texture Map Image class |
Cicl::qt::GUIWidget | Abstract class for GUI components |
Cicl::qt::RSBRemoteGUI | Creates an RSB-interface to externally get and set parameters of the wrapped GUI |
Cicl::utils::IppInterface | |
►Cicl::utils::Mutex | Mutex class of the ICL |
Cicl::utils::UncopiedInstance< icl::utils::Mutex > | |
Cicl::utils::Mutex::Locker | Locks a mutex on the stack (mutex is unlocked when the stack's section is released |
Cicl::utils::ProcessMonitor | Grants access to processes memory and CPU usage |
Cicl::utils::URand | Lightweight Random generator class for uniform random distributions |
Cicl::utils::URandI | Lightweight Random generator class for uniform random distributions in positive integer domain |
Cicl::geom::Vec8 | |
►Cstd::vector< T > | STL class |
Cicl::cv::LensUndistortionCalibrator::GridDefinition | Utility data class describing the grid structure that is used |
Cicl::qt::PlotWidget::SeriesBuffer | Utility structure for easier series plots |
Cicl::cv::VectorTracker | Extension of the position tracker class for N-dimensional positions |
Cicl::cv::ViewBasedTemplateMatcher | TemplateMatching class (wrapping UsefulFunctions::matchTemplate) |
Cicl::geom::ViewRay | This is a view-ray's line equation in parameter form |
Cicl::utils::VisualizationDescription | Abstract class for visualization tasks |
►Cicl::utils::MultiThreader::Work | Plugin class for work packages performed parallel |
Cicl::filter::UnaryOpWork | Internally used Plugin class for multithreaded unary operations |
►CT | |
Cicl::utils::UncopiedInstance< T > | Utility class for class instances that are created brand new on copy |