Basic Image AlgorithmS Library  2.8.0
 All Classes Namespaces Functions Variables Typedefs Enumerations Enumerator Friends Groups Pages
Classes | Typedefs | Enumerations | Functions | Variables
BIAS Namespace Reference

This file is part of the BIAS library (Basic ImageAlgorithmS). More...

Classes

class  AbsoluteOrientation
 Computes similarity transformation between 3D point sets. More...
 
class  AbsoluteOrientationRANSAC
 Robust computation of similarity transformation between two 3D point sets using a RANSAC approach. More...
 
class  AffineMapping
 Maps image src to image sink with affine transformation. More...
 
class  AffineTransf
 last line of an affine transformation in 3d space is always 0 0 0 1 and can therefor be droped from this class for this reason it is necessairy to overload certain operators and functions e.g. More...
 
struct  AnimationManagerFinder
 
class  AppData
 this is a chunk of metadata, also see MetaData More...
 
class  Array2D
 generic two dimensional rectangular array holding arbitrary data types More...
 
class  AutoControl
 class for camera movement in autopilot mode. More...
 
class  BackwardMapping
 Abstract base class to map an image (texture) src to an image sink with an arbitrary continuous function (e.g. More...
 
class  BaseException
 generic exception More...
 
class  BaseFactory
 simple factory class designed for usage as a singleton More...
 
struct  BIASBlob
 Helper class to store blob corners. More...
 
class  BIASContour
 This class describes a contour using the freemancode. More...
 
class  biasGLviewerGLUT
 
class  Bilateral
 2D bilateral filter More...
 
class  Binomial
 binomial low pass filter class More...
 
class  BinomialCoefficient
 Efficient computation of the binomial coefficient. More...
 
class  BlobDetectorBase
 purly virtual interface defining class for blob detectors More...
 
class  BlobDetectorBFS
 Detects multiple blobs in an image, image has to be black except blocks to detect. More...
 
class  BlobDetectorCCA
 Does a Connected Component Analyis and gives information about regions in an image, like centroid and bounding boxes. More...
 
class  BlobDetectorDOM
 Blob detector for 'Difference Of Means'-blobs (so this is not a binary blob detector). More...
 
class  BlobDetectorLevelSet
 Evaluates a segementation into fore/back-ground. More...
 
class  Bresenham
 Scans a line using Bresenhams integer arithmetic algorithm. More...
 
class  BresenhamCircle
 Scans a circle using Bresenham's integer arithmetic algorithm. More...
 
class  BresenhamCircleEighth
 Just like BresenhamCircle but only computes 1/8 of the circle. More...
 
class  BSplineCurve
 this class is intended for drawing of quadratic and cubic regular B-Splines from given control points. More...
 
class  BVWXApp
 
class  BVWXDnDTarget
 drag and drop files onto application. More...
 
class  BVWXMainFrame
 
class  BWM_LUT_Entry_Anisotropic
 base class for storing precomputed lookup information for anisotropic interpolation in BackwardMapping More...
 
class  BWM_LUT_Entry_Bicubic
 base class for storing precomputed lookup information for bicubic interpolation in BackwardMapping More...
 
class  BWM_LUT_Entry_Bilinear
 base class for storing precomputed lookup information for bilinear interpolation in BackwardMapping More...
 
class  BWM_LUT_Entry_Nearest
 base class for storing precomputed look-up information in BackwardMapping More...
 
class  BWM_LUT_Entry_Trilinear
 base class for storing precomputed lookup information for trilinear interpolation in BackwardMapping More...
 
class  CalibratedImage
 helper class holding image and associated calibration More...
 
class  CalibratedPyramid
 This class takes care of consisiten re-sampling of images and associated ProjectionParameters. More...
 
class  Camera
 extends the Image by MetaData support (e.g. More...
 
struct  CameraData
 
struct  CameraInfo_s
 Stores camera information such as model, vendor, framerates. More...
 
class  CameraParam
 
struct  CameraParameter_s
 Stores the camera parameters such as Shutter, Gain, etc. More...
 
class  CameraViewController
 base for (interactively) manipulating a (virtual) camera view. More...
 
class  CameraViewExternals
 describes external params of a camera view Used e.g. More...
 
class  CameraViewFrustum
 describes internal parameter Frustum of an (OpenGL) camera view More...
 
class  CameraViewInternals
 describes internal params of an (OpenGL) camera view More...
 
class  CameraViewport
 describes internal parameter viewport of an (OpenGL) camera view More...
 
class  CamPoseCalib
 this classs allows estimation of the internal (except skew) and external camera parameters by an iterative non-linear algorithm from given 2D-3D correspondences More...
 
class  CanCompare
 compile time check for comparabilty of T1 and T2 Found it in Bjarne Stroustrup's FAQ: http://public.research.att.com/~bs/bs_faq2.html More...
 
class  CanCopy
 compile time check for copy compatibilty between T1 and T2 Found it in Bjarne Stroustrup's FAQ: http://public.research.att.com/~bs/bs_faq2.html More...
 
class  CanMultiply
 compile time check if T1 can be multiplied by T2 Found it in Bjarne Stroustrup's FAQ: http://public.research.att.com/~bs/bs_faq2.html More...
 
class  CannyEdge
 Canny edge detector. More...
 
class  CCAStruct
 
class  CensusTransform
 3x3 Census Transform of greyscale image More...
 
class  CheckerboardDetector
 Detects a checkerboard pattern in an image (typically 7x4 inner corners, asymmetric layout recommended). More...
 
class  CheckerboardDetectorCrossFilter
 Detects a checkerboard pattern (typically 7x4 inner corners, asymmetric layout recommended) in an image using a cross shaped image filter. More...
 
class  Checksum
 Utility class to calculate checksums as CRCs (Cyclic Redundancy Check). More...
 
class  CheckUtils
 
class  Cholesky
 Calculates the Cholesky decomposition of a matrix with TNT function. More...
 
class  clfAlgorithm
 
class  clfBuffer
 OpenCL Buffer wrapper. More...
 
class  clfColorConversion
 
class  clfContext
 OpenCL Context wrapper. More...
 
class  clfCopy
 
class  clfException
 clf Exception wrapper, is thrown in case of most clf errors More...
 
class  clfExtractLocalMaxima
 
class  clfFilter
 
class  clfGauss
 
class  clfGradient3x3
 
class  clfGradientGauss
 
class  clfImage2D
 OpenCL Image2D wrapper. More...
 
class  clfImage3D
 OpenCL Image3D wrapper. More...
 
class  clfImageOperator
 
class  clfKernelSources
 
class  clfMemory
 
class  clfProgram
 OpenCL Program wrapper. More...
 
class  clfRadixSort
 
class  clfRecursiveGauss
 recursive approximation of gaussian blur (IIR) opencl implementation of deriche, recursively implementing the gaussian and its derivatives (icip, 1992) More...
 
class  clfResampleImage
 
class  clfScaleImage
 
class  clfSimpleFilter
 
class  clfStructureTensor
 
class  clfTrimmedICP
 
class  clfTVL1Flow
 TVL1 optical flow opencl implementation. More...
 
class  clfUnifiedMultilateralFilter
 
class  ColFeat
 internal class for feature (with color) passing only More...
 
class  ColorHarris
 Detects Harris Features on color images. More...
 
class  ColorHistogram
 This Class handels Histogram matters on Images. More...
 
class  ColorMultiHistogram
 This Class handels MultiHistogram matters on Images. More...
 
class  ColorSegmentation
 
class  ColorSegmentationThreaded
 Threaded implementation of ColorSegmentation. More...
 
class  ColourGradient
 Represents a colour gradient. More...
 
class  ColourMap
 Applies a colour map to an image. More...
 
class  ColourRGB
 interface class used to ease handover in function calls More...
 
class  Condensation
 CONDENSATION (CONditional DENSity EstimATION) is a state estimator very similiar to the Kalman Filter, not only for Gaussian-, but also for any multi-modal distribution. More...
 
class  CondensHisto
 class for tracking an object in an image More...
 
class  CondensImg
 example class for condensation with a 2-dim state vector. More...
 
class  Conic2D
 A 3x3 matrix representing a conic (cone/plane intersection) More...
 
class  ConsoleProgress
 Visualises the progress of some computation in the console. More...
 
class  ConstantRegionDetector
 detects regions with close to zero gradients in images, works on color images only More...
 
class  ContextGLUT
 Wrapper to glut-library. More...
 
class  ContextPBuffer
 Wrapping class implementation for PBuffer class. More...
 
class  ContextWX
 Context implementation for wxWidgets. More...
 
class  ContourBSplineData
 data object which holds all infomations of a B-Spline curve (ContourBSpline); its shared by B-Spline curves with same basis. More...
 
class  ContourBSplineShapeMatrix
 data object which holds a shape matrix or regularisation matrix for a b-spline curve; could be shared by some ContourBSpline objects More...
 
class  ContourBSplineType
 
class  ContourDetectorBase
 purely virtual interface defining class for contour detectors More...
 
class  ContourDetectorBSpline
 represents a special B-Spline and holds functions to handle fitting More...
 
class  ContourDetectorSimple
 a class for calculating the contour of a segmented region More...
 
class  ControlInterface
 Defines the common interface used for communication between rendering components. More...
 
class  ConvertBayerPattern
 Wrapper class to dc1394 bayer conversion class. More...
 
class  ConvertHDR
 This class handles conversions of HDR images to for example unsigned char. More...
 
class  Convolution
 generic convolution class. More...
 
class  CoordinateTransform3D
 Transforms 3d points between two different coodinate systems, e.g. More...
 
class  CornerDetectorBase
 purly virtual interface defining class for corner detectors More...
 
class  CornerDetectorFoerstner
 foerstner corner detector, detects grey value corners in images More...
 
class  CornerDetectorGradient
 base class for all gradient based corner detectors More...
 
class  CornerDetectorHarris
 Harris corner detector, detects grey value corners in images. More...
 
class  CornerDetectorKLT
 Computes the cornerness as the smaller eigenvalue of the structure tensor matrix. More...
 
class  CornerDetectorSusan
 The Susan corner detector (oxford implementation, see license) More...
 
class  CornerMatcher
 class with various functions to detect corresponding image points. More...
 
class  cornerstruct
 used only by Susan corner detector More...
 
class  CorrespondenceMap
 holds dense 2d correspondences (flow field) for an image More...
 
class  COSAC
 Complete Sampling Consesus. More...
 
class  Cov3Dto2DPoseCertain
 project a 3D covariance matrix into the image plane using the unscented transform assuming that the pose is certain More...
 
class  Covariance3Dto2D
 Projection of 3D points with uncertainties covariances into the 2d image plane taking the camera pose uncertainty into account. More...
 
class  Covariance3Dto2DHomg
 Projection of 3D points with uncertainties covariances into the 2d image plane taking the camera pose uncertainty into account. More...
 
class  CovEuler2Quaternion
 Conversion of a rotation covariance in Euler-angles representation to a covariance in Quaternion representation using the unscented transform. More...
 
class  CovMatrix3x3
 class for 3x3 covariance matrices More...
 
class  CovQuaternion2AxisAngle
 Conversion of a rotation covariance in quaternion representation to a covariance in axis-angle representation using the unscented transform. More...
 
class  CovTransformPose
 Transformations between different representations of poses and their covariances (e.g. More...
 
struct  CPDiscreteParam
 
class  CScommBase
 this class CScomm (ClientServer communciation) handles data comunication via TCP/IP for one server and multiple clients. More...
 
class  CScommClient
 class for sending/receiving data between clients and servers More...
 
class  CScommData
 helper class for CScommBase More...
 
class  CScommMsg
 helper class for CScommBase More...
 
class  CScommServer
 class for sending/receiving data between clients and serversOnly registered msgs will be accepted at the server side, similar the client will accept only registered msgs from the server too. More...
 
class  CSCommWithClientNr
 helper class for CScommBase More...
 
class  CylinderMapping
 functions for spherical undistortion of given images, needs image dimensions, principal point and focal length as input additional to the image data. More...
 
class  CylindricalRectification
 Class implements rectification by image projection onto a cylinder. More...
 
class  CylindricDepthPanorama
 create and represent cylindric depth panorama More...
 
class  CylindricDepthTrackingPanorama
 
class  DataPlot
 Class to plot data as lines, crosses etc, as gnuplot does, duplicates functionality in class GraphPlotter. More...
 
class  DC_GPS
 
class  DC_inertial
 
class  DC_ptu
 
class  Debug
 
class  DeInterlace
 Deinterlacer filter for images. More...
 
class  DensityFilter
 Removes areas from an image that have a low density (fill rate). More...
 
class  DerivedFrom
 compile time check if B is (grand)father of T Found it in Bjarne Stroustrup's FAQ: http://public.research.att.com/~bs/bs_faq2.html "Actually, Derived_from doesn't check derivation, but conversion, but that's often a better constaint. More...
 
class  Dilation
 Dilation operator for binary images (black and white) More...
 
class  DisparityInterpolator
 
class  DisplacementMapping
 Maps image src to image sink with displacement mapl generated by backwardmapping method. More...
 
class  DistanceMeasureControl
 class for distance measurements in 3d model, derives from TrackballControl and SceneBase More...
 
class  DistImgMatAcc
 
class  DistortionRendering
 Utility class for distortion rendering used by GLProjection. More...
 
class  Distribution
 class for calculating mean, variance and possibly other parameters More...
 
class  DistTransform
 Class for calculating the distance transform. More...
 
class  dndFileTarget
 drag and drop files onto application. More...
 
class  DPPanTiltControl
 Basic controller interface for Directed Perception Pan Tilt Unit. More...
 
class  DPPanTiltControlDialog
 
class  DPPanTiltControlExtended
 Extended controller interface for Directed Perception Pan Tilt Unit. More...
 
class  DrawTextGL
 Draw text to OpenGL as 2D bitmap font. More...
 
class  DrawTextWx
 Writing a text in an bias image usig a wx device context This class uses wxDC and thus it can only be used in wx GUI applications. More...
 
class  DShowVideo
 Die Klasse ReadAvi ist zentraler Bestandteil der Infrastruktur zum Dekodieren von AVI-Videocontainern. Weitere Bestandteile sind: SampleGrabberCallback. More...
 
class  DualQuaternion
 class representing rigid motion by dual quaternions More...
 
struct  Edge_s
 Struct for easier handling of edges. More...
 
class  EightWaySymmetry
 class for transforming any point to first octant More...
 
class  EightWaySymmetryHomg
 direction of line if start is in coordinate origin as given by compass More...
 
class  Ellipse
 Ellipse in 2D with dfifferent representations. More...
 
class  Ellipsoid3DData
 stores important data for drawing an el4000lipsoid More...
 
class  EMatrix
 class representing an Essential matrix More...
 
class  EParametrization
 Slim class bundling essential matrix parameterization and associated covariance matrix. More...
 
class  EpipolarLine
 A class for representing epipolar lines with useful functions like ScanLine(). More...
 
class  Erosion
 Erosion operator for binary images (black and white) More...
 
class  EssentialPoint2Line
 computes line and associated covariance matrix given by a point and an essential matrix using unscented transform More...
 
class  EuclideanTransf3D
 Euclidean transformation for 3D points. More...
 
class  ExampleMixtureOfGaussians
 
class  ExampleMixtureOfGaussiansFrame
 
class  ExifTag
 helper class containing EXIF Tag info and its's value. More...
 
class  ExtendedKalman
 Classical ExtendedKalman-filter (EKF). More...
 
class  FatalException
 fatal exception More...
 
class  FFT
 Wrapper to the fftw3 library. More...
 
class  FFT2D
 Wrapper to the fftw3 library adapted for 2D image filtering. More...
 
class  FFT2D_free
 Wrapper to the fftpack library from netlib (see fftpack/fft.c), implementing the fft (Fast Fourier Transform) for images. More...
 
class  FFT2D_Tiles
 Wrapper to the fftw3 library, which is supposed to perform the FFT patch- (tile-) wise. More...
 
class  FiFoQueue
 This class implements a templated standard FiFo-queue for inter process communication (arbitrary number of readers/writers), e.g. More...
 
class  FileHandling
 Functions to create, check and delete files and to handle file names, such as splitting into directory, filename and suffix. More...
 
class  FilterBase
 virtual parent class for API definition of all (future) filters More...
 
class  FilterDialogBase
 Base class for all filter dialogs. More...
 
class  FilterDialogCannyEdge
 Implementation of a CannyEdge filter dialog. More...
 
class  FilterDialogGauss
 Implementation of a Gauss filter dialog. More...
 
class  FilterDialogGradientSobel3x3
 Implementation of a GradientSobel3x3 filter dialog. More...
 
class  FilterDialogMean
 Implementation of a Mean filter dialog. More...
 
class  FilterDialogMedian
 Implementation of a Median filter dialog. More...
 
class  FilterDialogPreviewWindow
 A preview window. More...
 
class  FilterDialogRescale
 Implementation of a Rescale filter dialog. More...
 
class  FilterMask
 A filter mask (or a kernel) used for convolution. More...
 
class  FilterNTo2N
 base class for simple n->2n filter implementations More...
 
class  FilterNTo2NFactory
 Creates N-to-2N filters by class name. More...
 
class  FilterNTo3N
 base class for simple n->3n filter implementations More...
 
class  FilterNTo3NFactory
 Creates N-to-3N filters by class name. More...
 
class  FilterNToN
 base class for simple n->n filter implementations More...
 
class  FilterNToNFactory
 Creates N-to-N filters by class name. More...
 
class  FilterTestPair
 struct holding ground truth data for filter testing\ More...
 
class  FitCircleFrame
 
class  FlirThermalCameraSerialControl
 this class is used for serial communication with the FLIR Tau 320 Thermal camera More...
 
class  FlyControl
 class for camera movement in fly mode. More...
 
class  FMatrix
 class representing a Fundamental matrix More...
 
class  FMatrixBase
 describes the epipolar relationship between a point and his mapping on a corresponding epipolar line. More...
 
class  FMatrixEstimation
 functions for estimating a fundamental matrix (FMatrix) given a set of 2d-2d correspondences (no outlier checks, not robust !) in two views More...
 
class  ForwardMappingNearestNeighbour
 
class  FramebufferSetup
 
class  FramebufferSetupPool
 Class containing a framebuffer and a map of setups. More...
 
class  Gauss
 smoothing with gaussian kernel More...
 
class  GaussHelmert
 see Foerstner, 2004, "Uncertainty And Projective Geometry" ! untested ! More...
 
class  GaussThreshold
 smoothing with gaussian kernel using a threshold More...
 
class  GenerateGauss
 compute one and two dimensional gauss normal distribution More...
 
class  GenGroundTruth
 
class  GenSynthMatches
 class for generating synthetic matches More...
 
class  GenSynthMatchesRig
 Generates synthetic matches for cameras in a rig. More...
 
class  GenVisiblePoints
 Class for generating 3D points visible by a set of cameras. More...
 
class  GeometryGL
 Reusable Geometry an drawing functions for OpenGL. More...
 
class  GlewInitWrapper
 To call glewInit() at the right time and only once is not easy in complex applications. More...
 
class  glfArrayBufferObject
 Wrapper for OpenGL array buffer objects. More...
 
class  glfBatch
 A batch represents a single Draw call including all parameters (render states). More...
 
class  glfBlendMode
 Defines the function that blends rendered geometry with its background. More...
 
class  glfBufferObject
 Base class of wrapper for OpenGL 3.x buffer objects. More...
 
class  glfCubeMap
 A cube map texture. More...
 
class  glfDepthBufferMode
 Defines the usage of the depth buffer. More...
 
class  glfElementBuffer
 An element buffer contains vertex indices that form primitives. More...
 
class  glfException
 Exception class used for run-time errors in the OpenGLFramework. More...
 
class  glfFBOAttachmentReleaseException
 Class is thrown when an release of some FBO attachment point is not possible. More...
 
class  glfFormatDB
 Helper methods for format conversions in GL and between GL and BIAS. More...
 
class  glfFramebufferObject
 Framebuffer object. More...
 
class  glfMatrix
 A 4x4 matrix in native OpenGL format. More...
 
class  glfPassiveDepthBufferMode
 This class allows to use the currently set viewport in the global opengl state! More...
 
class  glfPassiveRenderMatrix
 This class allows to use the currently set RenderMatrix in the global opengl state! More...
 
class  glfPassiveRenderTarget
 This class allows to use the currently set RenderTarget in the global opengl state! More...
 
class  glfPassiveViewport
 This class allows to use the currently set viewport in the global opengl state! More...
 
class  glfPBuffer_GLX
 GLX pbuffer rendering context. More...
 
class  glfPBuffer_WGL
 WGL pbuffer rendering context. More...
 
class  glfRenderbuffer
 The renderbuffer. More...
 
class  glfRenderingContext
 Interface for OpenGL rendering contexts. More...
 
class  glfRenderingContext_GLX
 Base class for GLX rendering contexts. More...
 
class  glfRenderingContext_WGL
 Base class for WGL rendering contexts. More...
 
struct  glfRenderingContextConfig
 Configuration for a rendering context. More...
 
class  glfRenderTarget
 Interface for render targets. More...
 
class  glfScreen
 Represents the default render target of the current OpenGL context, i.e. More...
 
class  glfShader
 A GLSL vertex shader or fragment shader, which must be linked in a shader program. More...
 
class  glfShaderProgram
 A shader program composed of several shaders. More...
 
class  glfStencilBufferMode
 Defines the usage of the stencil buffer. More...
 
class  glfTexture
 Base class for textures. More...
 
class  glfTexture2D
 A 2D texture. More...
 
class  glfTexture3D
 
class  glfUniformNotFoundException
 Class is thrown when a uniform is set but was not set active by the gl compiler. More...
 
class  glfVertexBuffer
 A vertex buffer contains an array of vertices that can be used for rendering. More...
 
class  glfVertexFormat
 A vertex format describes the attributes of a vertex. More...
 
class  glfViewport
 class for setting viewports More...
 
class  GLProjectionOutputAttachment
 Class for extra rendering pass in GLProjection (for now only used in glutGLviewer) More...
 
class  GLProjectionParametersBase
 GLPPB encapsulates the opengl rendering interface for the projectionparameter classes. More...
 
class  GLProjectionParametersInterface
 Abstract interface class to handle changes in rendering parameters by controllers and in rendering contextes. More...
 
class  GLProjectionParametersPerspective
 class for rendering with projection parameters of ProjectionParametersPerspective More...
 
class  GlutInitWrapper
 To call glutInit() at the right time and only once is not easy in complex applications. More...
 
class  GpuImageFilter
 basic image filter on the gpu More...
 
class  GrabMasterThread
 
More...
 
class  GrabSingleThread
 
More...
 
class  GradientGauss
 gradient calculation with separated gauss masks More...
 
class  GradientGaussAsymmetric
 gradient calculation with separated gauss masks More...
 
class  GradientSimple
 simple gradient calculation gx(x,y) = I(x+1,y) - I(x-1,y) gy(x,y) = I(x,y+1) - I(x,y-1) More...
 
class  GradientSobel3x3
 gradient calculation with sobel 3 by 3 masks More...
 
class  GraphPlotter
 Use this class to plot data as gnuplot does. More...
 
class  GuiBase
 Gui is a simple windowing environment... More...
 
class  GuiCV
 Gui based on OpenCV is a simple windowing environment... More...
 
class  GuiWX
 simple wxWindow to display an image. More...
 
class  GuiWXApp
 
class  GuiWXFrame
 
class  HessianGauss
 gradient calculation with separated gauss masks More...
 
class  HessianSimple
 simple hessian calculation hxx(x,y) = Hessian in x direction hyy(x,y) = Hessian in y direction More...
 
class  Histo_Entry_Float
 
class  HistoFrame
 It's a Frame used to have a Histogramm Canvas, which describes a histogramm of current image. More...
 
class  Histogram1D
 Simple one dimensional histogram computation. More...
 
class  Histogram2D
 
class  HistogramEqualization
 perfoms a histogram equalization on a grey value image More...
 
class  HistogramImage
 Class for easy histogram image generation. More...
 
class  HistoImageCanvas
 It's a Canvas used to compute Histogram for current image working. More...
 
class  HMatrix
 a 3x3 Matrix describing projective transformations between planes More...
 
class  HMatrixBase
 describes a homography More...
 
class  HMatrixEstimation
 Estimate 3x3 matrix relating image coordinates with each other, i.e. More...
 
class  HomgLine2D
 a line l = (a b c)^T is a form of the implicit straight line equation 0 = a*x + b*y + c if homogenized, a^2 + b^2 = 1 beware: (a b) is the vector perpendicular to the line direction therefor b could be interpreted as dx, but then a is equal to -dy More...
 
class  HomgLine3D
 a homogenous homogenized line is described by a direction vector PointInf_ (a point at infinity) and a starting point PointFin_ (which is the closest vector from the coordinate origin to the line if the line is not homogenized, it can bve described by any two points More...
 
class  HomgPlane3D
 A homogeneous plane (in P^3) All points X on the plane p fulfill p ' * X = 0. More...
 
class  HomgPoint1D
 class HomgPoint1D describes a point with 2 degrees of freedom in projective coordinates. More...
 
class  HomgPoint2D
 class HomgPoint2D describes a point with 2 degrees of freedom in projective coordinates. More...
 
class  HomgPoint2DCov
 class representing the covariance matrix of a homogenous point 2D More...
 
class  HomgPoint3D
 class HomgPoint3D describes a point with 3 degrees of freedom in projective coordinates. More...
 
class  HomgPoint3DCov
 class representing the covariance matrix of a homogenous point 3D More...
 
class  HomographyMapping
 Maps image src to image sink with homography H (software implementation) More...
 
class  HomographyRectification
 
class  ICECallbackInterface
 callback interface for ImageCanvasExtended More...
 
class  ICECCallbackInterface
 callback interface for ImageCanvasCheckerBoardExtract More...
 
struct  icppair
 
struct  icpvecandval
 
class  Image
 The image template class for specific storage types. More...
 
class  Image3DData
 stores datas for a textured plane More...
 
class  ImageAlignment
 Inverse Compositional Image Alignment ("Registration") More...
 
class  ImageAttributes
 contains all atribute info and values of e.g. a file. More...
 
class  ImageBase
 This is the base class for images in BIAS. More...
 
class  ImageBlender
 maps images into a common camera and blends them seamlessly More...
 
class  ImageBlenderIncremental
 maps several images into a common mosaic and blends them seamlessly More...
 
class  ImageCalc
 Performs pixelwise arithmetic and boolean operations on images. More...
 
class  ImageCanvas
 display image in wx application, provides zoom and investigation functionality More...
 
class  ImageCanvasCheckerboardExtract
 provides functionality for selection of checkerboard patterns More...
 
class  ImageCanvasGLBase
 2D image display canvas using OpenGL rendering internally. More...
 
class  ImageCanvasRectangularSelection
 provides functionality for selection of rectangle, point, ... More...
 
class  ImageConvert
 class with static functions for converting all kinds of color formats and storage types More...
 
class  ImageConvertThreaded
 Converts images between different color models using multiple threads. More...
 
class  ImageDistribution
 Maps a set of input images to a given output image so that the space in the output image area is optimally used. More...
 
class  ImageDraw
 drawing simple entities into the image like rectangles or lines As all functions are static they have to be called by eg. More...
 
struct  ImageHeader
 Header for sending images over UDP connections. More...
 
class  ImageIO
 Routines for loading and writing all kinds of image formats. More...
 
class  ImageLegendFrame
 Frame to display a Image legend, for example in biasviewwx. More...
 
class  ImagePackage
 An Image Package is multiple .mip images in one file. More...
 
class  ImageSaveThread
 This class creates a thread which stores an image in a file if rescale is not zero then the stored image is downsampled by this factor. More...
 
class  ImageValueBar
 this class represents an image value bar. More...
 
class  ImageWarper
 this class warpes depth images from one persective to the perspective of another camera. More...
 
class  ImgObjGL
 data holder describing OpenGL texture objects in addition to its unique texID. More...
 
class  ImgPosition
 interface class used to ease handover in function calls More...
 
class  IndexedFaceSet
 stores data for drawing a indexed face set. More...
 
class  IndexLineSetHandler
 This class parses a VRML file containing an indexed line set and stores the containing lines. More...
 
class  IntegralHistogram
 This Class handels Integral Histograms on HSL Images It represents an integral image histogram and offers basic methods on histograms. More...
 
class  IntegralImage
 
class  Interpolator
 this class interpolates a function y=f(t) between given control points (the y-values) More...
 
class  IOUtils
 Class grouping together some IO code often used in (small) application, like loading images, parsing their meta data etc. More...
 
class  IselLinearControl
 This class controls the Isel Linear Unit. More...
 
class  IselLinearControlTwoAxis
 This class controls the Isel iMC-S8 Linear Unit (two axis controll) More...
 
struct  ItemAndWidget
 
class  IteratedExtendedKalman
 Iterated Extended Kalman-filter (IEKF). More...
 
class  JointHistogram
 
class  JpegHandler
 Wrapper for fast libjpeg methods. More...
 
class  Kalman
 Classical Kalman filter. More...
 
class  KMatrix
 K describes the mapping from world coordinates (wcs) to pixel coordinates (pcs). More...
 
class  Label
 does a connected component analysis and labels all connected regions More...
 
class  LaguerreSolver
 class encapsulating a laguerre solver for polynomials More...
 
class  LDA
 linear discriminant analysis on a set of classes of vectors LDA is a approach for dimension-reduction of vector-classes while keeping class-separability More...
 
class  LeastSquaresBase
 Base class for linear least squares solvers. More...
 
class  LeastSquaresLapack
 Linear least squares solver based on Lapack routines. More...
 
class  LeastSquaresSVD
 Linear least squares solver based on singular value decomposition. More...
 
class  LEDDetector
 This class contains methods to detect (IR)-LED-Spots, with template matching (new search) or in "recycling" mode (search at old positions). More...
 
class  LevenbergMarquardtBase
 Base interface for classes using non-linear optimization of a target function using the Levenberg-Marquardt algorithm. More...
 
class  LevenbergMarquardtHelper
 Simple helper class for Levenberg-Marquardt optimization. More...
 
class  Line3DData
 stores data for drawing a line More...
 
class  LinearRegionDetector
 try to detect linear regions (const gradient) in images, experimental code for testing More...
 
class  LocalAffineFrame
 affine transformation of 2D image plane which relates image coordinate system and local affine feature coordinate system More...
 
class  LogFacility
 
class  LogPolarMapping
 Maps cartesian source coordinates to log-polar sink coordinates. More...
 
class  MapFusion
 
class  MarchingCubes
 creates a closed mesh from a set of points. More...
 
struct  MarchingCubesGridCell
 
class  MarchingCubesTriangle
 
class  MatchDataBase
 class for representing matches, used in GenSynthMatches and biasshowsm More...
 
class  Matrix
 matrix class with arbitrary size, indexing is row major. More...
 
class  Matrix2x2
 is a 'fixed size' quadratic matrix of dim. More...
 
class  Matrix2x3
 is a 'fixed size' 2x3 matrix templated over the elemnt-type. More...
 
class  Matrix3x2
 is a 'fixed size' More...
 
class  Matrix3x3
 is a 'fixed size' quadratic matrix of dim. More...
 
class  Matrix3x4
 is a 'fixed size' rectangular matrix of dim. More...
 
class  Matrix4x4
 is a 'fixed size' quadratic matrix of dim. More...
 
class  Mean
 average mean filter More...
 
class  MeanDoubleRANSACEvaluator
 helper class for implementation of PreemptievRANSAC and COSAC for robust computation of the mean of a vector of doubles More...
 
class  Median
 Implements a 2D median filter for images. More...
 
class  Median1D
 Computes the median and p-quantile of a vector. More...
 
struct  message_frame_buffer
 
struct  message_frame_header
 Header for sending images over UDP connections. More...
 
class  MetaData
 this class collects all additional data chunks of type AppData to be written into/read from an image file More...
 
class  MixtureOfGaussians
 class for detecting changes in image sequences More...
 
class  MonteCarloTransform
 monte carlo propagation of uncertainty More...
 
class  Morphology
 base class for Erosion, Dilation, and single Deletion More...
 
class  MSAC
 this class does something, but WHAT? Is it the M-Estimator SAmple Consensus ?? More...
 
class  MultipleDepthWarp
 
class  MutexSingleton
 Wrapper for pthread mutex for use with 'automatic' initialization. More...
 
class  MyBasicAnimationManager
 
class  MySampleGrabberCB
 
struct  NodeInfo
 struct containing details of a OSG::Node when used in a wxTreeCtrlOpenSGWx More...
 
struct  NodeInfoEraseOp
 
class  NodeInfoMap
 
struct  NodeInfoOpBase
 
class  NodeInfoOpenSGVisitor
 visitor for traversing the scene graph and applying some operation to the related nodeinfomap More...
 
struct  NodeInfoRestoreNameOp
 
class  NonFatalException
 non fatal exception More...
 
class  Normalization
 class Normalization Functions, e.g. More...
 
class  Nurbs1D
 This class implements a NURBS-function with a one dimensional parameter space (A NURBS line). More...
 
class  Nurbs2D
 This class implements a NURBS-function with a two dimensional parameter space (A NURBS surface). More...
 
class  Nurbs3D
 This class implements a NURBS-function with a three dimensional parameter space (A NURBS volume). More...
 
class  NurbsBase
 Base class for NURBS classes. More...
 
class  NurbsSurface
 
class  OffscreenRendering
 Utility class for offscreen rendering used by GLProjection. More...
 
class  OnlyRotationControl
 class for camera movement in fixed position, only rotation mode. More...
 
class  OpenEXRInterface
 Methods for reading and writing OpenEXR files into and from BIAS ImageBase. More...
 
class  OpenGLCanvas
 OpenGL canvases with additinal event handling (JW) More...
 
class  OpenGLCanvasBase
 base class for OpenGL canvases you could derive from to get base functionality (JW) More...
 
class  OpenSceneGraphHelper
 Utility class for using OpenSceneGraph. More...
 
class  OutputHaze
 exemplary output attachment, creating a bluish haze effect on the rendered output More...
 
class  OutputLensDistortion
 Distortion Rendering. More...
 
class  OutputUnderwater
 exemplary output attachment, creating a underwater effect More...
 
class  OutputWowDisplay
 exemplary output attachment to create 2D+Depth output for Wow Displays More...
 
class  OutputWowDisplay2
 exemplary output attachment to create 2D+Depth output for Wow Displays More...
 
class  PanelForDoubleValueWx
 Helper Class For Parameter Input To Take Floating Point Numbers. More...
 
class  PanTiltAutoControl
 PanTiltControlInterface. More...
 
class  PanTiltAutoControlFactory
 Factory to create a PanTiltAutoControl. More...
 
class  PanTiltControlFactory
 Abstract controller factory used to create all different kinds of PTU controls. More...
 
class  PanTiltControlInterface
 abstract control class for control of Directed Perception Pan Tilt Unit. More...
 
class  PanTiltManualControl
 PanTiltControlInterface. More...
 
class  PanTiltManualControlFactory
 Factory to create a PanTiltManualControl. More...
 
class  PanTiltSoftMotion
 
class  Param
 This class Param provides generic support for parameters. More...
 
class  ParamCallbackInterface
 This class provides an interface to be called if parameter changes occured. More...
 
class  Parametrization
 This class is used for parametrizing F- and H-matrices, generally for optimization purposes. More...
 
class  ParamGUI
 The main Parameter Gui interface, derived from BIAS::Param and extends this class. More...
 
class  ParamGUIDialog
 this provides a gui interface for the BIAS::Param class. More...
 
class  ParamGUIPanel
 this provides a gui interface for the BIAS::Param class. More...
 
class  ParamTypeBase
 This file holds the definitions of the parameter types used by BIAS::Param. More...
 
class  ParamTypeBool
 
class  ParamTypeDouble
 
class  ParamTypeEnum
 
class  ParamTypeInt
 
class  ParamTypeString
 
class  ParamTypeVecDbl
 
class  ParamTypeVecInt
 
class  PCA
 principal component analysis on a set of vectors with PCA it is possible to find the most important dimensions of a set of vectors. More...
 
class  PerPixelProcessingBase
 this class can be used as a simple base class for specialized batches More...
 
class  PixelIterator
 Can be used to run along the image border. More...
 
class  PlainImageCanvas
 Image canvas that does not show zoom frames and redirects mouse click events to its parent. More...
 
class  PlainPerPixelProcessing
 Class rendering quad and executing a fragment shader. More...
 
class  PlanarRectification
 Rectification via perspective cameras, removes distortions. More...
 
class  PlaneRANSAC
 Robust fitting of 3D plane to 3D point set using RANSAC. More...
 
class  PlueckerMatrix
 represente a 3d line using a 4x4 Pluecker matrix More...
 
class  PMatrix
 describes a projective 3D -> 2D mapping in homogenous coordinates More...
 
class  PMatrix3DData
 stores important data for drawing a camera More...
 
class  PMatrixBase
 describes a projective 3D -> 2D mapping in homogenous coordinates More...
 
class  PMatrixEstimation
 compute standard P1/P2 from F. More...
 
class  PMatrixLinear
 This class computes a PMatrix from 2D/3D correspondences with linear methods. More...
 
class  PMDImageIO
 Save 2D/3D-image-data together with some metadata in a single tiff-datafile. More...
 
struct  PMDImageMetaData
 Store extrinsic and intrinsic camera parameters for Rotation is in axis * angle representation image padding and Metadata. More...
 
class  PMDImageProc
 
class  PMDWarp
 class can be used to warp sequences of pmd depth images into a second view with different parameters, including a different camera center. More...
 
class  Point3DData
 stores data for drawing a point More...
 
class  Polynom
 class for Polynoms of arbitary order More...
 
class  PolynomialSolve
 base class for solving polynomial equations More...
 
class  Pose
 Represents 3d pose transformations, parametrized as Euclidean translation and unit quaternion orientation. More...
 
class  PoseParametrization
 Slim class bundeling pose parametrization and associated covariance matrix. More...
 
class  PoseParametrizationCovariance
 class encapsulating the transfromations between different pose parametrizations More...
 
class  Position
 stores valid/nvalid positions in image More...
 
class  PreemptiveRANSAC
 Fast RANSAC after David Nister, "Preemptive RANSAC for Live Structure And Motion Estimation", Internation Conference on Computer Vision (ICCV) 2003. More...
 
class  Primitives
 Helper class for creating primitives. More...
 
class  ProgressSemaphore
 this class represents a progress counter which multiple processes can use. More...
 
class  ProgressSemaphorePool
 
class  Projection
 This class hides the underlying projection model, like projection matrix, spherical camera, lens distortion. More...
 
class  Projection3DData
 stores data for drawing a the extrinisc parameters of a projection. More...
 
class  ProjectionError
 
class  ProjectionMapping
 Maps source pixel to sink pixel of given projections. More...
 
class  ProjectionParametersBase
 Camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as camera pose. More...
 
class  ProjectionParametersBufferedRay
 This class maps image coords to rays which are buffered for fast lookup. More...
 
class  ProjectionParametersCylindric
 Camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose. More...
 
class  ProjectionParametersDynamicLoad
 can load exernally programmed child classes of ProjectionParametersBase More...
 
class  ProjectionParametersFactory
 
class  ProjectionParametersGreatCircles
 spherical camera that samples along big circles containig the H vector. More...
 
class  ProjectionParametersIO
 
class  ProjectionParametersOrthographic
 Camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose. More...
 
class  ProjectionParametersPerspective
 camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose More...
 
class  ProjectionParametersPerspectiveDepth
 additional depth calibration parameters for a perspective depth camera to be used for ToF-(PMD) cameras. More...
 
class  ProjectionParametersProjective
 12 parametric p for completely projective reconstruction scenarios, unknown focal lengths, self calibration, ... More...
 
class  ProjectionParametersSpherical
 camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose More...
 
class  ProjectionParametersSphericalFast
 spherical camera that uses polynomial only and should therefore be faster than other spherical camera More...
 
class  ProjectionParametersSphericalSimple
 projection parameters camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose. the parameters phiOffset and thetaOffset are considered to be intrinsic parameters describing the rotation of the principal point the parameters dPhi and dTheta describe the resolution of a pixel in radian per pixel. Distortion is ignored. This class is intended to describe spherical rectification results. More...
 
class  ProjectionParametersZoom
 camera parameters which define the mapping between rays in the camera coordinate system and pixels in the image as well as external pose More...
 
class  PyramidImage
 Class for holding multiple downsampled images. More...
 
class  PyramidImageInterface
 interface definition of all pyramid images More...
 
class  Quadric3
 Implements a 3D quadric and quadric operations. More...
 
class  Quadric3D
 A quadric as a 4x4 matrix describing a surface in 3d projective space defined by a quadratic equation, e.g. More...
 
class  Quaternion
 class for rotation with axis and angle More...
 
class  Random
 class for producing random numbers from different distributions More...
 
class  RANSAC
 Generic abstract base class for RANSAC (RANdom SAmple Consensus) estimators. More...
 
class  RANSAC_double
 Robust mean computation for double values using RANSAC. More...
 
class  RANSACEvaluatorInterface
 Interface for computation of solutions and evaluation of measurements. More...
 
class  RANSACPreKnowledge
 Extension of RANSAC algorithm: user-supplied guesses are evaluated and refined using RANSAC criterions before actually starting the RANSAC algorithm. More...
 
class  RectificationBase
 base class for rectification implementations and wrappers More...
 
class  RectificationViaProjectionMappingBase
 Base class for rectification implementations that make use of projections to represent rectified state and where the projection-centers in rectified and original state are the same. More...
 
class  RedirectStreams
 used to redirect stdout and stderr into files or to silence them More...
 
class  RegionMatcher
 Basic functions for CornerMatcher. More...
 
class  RenderContextBase
 Base for all classes creating interface between GL and "window manager". More...
 
class  RenderModeGL
 GLRenderMode describes mode for rendering. More...
 
class  Rescale
 Down-, Upsampling routines and Resize. More...
 
class  RescaleTransfer
 Transfer of pixel coordinates for pixel centric reference systems. More...
 
class  RMatrix
 3D rotation matrix More...
 
class  RMatrixBase
 Implements a 3D rotation matrix. More...
 
class  ROI
 class for handling different region of interest (ROI) representations... More...
 
class  RotationAveraging
 Computes mean of rotations due to different measures. More...
 
class  RParametrization
 Slim class bundeling rotation matrix parametrization and associated covariance matrix. More...
 
class  SameButConst
 compile time check if the ConstType differs from EditableType merely by a const qualifier, i.e. More...
 
class  SampleGrabberCallback
 sample grabber callback class for grabbing single frames only More...
 
class  SamplerBinding
 Helper to manage the binding of textures to texture units via uniform names. More...
 
class  ScaledImageCanvas
 display float images in wx application, provides zoom, scale, shift and investigation functionality More...
 
class  Scanline
 Class for scanning a region given by a line and a distance ca. More...
 
class  SceneBase
 Base class for all scenes. More...
 
class  SceneBGImage
 Scene that renders a background image behind all other scenes. More...
 
class  SceneCheckerBoard2D
 The SceneCheckerBoard class allows to draw a 3D checkerboard. More...
 
class  SceneCoordinateFrame
 Display axes of a local coordinate frame. More...
 
class  SceneGL
 Simple interface for GL calls. More...
 
class  SceneGlutPrimitives
 Class for rendering the Glut primitives like teapot, cube, tetrahedron and icosahedron. Mainly used to test rendering without SceneGraph library. More...
 
class  SceneGridGround
 Display a grid ground for orientation. More...
 
class  SceneOpenSceneGraph
 Implements narrow access to OpenSceneGraph. More...
 
class  ScenePlainOpenSceneGraph
 Implements slim openscenegraph scene without extras. More...
 
class  ScenePointLight
 
class  SceneSimpleQuad
 Draws a simple quad. More...
 
class  SceneText
 wrapping bias::drawtextgl to BIAS::Scene More...
 
class  SceneTextScreen
 wrapping bias::drawtextgl to BIAS::Scene More...
 
class  SceneTexturedPlane
 Display a textured plane. More...
 
class  SceneThreeDOutWrapper
 Wrapping ThreeDOut OpenGL-functionality. More...
 
class  ScreenShotListener
 If KEY_F5 is activated screenshot is stored to given basename + screenshot count. More...
 
struct  SensorData
 
class  SeparabelBoxFilter
 
class  SeparableBilateralFilter
 
class  SerialPortIO
 Communication over the serial port, use OpenPort with e.g. More...
 
class  SettingsGL
 Application controlled OpenGl renderingsettings. More...
 
class  ShaderProgramPool
 this class represents a set of shader programs one can add and remove shader programs to and from the pool all programs have unique names and can be accessed by the name uniform variables of the shader programs can be set by addressing a program by its name by setting a uniform variable it is checked, if a uniform variable of this type and with this name exists, if not an glfException is thrown before using a shader program call : LinkAll(); More...
 
class  SharedPtr
 pointer with reference count and automatic deletion More...
 
class  SharedPtrBase
 pool ptr to the data and the reference count More...
 
class  ShowCamWxFormat7Frame
 
class  ShowCamWxFrame
 
class  ShowCamWxVideoSourceFactory
 
class  SimilarityTransform
 Implements a 3D similarity transformation (rotation, translation, and isometric scaling). More...
 
class  SimpleGLApp
 Simple GL application. More...
 
class  SimpleGLCanvas
 Helper canvas for SimpleGLApp More...
 
class  SimpleGLFrame
 Helper frame for SimplaGLApp. More...
 
class  SimpleMultiPassFragmentShader
 this class collects a number of shaders and textures uniquely identified by their names shader uniforms can be set by addressing the shaders by their names textures a shader reads from and writes to can be spezified by setting input and output textures addressing the textures through their names calling Execute with a vector of shader names as parameter executes all shaders on the gpu in the order given by the shader names vector More...
 
class  Singleton
 Simple singleton implementation for multithreaded applications. More...
 
class  SMPFSActionInterface
 Class allows to add actions different then rendering to the multipass shader execution. More...
 
class  SOCP
 Wrapper for Second-Order Cone Programming implementation, by Miguel S. More...
 
class  SparseArray2D
 generic two dimensional psarsly populated rectangular array holding arbitrary data types More...
 
class  SparseMatrix
 Implementation of sparse matrix operations. More...
 
class  SphericalCoordinates
 Transformation between affine and spherical coordinates. More...
 
class  SphericalDepthPanorama
 create and represent spherical depth panorama More...
 
class  SphericalRectification
 Class implements rectification by image projection onto a sphere. More...
 
class  StandardDeviation
 Computes the standard deviation and mean of given values. More...
 
class  StatekeeperGL
 
push and pop GL states on constructor/destructor 

Helper class pop(save) OpenGL states on construction and push them on destruction automatically. More...

 
class  StereoRedGreen
 combine two separate images into one stereo image for red-green glasses More...
 
class  StringUtils
 Contains some useful methods for string manipulation. More...
 
class  StructureTensor
 basic class for structure tensor calculation More...
 
class  SVD
 computes and holds the singular value decomposition of a rectangular (not necessarily quadratic) Matrix A More...
 
class  SVD3x3
 singular value decomposition for 3x3 matrices More...
 
class  SymmetricMatrix3x3
 is a 'fixed size' symmetric quadratic matrix of dim. More...
 
class  TemplateSpecializedBatch
 This file contains the header for a class template. More...
 
class  Tensor3D
 
class  Tensor3D3x3x3
 
class  TestFilterBase
 helper class for testing individual filters More...
 
class  Text3DData
 stores important data for drawing 3d text More...
 
class  Texture2DPool
 Convenience container for managing 2D textures. More...
 
class  TextureMapping
 Maps source pixel to sink pixel given any TextureTransform. More...
 
class  TextureTransform
 class for representing parameterized image warps, such as homography, displacement, ... More...
 
class  TextureTransformAffine
 analytic properties of affine image warp More...
 
class  TextureTransformDisparity
 analytic properties of x-displacement More...
 
class  TextureTransformDisplacement
 analytic properties of 2D image displacement More...
 
class  TextureTransformEuclidian
 analytic properties of Euclidian image warp (rot. More...
 
class  TextureTransformHomography
 analytic properties of homography transformation of an image More...
 
class  TextureTransformRotation
 analytic properties of rotational image warp (around some point) More...
 
class  TextureTransformSimilar
 
class  TFTensorEstimation
 class TFTensorEstimation More...
 
class  Thinning
 generic Thinning class, uses ethe Rosenfeld algorithm to thin structures in images without erasing them, unlike the erosion filter. More...
 
class  ThreeDOut
 Unified output of 3D entities via OpenGL or VRML. More...
 
class  ThreeDOutOpenSceneGraph
 a class for exporting ThreeDOut objects to OSG scene graphs More...
 
struct  ThreeDOutParameters
 configuration struct for drawing styles of various 3d objects More...
 
class  TimeMeasure
 class TimeMeasure contains functions for timing real time and cpu time. More...
 
class  TimeMeasurement
 
class  TimeStamp
 holds system time in milliseconds More...
 
class  TimeStampGen
 Generates absolute timestamps with a certain offset from given base-time. More...
 
class  Timing
 high resolution HW timers JW More...
 
struct  TIntersect
 Used in function DetermineStartEnd_. More...
 
class  TrackballBase
 functionality for editing cameras or transformations in trackball mode. parts of trackballcontroller code have been moved to this base class so they can be used in other trackball classes like trackballTransController. More...
 
class  TrackballControl
 class for camera movement in trackball mode. More...
 
class  TrackballTransControl
 class for editing scenegraph transform nodes in trackball mode More...
 
class  Tracker
 High level tracking class. More...
 
class  TrackerBaseAffine
 
class  TrackerBaseAffine2
 devel version of antialiased affine tracker More...
 
class  TrackerBaseHomography
 
class  TrackerBaseInterface
 Base class for the different tracking algorithms, defining the interfaces for the tracking functions. More...
 
class  TrackerBaseSimple
 
class  TrackerBaseWeighted
 
class  TrackerBaseWeighted1D
 
class  TrackerSynth
 returns ground truth tracks read from file, for debugging More...
 
class  TransformNode
 interface for transformations edited by a TrackballTransController More...
 
struct  TreeDescr
 container for scene root and ptr to nodeinfomap More...
 
class  Triangle
 Represents a 2D triangle and allows some computations with it. More...
 
class  TriangleMesh
 Create and represent a 3D triangle mesh. More...
 
class  TriangleMeshSplatRendering
 Scene for rendering multiple triangle meshes generated from depth maps. More...
 
class  Triangulation
 Class for triangulation of 3Dpoints from 2D matches. Covariance matrix (refering to an uncertainty ellipsoid) is computed also. More...
 
class  TriangulationMidPoint
 Class for triangulation of 3d points from multiple projection rays using the mid-point method. More...
 
class  TrifocalTensor
 
class  TrifocalTensorBase
 
class  TukeyWindow
 Multiplies an image with a full image size tukey window. More...
 
class  UDPClient
 class for receiving UDP packages More...
 
class  UDPDataConsumer
 Interface class for UDP data. More...
 
class  UDPServer
 UDP server class. More...
 
class  UncertaintyTransformBase
 base class for all uncertainty transforms More...
 
class  UnscentedTransform
 uses the unscented transformation to map a normal distribututed random variable using a nonlinear transformation More...
 
class  UnVignette
 Unvignette algorithm for images. More...
 
class  UUID
 interface class for producing/storing Universally Unique IDentifiers More...
 
class  UUIDsortAscending
 Helper class for ascending sort of sequential BIAS::UUID instances. More...
 
class  Vector
 class for column vectors with arbitrary size More...
 
class  Vector2
 class Vector2 contains a Vector of dim. More...
 
class  Vector3
 class Vector3 contains a Vector of fixed dim. More...
 
class  Vector4
 class Vector4 contains a Vector of dim. More...
 
class  VectorStatistics
 Provides methods to compute statistical values from vector<double>. More...
 
class  VideoServer
 class to send images from a camera or disk to a client More...
 
class  VideoShMFeeder
 class to save Images to a Sharerd memory More...
 
class  VideoShMFeederPMD
 class to save Images to a Sharerd memory. More...
 
class  VideoSink
 VideoSink for writing FFMPEG Videos from images. More...
 
class  VideoSink_FFmpeg
 Video encoding using FFmpeg library. More...
 
class  VideoSource
 Defines a common interface to different devices. More...
 
class  VideoSource_Centaurus
 VideoSource for Centaurus boards and Sony HD cameras. More...
 
class  VideoSource_Controller
 
class  VideoSource_Controller_Base
 
class  VideoSource_Controller_Kinect
 
class  VideoSource_Controller_PMD
 
class  VideoSource_Controller_PMDZess
 
class  VideoSource_Controller_SwissRanger
 
class  VideoSource_Controller_XB3
 
class  VideoSource_DCAM
 This class VideoSource_DCAM implements access to IEEE1394 (Firewire, iLink) cameras following the DCam 2.0 standard protocol. More...
 
class  VideoSource_DCAM_BumbleBee
 
class  VideoSource_DCAM_XB3
 VideoSource PtGrey Bublebee XB3. More...
 
class  VideoSource_DcamPMD
 reads PMD-tiffs with depth images and modulation coefficients More...
 
class  VideoSource_Disk
 This class simulates a video device by loading images from disk. More...
 
class  VideoSource_Disk_Bayer
 
class  VideoSource_DiskPMD
 reads PMD-tiffs with depth images and modulation coefficients More...
 
class  VideoSource_DiskZessPMD
 reads images from three image lists with 2d images, depth images and modulation coefficients More...
 
class  VideoSource_DSHOW
 This class extends VideoSource for the use of DirectShow devices you need Microsoft Windows SDK version 6.1 and Microsoft DirectX 9 SDK (November 2008) More...
 
class  VideoSource_DV
 This class extends VideoSource for the use of IEEE1394-connected DV-camcorders. More...
 
class  VideoSource_DV2
 This class extends VideoSource for the use of IEEE1394-connected DV-camcorders. The low-level driver in DV2 is dv1394.o using DMA transfers. Create device: /dev/dv1394 171 32+i. More...
 
class  VideoSource_FFmpeg
 Simple video decoding of video files using FFmpeg library. More...
 
class  VideoSource_FFMPEGVideo
 Class for extracting frames from video files using FFMpeg, analog to class DShowVideo. More...
 
class  VideoSource_Kinect
 Use Kinect with the libfreenect drivers just like the ToF Cameras. More...
 
class  VideoSource_Kinect2
 Use the Kinect2 class to grab images from the Microsoft Kinect2. More...
 
class  VideoSource_Kinect2Net
 Provides remote access to a Microsoft Kinect2 camera. More...
 
class  VideoSource_Kinect_Base
 Use Kinect just like the ToF Cameras. More...
 
class  VideoSource_Kinect_Callback
 Implementing FreenectDevice Interface, this class is used internally by VideoSource_Kinect - do not use directly. More...
 
class  VideoSource_MDcam
 VideoSource_MDcam simplifies acces to more then one DCam. It suports multiple IEEE1394-adapters, extern synchronization via parallel port and networked capture cluster. More...
 
class  VideoSource_Net
 This class implements a video streaming client using TCP. More...
 
class  VideoSource_OpenNI
 Use OpenNI just like the ToF Cameras. More...
 
class  VideoSource_PMD
 Support for CamCube usb cam. More...
 
class  VideoSource_PMDZess
 represents Zess PMD camera driver interface TODO: include support for normal images (2DImg_), not supported by prototype More...
 
class  VideoSource_Shm
 This class implements a video streaming client using shared memory to receive images from another application. More...
 
class  VideoSource_ShmPMD
 This class implements a video streaming client using shared memory to receive images from another application. It also transfers Depth and Amplitude data coming from a PMD camera. More...
 
class  VideoSource_Stereo
 bundles two video sources for stereo More...
 
class  VideoSource_SwissRanger
 Support for SwissRanger usb cam. More...
 
class  VideoSource_uEye
 This class extends VideoSource for the use of IDS uEye devices. More...
 
class  VideoSource_V4L
 This class extends VideoSource for the use of Video4Linux supported devices like framegrabber, USB cameras. More...
 
class  VideoSourceCapabilities
 Checks for VideoSource capabilities. More...
 
class  VideoStream
 
To allow capturing of camera image to disk efficiently, (avoid

multiple memcopy operations), this class defines an interface to file containing one header and multiple images. More...

 
class  VideoTransmitter
 class to send images to a client uses TCP or UDPServer, More...
 
class  View
 A view is a rectangular part of a render context in which a set of scenes is rendered using a GLProjection. More...
 
class  ViscaControl
 for use with Sony PanTilt Cameras, also compatible with WISKA PanTilt Cameras. More...
 
struct  WeightedSigmaPoint
 
class  WoWDisplayShader
 
class  WrapBias2Ipl
 wrapper around a BIAS image to be used as an OpenCv IPlimage with shared data area. More...
 
class  wxChoiceWithMemory
 
class  wxMatrixPanel
 Panel for displaying and editing matrices. More...
 
class  wxMessageDialogCheckbox
 
class  wxProjectionDialog
 Dialog containing a wxProjectionPanel. More...
 
class  wxProjectionPanel
 Panel for displaying and editing projections. More...
 
class  WxToAsciiArray
 Class for converting an array of wxStrings to an array of non-const ASCII strings. More...
 
class  wxVectorPanel
 Panel for displaying and editing vectors. More...
 
class  wxViscaControlFrame
 Implementing wxViscaControlFrameInterface. More...
 
class  wxViscaControlFrameInterface
 Class wxViscaControlFrameInterface. More...
 
class  wxViscaControlPanel
 Implementing wxViscaControlPanelInterface. More...
 
class  wxViscaControlPanelButtons
 Implementing wxViscaControlPanelButtonsInterface. More...
 
class  wxViscaControlPanelButtonsInterface
 Class wxViscaControlPanelButtonsInterface. More...
 
class  wxViscaControlPanelInterface
 Class wxViscaControlPanelInterface. More...
 
class  XMLBase
 Base class with interface for xml output. More...
 
class  XMLIO
 Wrapper class for reading and writing XML files based on the XML library libxml2. More...
 
class  ZoomFrame
 used by ImageCanvas and ScaledImageCanvas, should not be used directly More...
 
class  ZoomImageCanvas
 

Typedefs

typedef struct BIAS::CameraInfo_s CameraInfo
 
typedef enum BIAS::CameraModel_e CameraModel
 
typedef struct
BIAS::CameraParameter_s 
CameraParameterSet
 
typedef std::map< std::string,
cl::Kernel > 
cl_kernel_map
 
typedef struct cornerstruct CORNER_LIST [MAX_CORNERS]
 
typedef struct BIAS::Edge_s Edge
 Struct for easier handling of edges. More...
 
typedef glfPBuffer_GLX glfPBuffer
 
typedef enum BIAS::LensModel_e LensModel
 
typedef
ProjectionParametersBase *(* 
maker_t )()
 
typedef std::vector
< BIAS::Vector2< unsigned int > > 
PointQueue
 
typedef BIAS::Vector4< double > RGBAd
 
typedef BIAS::Vector4< float > RGBAf
 
typedef BIAS::Vector4
< unsigned char > 
RGBAuc
 
typedef BIAS::Vector3< double > RGBd
 
typedef BIAS::Vector3< float > RGBf
 
typedef BIAS::Vector3
< unsigned char > 
RGBuc
 
typedef void(* SampleGrabberCBF )(double time_sec)
 
typedef std::vector< std::pair
< float, float > > 
t_CoordVecf
 helper vector of coordinates More...
 
typedef PanTiltSoftMotion t_SoftMotion
 

Enumerations

enum  {
  ID_Quit = 1, ID_Timer = wxID_HIGHEST+332, ID_Grab, ID_GrabContinuous,
  ID_Key, ID_Show1, ID_Show2, ID_Show3,
  ID_Show4, ID_Show5, ID_Show6, ID_Show7,
  ID_Show8, ID_Show9, ID_Show_FL, ID_Controller
}
 
enum  {
  ID_LEFT =1, ID_RIGHT, ID_UP, ID_DOWN,
  ID_RESET, ID_DPQUIT, ID_DPControl, ID_RESETFULL,
  ID_AUTO
}
 
enum  {
  ID_About = wxID_ABOUT, ID_Exit = wxID_EXIT, ID_Next = wxID_HIGHEST+2051, ID_Prev,
  ID_Save, ID_Invalid, ID_Help, ID_RescaleImage
}
 
enum  {
  ID_Timer = wxID_HIGHEST+332, ID_Grab, ID_GrabContinuous, ID_GrabToStream,
  ID_Key, ID_Fit, ID_CAMERAS_LISTBOX, ID_SPLITTER_WINDOW,
  ID_HIDE_CAMERALIST, ID_SHOW_CAMERALIST, ID_KeepScroll, ID_Show1,
  ID_Show2, ID_Show3, ID_Show4, ID_Show5,
  ID_Show6, ID_Show7, ID_Show8, ID_Show9,
  ID_SaveParameters, ID_ShowParameters, ID_Controller, ID_Paramframe,
  ID_Disable, ID_Frame1, ID_Frame2, ID_FindIEEE1394,
  ID_FindUEYE, ID_FindSwissranger, ID_FindZess, ID_FindPMDTec,
  ID_FindWebcams, ID_FindKinect, ID_FindOpenNI, ID_FindKinect2,
  ID_OpenFlirController, ID_OpenViscaController, ID_OpenDPController
}
 
enum  { ID_Quit = 1, ID_BUTTON_QUIT, ID_TIMER = 1001 }
 
enum  BayerDemosaicMethod {
  BAYER_DEMOSAIC_METHOD_NEAREST, BAYER_DEMOSAIC_METHOD_SIMPLE, BAYER_DEMOSAIC_METHOD_BILINEAR, BAYER_DEMOSAIC_METHOD_HQLINEAR,
  BAYER_DEMOSAIC_METHOD_VNG, BAYER_DEMOSAIC_METHOD_AHD
}
 methods for conversion from bayer to rgb More...
 
enum  BIAS_DEINTERLACE_TYPE { BIAS_DI_121, BIAS_DI_22 }
 the type of deinterlacing: BIAS_DI_121 : calculate new pixel from old neighbouring pixels with new = (old1+2*old2+old3)/4 BIAS_DI_22 : calculate new pixel from old neighbouring pixels with new = (old1+old2)/2 More...
 
enum  BIAS_LOG_LEVEL {
  BIAS_LOG_NONE = 0, BIAS_LOG_FATAL, BIAS_LOG_WARNING, BIAS_LOG_INFO,
  BIAS_LOG_DEBUG
}
 
enum  BIAS_ProjParaPersp_DISTORTION_TYPE {
  DISTYPE_RADIAL = 0, DISTYPE_DEF =1, DISTYPE_BROWN =2, DISTYPE_NONE =3,
  DISTYPE_INVERSE_RAD =4, DISTYPE_RAD3 =5, DISTYPE_INVRAD3 =6
}
 
enum  BIAS_TOF_DEPTH_ERROR_MODEL {
  DEPTH_MODEL_UNDEFINED = -1, DEPTH_MODEL_POLYNOM = 0, DEPTH_MODEL_LINEAR = 1, DEPTH_MODEL_SPLINE = 2,
  DEPTH_MODEL_NONE = 3
}
 
enum  CameraDrawingStyle {
  PyramidMesh, PyramidSolid, Arrow, PyramidMeshWithArrow,
  PyramidWithCenterBox, Undrawn
}
 different styles when drawing cameras, e.g. More...
 
enum  CameraModel_e {
  CAMERA_SONY_DFW_X700 = 0, CAMERA_SONY_DFW_V500, CAMERA_PTGREY_DRAGONFLY_COLOR, CAMERA_PTGREY_DRAGONFLY_HIRES,
  CAMERA_PTGREY_DRAGONFLY_BW, CAMERA_PTGREY_DRAGONFLY2_COLOR_HIRES, CAMERA_PTGREY_SCORPION_COLOR_1600, CAMERA_PTGREY_FIREFLY_COLOR,
  CAMERA_PTGREY_FIREFLY_BW, CAMERA_PTGREY_GRASSHOPPER_COLOR, CAMERA_PTGREY_FLEA2_BW, CAMERA_PTGREY_BUMBLEBEE_XB3,
  CAMERA_SONY_EVID31, CAMERA_SONY_DV, CAMERA_UNIBRAIN_FIREI, CAMERA_NET_FO323SC,
  CAMERA_KAMERAWERK_DRESDEN_LOGILUX_I5, CAMERA_PTGREY_BUMBLEBEE_XB2, CAMERA_UNKNOWN
}
 Enumeration for the known IEEE1394 camera models Only used internally in VideoSource_DCAM. More...
 
enum  CornerIndices {
  LOWER_LEFT =0, LOWER_RIGHT, UPPER_RIGHT, UPPER_LEFT,
  OPTICAL_CENTER
}
 
enum  DrawbufferMode {
  MONO =0, STEREO_UNTOUCHED, STEREO_CONSUMER_NV, STEREO_QUADBUFFERED,
  STEREO_LEFT_RIGHT, STEREO_TWOSCREENS
}
 
enum  EdataType {
  CS_NONE, CS_STRING, CS_FLOAT, CS_INT,
  CS_BINARY
}
 
enum  EGradType { GT_Simple, GT_Sobel3x3, GT_Gauss, GT_GaussAsymmetric }
 different gradients to be used by hiogher level classes More...
 
enum  eNodeType {
  eNT_Default = 0, eNT_FromDisk, eNT_FromImageFile, eNT_Marker,
  eNT_Light, eNT_PointCloud, eNT_BBox, eNT_VNTriMesh
}
 
enum  ERejectionType { RT_Invalid =-1, RT_MAD, RT_X84, RT_X84M }
 
enum  ERoiType { ROI_Corners, ROI_Mask, ROI_Points, ROI_Rows }
 
enum  ETrackerResult {
  TRACKER_SUCCESS = 0, TRACKER_NOSTRUCTURE = -1, TRACKER_OUTOFIMAGE = -2, TRACKER_TOOMANYITER = -3,
  TRACKER_OUTOFROI = -4, TRACKER_MEANABSDIF = -5, TRACKER_IGNOREPOINT = -6, TRACKER_X84 = -7,
  TRACKER_ODDAFFINEWARP = -8, TRACKER_ERRORINCREASED = 1
}
 
enum  ETrackerType {
  TT_Invalid =-1, TT_Simple, TT_SimpleWeighted, TT_SimpleMasked,
  TT_Similar, TT_Affine, TT_Weighted1D, TT_Affine2,
  TT_Homography
}
 defines type or combination of tracker(s) used: simple/weighted estimate a dx,dy, Affine estimate an affine transformation More...
 
enum  ETransformType {
  NONE, Quat2EulerZYX, EulerZYX2Quat, PoseTransform,
  Point3DTransform
}
 
enum  EXPOSURE_MODE { NORMAL, SMB }
 
enum  FILTER_DIALOG_IDs {
  ID_WIN_GAUSS = 2080, ID_WIN_MEAN, ID_WIN_GRADIENT_SOBEL_3X3, ID_WIN_MEDIAN,
  ID_WIN_RESCALE, ID_WIN_CANNY_EDGE, ID_WIN_PREVIEW, ID_PANEL_DOUBLE_VAL,
  ID_WIN_BVWX_MAINFRAME, ID_WIN_IMAGECANVAS_UC, ID_WIN_IMAGECANVAS_FL, ID_BTN_FILTER_FDB,
  ID_BTN_PREVIEW_FDB, ID_BTN_RESET_FDB, ID_WIN_FILTER
}
 all non-standard IDs related to this dialog – classes inherited from this included and all classes that use this class – should be entered here to decrease conflict possibilities. More...
 
enum  GraphPlotter_DrawStyle {
  DS_POINT_1 =1, DS_POINT_2, DS_POINT_3, DS_POINT_4,
  DS_POINT_5, DS_LINE
}
 
enum  HistMode { HIST_POINTS, HIST_BARS, HIST_LINES }
 
enum  InterpolationMethod {
  InterpolationMethod_UNKNOWN =0, MapNearestNeighbor =1, MapBilinear =2, MapBicubic =3,
  MapTrilinear =4, MapAnisotropic =5
}
 accuracy for resampling More...
 
enum  InterpolationType { NearestNeighbour, Bilinear, Bicubic }
 
enum  LensModel_e {
  LENS_SONY_EVID31_BUILTIN, LENS_SONY_DV_BUILTIN, LENS_PENTAX_CMOUNT_4_8, LENS_PENTAX_CMOUNT_8_0,
  LENS_PENTAX_CMOUNT_4_2, LENS_UNKNOWN
}
 Enumeration for the known lenses for IEEE1394 cameras Only used internally in VideoSource_DCAM. More...
 
enum  LineDrawingStyle { Solid, Dashed }
 
enum  LowPassType { LPT_Mean =0, LPT_Gauss, LPT_Binomial, LPT_GaussThreshold }
 determines which lowpass filter is used before subsampling More...
 
enum  MatrixInitType { MatrixZero, MatrixIdentity }
 can be passed to matrix constructors to init the matrix with the most often used values More...
 
enum  MoGColorModel {
  MOG_RGB =0, MOG_RGBD, MOG_NRGB, MOG_NRGBD,
  MOG_HS, MOG_HSD
}
 
enum  Navigationmode { modeAxis1 =1<<0, modeAxis2 =1<<1, modeAxis3 =1<<2 }
 
enum  PMDtype {
  PMD_1K = 0, PMD_3K = 1, MultiCam_3K = 2, MultiCam_19K = 3,
  NoPMD = 99
}
 
enum  POINT_DRAW_STYLE {
  POINT_SIMPLE =0, POINT_SPLATTING, POINT_LIGHTFIELD, POINT_QUADTREE,
  POINT_ZBUFFER, POINT_PROPABILITY, POINT_MESHED
}
 
enum  PointDrawingStyle { Point, PointSprite, Sphere, Box }
 different styles when drawing points, e.g. More...
 
enum  ScaledImageCanvas_IDs {
  ID_Scale =1, ID_Offset, ID_Scale_L, ID_Scale_R,
  ID_Scale_Steps, ID_Offset_L, ID_Offset_R, ID_Offset_Steps,
  ID_Check_Auto_Sc_Of
}
 
enum  SerialPortParityMode { SPPM_NoParity, SPPM_EvenParity, SPPM_OddParity, SPPM_SpaceParity }
 
enum  TLineType {
  LT_Invalid, E_NE, NE_N, N_NW,
  NW_W, W_SW, SW_S, S_SE,
  SE_E
}
 direction of line if start is in coordinate origin as given by compass More...
 
enum  TRIANGLEMESH_DRAW_STYLE { TRIANGLE_SIMPLE =0, TRIANGLE_SPLATTING }
 

Functions

wxString AsciiToWx (const char *thestring)
 Converts a C string to a wxString. More...
 
wxString AsciiToWx (const std::string &thestring)
 Converts a std::string to a wxString. More...
 
BIASMathAlgo_EXPORT double BetaDistribution (double a, double b, double x)
 
BIASMathAlgo_EXPORT double BetaDistributionApprox (double a, double b, double x)
 
void BIASDebug_EXPORT biasabort ()
 wrapper for abort() Disables unreachable warnings. More...
 
void BIASDebug_EXPORT biasexit (const int status=1)
 wrapper for exit() Disables unreachable warnings. More...
 
int BIASMatrixToMxArr (const BIAS::Matrix< double > &mat, mxArray *&mxMat)
 Convert BIAS::Matrix to MATLAB-array, inclusive allocation! More...
 
int BIASVectorToMxArr (const BIAS::Vector< double > &vec, mxArray *&mxVec)
 Convert BIAS::Vector to MATLAB-array, inclusive allocation! More...
 
template<typename T >
Cast (const double input)
 correct casting to storage type, incorporates rint for integer values and simple casting for floating point values More...
 
template<typename T >
BIASCommon_EXPORT T Cast (const double input)
 correct casting to storage type, incorporates rint for integer values and simple casting for floating point values More...
 
template<>
BIASCommon_EXPORT double Cast< double > (const double input)
 
template<>
BIASCommon_EXPORT float Cast< float > (const double input)
 
void CheckJacobian (minpack_funcder_mn fun, void *p, const long int NumErrors, const Vector< double > &x, Vector< double > &error)
 Convenience function to check correctness of user supplied Jacobians J(x) needed by the analytical version of the Levenberg-Marquardt algorithm. More...
 
bool CheckResult (const std::vector< bool > &est_inliers, const double &est_mean, const std::vector< bool > &gt_inliers, const double &gt_mean, const double &gt_sigma3)
 
BIASMathAlgo_EXPORT double ChiSquareCulmProbFun (double x, int deg_freedom)
 
BIASMathAlgo_EXPORT double ChiSquareProbDensFun (double x, int deg_freedom)
 
wxString CleanString (const wxString &input, const wxString replaceWith=wxEmptyString)
 
void CleanStringIP (wxString &input, const wxString replaceWith=wxEmptyString)
 
void Compute4by1ErrorVector (KLT_TYPE *imgdiff, KLT_TYPE *gradx, KLT_TYPE *grady, const int hw, const int hh, BIAS::Vector< KLT_TYPE > &e)
 
void Compute4by4GradientMatrix (KLT_TYPE *gradx, KLT_TYPE *grady, const int hw, const int hh, BIAS::Matrix< KLT_TYPE > &T)
 
void Compute6by1ErrorVector (KLT_TYPE *imgdiff, KLT_TYPE *gradx, KLT_TYPE *grady, const int hw, const int hh, BIAS::Vector< KLT_TYPE > &e)
 
void Compute6by6GradientMatrix (KLT_TYPE *gradx, KLT_TYPE *grady, const int hw, const int hh, BIAS::Matrix< KLT_TYPE > &T)
 
void Compute8by1ErrorVector (KLT_TYPE *imgdiff, KLT_TYPE *gradx, KLT_TYPE *grady, KLT_TYPE a11, KLT_TYPE a12, KLT_TYPE a21, KLT_TYPE a22, KLT_TYPE tx, KLT_TYPE ty, KLT_TYPE h31, KLT_TYPE h32, const int hw, const int hh, BIAS::Vector< KLT_TYPE > &e)
 
void Compute8by8GradientMatrix (KLT_TYPE *gradx, KLT_TYPE *grady, KLT_TYPE a11, KLT_TYPE a12, KLT_TYPE a21, KLT_TYPE a22, KLT_TYPE tx, KLT_TYPE ty, KLT_TYPE h31, KLT_TYPE h32, const int hw, const int hh, BIAS::Matrix< KLT_TYPE > &T)
 
long int ComputeCovariance (long int M, long int N, double *ResultingJacobian, int *ipvt, double &SumOfSquaredErrors, Matrix< double > &Cov)
 Compute covariance matrix from Levenberg-Marquardt resulting Jacobian matrix J(x) and permutation matrix P (see description for method LevenbergMarquardtExtended above or search in minpack/minpack-documentation.txt for IPVT). More...
 
long int ComputeCovariance (const long int NumErrors, const long int NumParams, const Matrix< double > &Jac, const Vector< int > &Permutation, const double &SumOfSquaredErrors, Matrix< double > &Cov)
 Convenience wrapper for ComputeCovariance. More...
 
long int ComputeJacobian (minpack_func_mn fun, void *p, const int NumErrors, const Vector< double > &x, Matrix< double > &Jac, const double gradientEpsilon=LM_DEF_EPSILON)
 Compute the Jacobian J(x) of function f at x. More...
 
void BIASGui_EXPORT ConsoleRedirectIO (std::string name=std::string(""))
 Extra Console for WIN32 WinMain gui applications. More...
 
template<class T , class U >
SharedPtr< T > ConstCast (const SharedPtr< U > &src)
 
BIASMathAlgo_EXPORT double CulmBetaDistribution (double a, double b, double x)
 
BIASMathAlgo_EXPORT double CulmulativeNormalDistribution (double x, double sigma)
 culmulative probability function of normal distribution More...
 
template<class T >
unsigned int DecimalsToStore ()
 determien the number of deciamls to store, w.g. More...
 
void DepthCallBack (freenect_device *dev, void *v_depth, uint32_t timestamp)
 
template<class T , class U >
SharedPtr< T > DynamicCast (const SharedPtr< U > &src)
 
template<typename T >
bool Equal (const T left, const T right, const T eps=std::numeric_limits< T >::epsilon())
 comparison function for floating point values See http://www.boost.org/libs/test/doc/components/test_tools/ floating_point_comparison.html for discussion More...
 
template<>
BIASCommon_EXPORT bool Equal< double > (const double left, const double right, const double eps)
 
template<>
BIASCommon_EXPORT bool Equal< float > (const float left, const float right, const float eps)
 
wxString FilenamesToWx (const char *thestring)
 
wxString FilenamesToWx (const std::string &thestring)
 
void * FreenectThreadFunc_ (void *arg)
 
BIASMathAlgo_EXPORT double Gamma (double x)
 
int GaussJordanElimination (BIAS::Matrix< KLT_TYPE > &a, BIAS::Vector< KLT_TYPE > &b)
 
bool GenerateRandomData (Random &MyRandom, const unsigned num_data, const unsigned num_outliers, const double sigma3, const unsigned min_sample_size, std::vector< double > &data, std::vector< bool > &inliers, double &mean)
 
template<class T >
T * Get (SharedPtr< T > &t)
 
template<class T >
T *const Get (const SharedPtr< T > &t)
 
double GetBaseLevel (const Vector< double > &apar, bool backdirection)
 
enum eNodeType GetNodeType (const osg::ref_ptr< osg::Node > node)
 
void GetTSC_hilo (unsigned int *hi, unsigned int *lo)
 processor cycles Time Stamp Counter on >= Pentium like CPU's. More...
 
template<class T >
bool Greater (const T left, const T right, const T eps=std::numeric_limits< T >::epsilon())
 comparison function for floating point values More...
 
template<class T >
bool GreaterEqual (const T left, const T right, const T eps=std::numeric_limits< T >::epsilon())
 comparison function for floating point values More...
 
template<class StorageType >
bool HaveImagesMatchingROI (const Image< StorageType > &i1, const Image< StorageType > &i2)
 Test the the dimensions of the ROI of two images. More...
 
 INST (unsigned char)
 
 INST (float)
 
 INST (int)
 
 INST (char)
 
 INST (short)
 
 INST (double)
 
BIASMathAlgo_EXPORT double InvChiSquareCulmProbFun (double x, int deg_freedom)
 
BIASMathAlgo_EXPORT double InvGamma (double x)
 
bool IsConsoleStream (const std::ostream &os)
 Helper returning true on console ostreams like cerr, cout Useful to distinguish between console (cout,cerr) and other i.e. More...
 
std::string IsoLatin1ToUtf8 (const std::string &s)
 
float lerp (const float a, const float b, const float f)
 linear interpolation Cg equivalent function. More...
 
double lerp (const double a, const double b, const double f)
 
template<typename T >
bool Less (const T left, const T right, const T eps=std::numeric_limits< T >::epsilon())
 comparison function for floating point values More...
 
template<typename T >
bool LessEqual (const T left, const T right, const T eps=std::numeric_limits< T >::epsilon())
 comparison function for floating point values More...
 
long int LevenbergMarquardt (minpack_funcder_mn fun, void *p, long int m, long int n, Vector< double > &InitialGuess, Vector< double > &Result, double Tolerance=MINPACK_DEF_TOLERANCE)
 Solves an overdetermined system f(x) = 0 of m non-linear equations with n parameters using the Levenberg-Marquardt algorithm. More...
 
long int LevenbergMarquardt (minpack_func_mn fun, void *p, long int M, long int N, Vector< double > &InitialGuess, Vector< double > &Result, double Tolerance=MINPACK_DEF_TOLERANCE, long int MaxIter=LM_DEF_MAX_ITER)
 Solves an overdetermined system f(x) = 0 of m non-linear equations with n parameters using the Levenberg-Marquardt algorithm. More...
 
long int LevenbergMarquardtExtended (minpack_funcder_mn fun, void *p, long int m, long int n, Vector< double > &InitialGuess, Vector< double > &Result, double Tolerance=MINPACK_DEF_TOLERANCE, long int MaxIter=LM_DEF_MAX_ITER)
 Solves an overdetermined system f(x) = 0 of m non-linear equations with n parameters using the extended Levenberg-Marquardt algorithm. More...
 
long int LevenbergMarquardtExtended (minpack_func_mn fun, void *p, long int M, long int N, Vector< double > &InitialGuess, Vector< double > &Result, double EpsilonFun=LM_DEF_EPSILON, double Tolerance=MINPACK_DEF_TOLERANCE, long int MaxIter=LM_DEF_MAX_ITER, double *ResultingJacobian=NULL, int *ipvt=NULL, double *SumOfSquaredErrors=NULL)
 Solves an overdetermined system f(x) = 0 of m non-linear equations with n parameters using the Levenberg-Marquardt algorithm. More...
 
void * listenthread (void *data)
 these are wrapper to comply to the pthread_create() interface More...
 
template<class T >
int LoadBogK (const std::string &filename, Matrix3x3< T > &mat)
 
template<class T >
int LoadBogRC (const std::string &filename, Matrix3x3< T > &mat)
 
void MouseButtonFunc_ (int button, int state, int x, int y)
 
void MouseMotionFunc_ (int x, int y)
 
void MousePassiveMotionFunc_ (int x, int y)
 
int MxArrToBIASMatrix (const mxArray *mxMat, BIAS::Matrix< double > &mat)
 Convert MATLAB-array to BIAS::Matrix. More...
 
int MxArrToBIASVector (const mxArray *mxVec, BIAS::Vector< double > &vec)
 Convert MATLAB-array to BIAS::Vector. More...
 
std::string NodeType2String (const enum eNodeType &t)
 
template<class T >
DualQuaternion< T > operator* (const DualQuaternion< T > &l, const T &scalar)
 
SimilarityTransform operator* (SimilarityTransform &arg1, SimilarityTransform &arg2)
 
BIAS::Vector3< double > operator* (const SimilarityTransform &arg1, const BIAS::Vector3< double > &vec)
 
Polynom operator* (const Polynom &a, const Polynom &b)
 
Polynom operator* (const double &d, const Polynom &a)
 
Polynom operator* (const Polynom &a, const double &d)
 
template<class T >
Vector2< T > & operator*= (Vector2< T > &vec, const T &scalar)
 Multiplication operator with scalar argument. More...
 
template<class T >
DualQuaternion< T > operator+ (const DualQuaternion< T > &l, const DualQuaternion< T > &r)
 
template<class T >
Vector2< T > operator+ (const Vector2< T > &vec, const T &scalar)
 Addition operator with scalar argument, returning new vector. More...
 
template<class T >
Vector2< T > operator+ (const T &scalar, const Vector2< T > &vec)
 Addition operator with scalar argument, returning new vector. More...
 
Polynom operator+ (const Polynom &a, const Polynom &b)
 
template<class T >
BIASMathBase_EXPORT Vector2< T > & operator+= (Vector2< T > &vec, const Vector2< T > &argvec)
 add operator for two Vectors More...
 
template<class T >
Vector2< T > & operator+= (Vector2< T > &vec, const T &scalar)
 Addition operator with scalar argument. More...
 
template<class T >
DualQuaternion< T > operator- (const DualQuaternion< T > &l, const DualQuaternion< T > &r)
 
Polynom operator- (const Polynom &a, const Polynom &b)
 
template<class T >
Vector2< T > & operator-= (Vector2< T > &vec, const Vector2< T > &argvec)
 sub operator for two Vectors More...
 
template<class T >
Vector2< T > & operator-= (Vector2< T > &vec, const T &scalar)
 Substraction operator with scalar argument. More...
 
template<class T >
DualQuaternion< T > operator/ (const DualQuaternion< T > &l, const T &scalar)
 
Polynom operator/ (const Polynom &a, const double &d)
 
Polynom operator/ (const Polynom &a, const Polynom &b)
 
template<class T >
BIASMathBase_EXPORT Vector2< T > & operator/= (Vector2< T > &vec, const Vector2< T > &argvec)
 elementwise division More...
 
template<class T >
Vector2< T > & operator/= (Vector2< T > &vec, const T &scalar)
 Division operator with scalar argument. More...
 
bool operator< (const BIAS::Polynom &p1, const BIAS::Polynom &p2)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const Array2D< T > &arg)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const SparseArray2D< T > &t)
 
BIASImageBase_EXPORT std::ostream & operator<< (std::ostream &os, const enum ERoiType &type)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const Matrix3x3< T > &mat)
 
template<class BaseClassType , class TagType >
std::ostream & operator<< (std::ostream &os, const BaseFactory< BaseClassType, TagType > &bf)
 
std::ostream & operator<< (std::ostream &os, const Feat &f)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const SharedPtr< T > &t)
 
std::ostream & operator<< (std::ostream &os, const enum ETrackerResult &res)
 
std::ostream & operator<< (std::ostream &os, const enum ERejectionType &rt)
 
BIASGeometryBase_EXPORT
std::ostream & 
operator<< (std::ostream &os, const RParametrization &p)
 
std::ostream & operator<< (std::ostream &os, const osg::Matrix &m)
 stream operator for osg matrix (woelk 10/2009) More...
 
std::ostream & operator<< (std::ostream &os, const osg::Vec3 &v)
 stream operator for osg vector (woelk 10/2009) More...
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersBufferedRay &p)
 
BIASUtils_EXPORT std::ostream & operator<< (std::ostream &os, const MatchDataBase &m)
 
BIASGeometryBase_EXPORT
std::ostream & 
operator<< (std::ostream &os, const PoseParametrization &p)
 
BIASUtils_EXPORT std::ostream & operator<< (std::ostream &os, const GenSynthMatchesRig &m)
 Prints the contained GenSynthMatches objects to the given ostream. More...
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersOrthographic &p)
 
BIASCommon_EXPORT std::ostream & operator<< (std::ostream &os, const BIAS::TimeStamp &ts)
 Standard output operator for TimeStamps. More...
 
BIASGeometryBase_EXPORT
std::ostream & 
operator<< (std::ostream &os, const EParametrization &p)
 
std::ostream & operator<< (std::ostream &os, const SimilarityTransform &p)
 
template<class T >
BIASMathBase_EXPORT std::ostream & operator<< (std::ostream &os, const SymmetricMatrix3x3< T > &mat)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersSphericalSimple &p)
 
std::ostream & operator<< (std::ostream &stream, const BIAS::SparseMatrix &matrix)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersGreatCircles &p)
 
std::ostream & operator<< (std::ostream &s, const BIAS::Polynom &p)
 
std::ostream & operator<< (std::ostream &os, const Pose &p)
 Write pose transformation to stream. More...
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersZoom &p)
 
std::ostream & operator<< (std::ostream &os, Conic2D::ConicType &t)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersCylindric &p)
 
BIASGeometryBase_EXPORT
std::ostream & 
operator<< (std::ostream &os, const enum HomgPoint2D::EPosition pos)
 
std::ostream & operator<< (std::ostream &os, const CoordinateTransform3D &p)
 Write 3d coordinate transformation to stream. More...
 
BIASUtils_EXPORT std::ostream & operator<< (std::ostream &os, const GenSynthMatches &m)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersProjective &p)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersPerspectiveDepth &p)
 
BIASImageBase_EXPORT std::ostream & operator<< (std::ostream &os, const ROI &roi)
 human readable output operator for ROI, mainly for debugging More...
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersSphericalFast &p)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersSpherical &p)
 
std::ostream & operator<< (std::ostream &os, const Projection &p)
 
std::ostream & operator<< (std::ostream &os, const BIAS::Vector< char > &vec)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const BIAS::Vector< T > &vec)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersDynamicLoad &p)
 
std::ostream & operator<< (std::ostream &os, const Vector2< unsigned char > &vec)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersPerspective &p)
 
std::ostream & operator<< (std::ostream &os, const Vector4< char > &vec)
 
std::ostream & operator<< (std::ostream &os, const ProjectionParametersBase &p)
 
std::ostream & operator<< (std::ostream &os, const BIAS::Vector3< char > &vec)
 
std::ostream & operator<< (std::ostream &os, const ImageBase &img2)
 
std::ostream & operator<< (std::ostream &os, const ImageBase::EStorageType &st)
 
std::ostream & operator<< (std::ostream &os, const ImageBase::EColorModel &st)
 
bool operator> (const BIAS::Polynom &p1, const BIAS::Polynom &p2)
 
template<class T >
std::istream & operator>> (std::istream &is, Matrix3x3< T > &mat)
 
BIASGeometryBase_EXPORT
std::istream & 
operator>> (std::istream &is, RParametrization &p)
 
BIASUtils_EXPORT std::istream & operator>> (std::istream &is, MatchDataBase &m)
 
BIASGeometryBase_EXPORT
std::istream & 
operator>> (std::istream &is, PoseParametrization &p)
 
BIASCommon_EXPORT std::istream & operator>> (std::istream &is, BIAS::TimeStamp &ts)
 Standard input operator for TimeStamps. More...
 
BIASGeometryBase_EXPORT
std::istream & 
operator>> (std::istream &is, EParametrization &p)
 
std::istream & operator>> (std::istream &is, SimilarityTransform &p)
 
template<class T >
BIASMathBase_EXPORT std::istream & operator>> (std::istream &is, SymmetricMatrix3x3< T > &mat)
 
std::istream & operator>> (std::istream &s, BIAS::Polynom &p)
 
std::istream & operator>> (std::istream &is, Pose &p)
 Read pose transformation from stream. More...
 
std::istream & operator>> (std::istream &is, CoordinateTransform3D &p)
 Read 3d coordinate transformation from stream. More...
 
std::istream & operator>> (std::istream &is, Vector2< unsigned char > &vec)
 
std::istream & operator>> (std::istream &is, Vector4< char > &vec)
 
std::istream & operator>> (std::istream &is, Vector3< char > &vec)
 
std::istream & operator>> (std::istream &is, BIAS::ImageBase &img)
 
long int Powell (minpack_func_nn fun, void *p, Vector< double > &InitialGuess, Vector< double > &Result, double Tolerance=MINPACK_DEF_TOLERANCE)
 Solve a system f(x) = 0 of n non-linear equations with n unknowns using the Powell hybrid method. More...
 
long int PowellExtended (minpack_func_nn fun, void *p, Vector< double > &InitialGuess, Vector< double > &Result, double EpsilonFun=LM_DEF_EPSILON, double Tolerance=MINPACK_DEF_TOLERANCE)
 Solve a system f(n) = 0 of n non-linear equations with n unknowns using the Powell hybrid method. More...
 
void QRFrac (const Matrix< double > &A, Matrix< double > &Q, Matrix< double > &R)
 Compute the QR decomposition of input matrix A using Householder transformations without column pivoting. More...
 
double Realtime (void)
 
double realtime_ (void)
 
void * receivethread (void *data)
 these are wrapper to comply to the pthread_create() interface More...
 
template<class T >
unsigned RefCount (const SharedPtr< T > &t)
 
void Render_ ()
 
void Reshape_ (int width, int height)
 
int BIASVideoSource_EXPORT ScanBus (std::stringstream &ofs)
 support function to get the number of cameras and IDs of all cameras on one bus More...
 
int BIASVideoSource_EXPORT ScanBus (std::vector< CameraInfo > &camInfos)
 
void sincos (const float xRad, float &s, float &c)
 computes sin and cosinus with float precision More...
 
void sincos (const double xRad, double &s, double &c)
 
void SpecialKeyFunc_ (int key, int x, int y)
 
void SpecialKeyUpFunc_ (int key, int x, int y)
 
void StandardKeyFunc_ (unsigned char key, int x, int y)
 
void StandardKeyUpFunc_ (unsigned char key, int x, int y)
 
enum eNodeType String2NodeType (const std::string &val)
 
BIASOpenGLFramework_EXPORT void SwapGLObjects (glfTexture &A, glfTexture &B)
 
void VideoCallback (freenect_device *dev, void *rgb, uint32_t timestamp)
 
void WhenIdle_ ()
 

Variables

const int attribsRGBAD []
 
 helper to simplify setting up format "red,green,blue,alpha,depth" JW

to be used as (int*)&attribsRGBAD JW More...

 
const int attribsRGBASD []
 
   helper to simplify setting up format "red,green,blue,alpha,stencil,depth" JW

to be used as (int*)&attribsRGBASD JW More...

 
template<class T >
class BIASVideoSource_EXPORT Camera
 
int capMode_
 
template class
BIASOpenCLFramework_EXPORT 
clfFilter< float, float >
 
template class
BIASOpenCLFramework_EXPORT 
clfFilter< unsigned char, unsigned char >
 
template class
BIASOpenCLFramework_EXPORT 
clfGauss< float, float >
 
template class
BIASOpenCLFramework_EXPORT 
clfGradientGauss< float, float >
 
pthread_mutex_t coloravail_mutex = PTHREAD_MUTEX_INITIALIZER
 
freenect_video_format current_format = FREENECT_VIDEO_BAYER
 
template class BIASImage_EXPORT CylindricalRectification< char, char >
 
template class BIASImage_EXPORT CylindricalRectification< double, double >
 
template class BIASImage_EXPORT CylindricalRectification< float, float >
 
template class BIASImage_EXPORT CylindricalRectification< float, unsigned char >
 
template class BIASImage_EXPORT CylindricalRectification< int, int >
 
template class BIASImage_EXPORT CylindricalRectification< short, short >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned char, char >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned char, float >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned char, unsigned char >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned short, float >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned short, int >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned short, short >
 
template class BIASImage_EXPORT CylindricalRectification< unsigned short, unsigned short >
 
float * depth_front
 
float * depth_mid
 
pthread_mutex_t depthavail_mutex = PTHREAD_MUTEX_INITIALIZER
 
BIAS::Image< float > * depthLookupTable_
 
volatile int die = 0
 
int edgeTable [256]
 
template class BIASImage_EXPORT FFT2D_free< float >
 
template class BIASImage_EXPORT FFT2D_free< short >
 
template class BIASImage_EXPORT FFT2D_free< unsigned char >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< char, char >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< char, float >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< double, double >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< float, float >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< int, float >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< int, int >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< short, short >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned char, char >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned char, float >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned char, int >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned char, unsigned char >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned char, unsigned short >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned int, unsigned int >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned short, float >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned short, int >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned short, short >
 
template class BIASFilter_EXPORT FILTER_INSTANTIATION_CLASS< unsigned short, unsigned short >
 
class BIASGeometry_EXPORT FMatrix
 
pthread_t freenect_thread
 
freenect_context * freenectContext_ = NULL
 
freenect_device * freenectDevice_ = NULL
 
pthread_mutex_t gl_backbuf_mutex = PTHREAD_MUTEX_INITIALIZER
 
pthread_cond_t gl_frame_cond = PTHREAD_COND_INITIALIZER
 
class BIASGLviewer_EXPORT GLProjectionParametersInterface
 
int got_depth = 0
 
int got_rgb = 0
 
class BIASGui_EXPORT GuiWXApp
 
class BIASGui_EXPORT GuiWXFrame
 
class BIASGeometryBase_EXPORT HomgPoint2D
 
class BIASGeometryBase_EXPORT HomgPoint2DCov
 
class BIASGeometryBase_EXPORT HomgPoint3D
 
class BIASGeometryBase_EXPORT HomgPoint3DCov
 
template<class StorageType >
class BIASImageBase_EXPORT Image
 
class BIASImageBase_EXPORT ImageConvert
 
float lookup_ [2048]
 
template<class T >
class BIASMathBase_EXPORT Matrix
 
template<class T >
class BIASMathBase_EXPORT Matrix2x2
 
template<class T >
class BIASMathBase_EXPORT Matrix2x3
 
template<class T >
class BIASMathBase_EXPORT Matrix3x2
 
template<class T >
class BIASMathBase_EXPORT Matrix3x3
 
template<class T >
class BIASMathBase_EXPORT Matrix3x4
 
template<class T >
class BIASMathBase_EXPORT Matrix4x4
 
const float maxGain = 29.0f
 
const int maxMessageNumber = 10000000
 
const float maxShutter = 0.034f
 
const float minGain = 0.1f
 
const float minShutter = 0.01f
 
pthread_cond_t newColorAvail_ = PTHREAD_COND_INITIALIZER
 
pthread_cond_t newDepthAvail_ = PTHREAD_COND_INITIALIZER
 
static std::string NodeTypeXMLStrings []
 
static unsigned nrOfReflectivityParameters_ =4
 
static unsigned nrOfSplineParameters_ =12
 
class BIASUtils_EXPORT ParamCallbackInterface
 
class BIASGui_EXPORT ParamGUI
 
template class BIASImage_EXPORT PlanarRectification< char, char >
 
template class BIASImage_EXPORT PlanarRectification< double, double >
 
template class BIASImage_EXPORT PlanarRectification< float, float >
 
template class BIASImage_EXPORT PlanarRectification< float, unsigned char >
 
template class BIASImage_EXPORT PlanarRectification< int, int >
 
template class BIASImage_EXPORT PlanarRectification< short, short >
 
template class BIASImage_EXPORT PlanarRectification< unsigned char, char >
 
template class BIASImage_EXPORT PlanarRectification< unsigned char, float >
 
template class BIASImage_EXPORT PlanarRectification< unsigned char, unsigned char >
 
template class BIASImage_EXPORT PlanarRectification< unsigned short, float >
 
template class BIASImage_EXPORT PlanarRectification< unsigned short, int >
 
template class BIASImage_EXPORT PlanarRectification< unsigned short, short >
 
template class BIASImage_EXPORT PlanarRectification< unsigned short, unsigned short >
 
class BIASGeometry_EXPORT PMatrix
 
class BIASGeometry_EXPORT Pose
 
class BIASCommon_EXPORT ProgressSemaphore
 
class BIASGeometry_EXPORT ProjectionParametersBase
 
template<class T >
class BIASGeometryBase_EXPORT Quaternion
 
class BIASGLviewer_EXPORT RenderContextBase
 
freenect_video_format requested_format = FREENECT_VIDEO_BAYER
 
unsigned char * rgb_back
 
unsigned char * rgb_front
 
unsigned char * rgb_mid
 
class BIASGeometryBase_EXPORT RMatrixBase
 
class BIASGLviewer_EXPORT SceneBGImage
 
bool SingletonDebugOutput_ = false
 This variable is defined in Singleton.cpp and steers the debug output of all Singleton classes. More...
 
bool switch_
 
template<class T >
class BIASMathBase_EXPORT SymmetricMatrix3x3
 
template class BIASMatcher2D_EXPORT TrackerBaseAffine2< float >
 
template class BIASMatcher2D_EXPORT TrackerBaseAffine2< unsigned char >
 
template class BIASMatcher2D_EXPORT TrackerBaseAffine< float >
 
template class BIASMatcher2D_EXPORT TrackerBaseAffine< unsigned char >
 
template class BIASMatcher2D_EXPORT TrackerBaseHomography< float >
 
template class BIASMatcher2D_EXPORT TrackerBaseHomography< unsigned char >
 
int triTable [256][16]
 
const int UDP_PACKAGE_SIZE = 40000
 
class BIASImageBase_EXPORT UUID
 forward declaration for stream operators More...
 
template<class T >
class BIASMathBase_EXPORT Vector
 
template<class T >
class BIASMathBase_EXPORT Vector2
 
template<class T >
class BIASMathBase_EXPORT Vector3
 
template<class T >
class BIASMathBase_EXPORT Vector4
 
class BIASVideoSource_EXPORT VideoSourceCapabilities
 

Detailed Description

This file is part of the BIAS library (Basic ImageAlgorithmS).

Class wxMessageDialogCheckbox.

See the LICENSE file for license.

Typedef Documentation

typedef std::map<std::string, cl::Kernel> BIAS::cl_kernel_map

Definition at line 39 of file clfProgram.hh.

typedef struct cornerstruct BIAS::CORNER_LIST[MAX_CORNERS]

Definition at line 214 of file CornerDetectorSusan.hh.

typedef struct BIAS::Edge_s BIAS::Edge

Struct for easier handling of edges.

Definition at line 35 of file glfPBuffer.hh.

typedef ProjectionParametersBase*(* BIAS::maker_t)()

Definition at line 38 of file ProjectionParametersDynamicLoad.hh.

typedef std::vector<BIAS::Vector2<unsigned int> > BIAS::PointQueue

Definition at line 13 of file BlobDetectorBFS.hh.

typedef BIAS::Vector4<double> BIAS::RGBAd

Definition at line 59 of file RGBA.hh.

typedef BIAS::Vector4<float> BIAS::RGBAf

Definition at line 53 of file RGBA.hh.

typedef BIAS::Vector4<unsigned char> BIAS::RGBAuc
typedef BIAS::Vector3<double> BIAS::RGBd

Definition at line 28 of file RGB.hh.

typedef BIAS::Vector3<float> BIAS::RGBf

Definition at line 22 of file RGB.hh.

typedef BIAS::Vector3<unsigned char> BIAS::RGBuc

Definition at line 16 of file RGB.hh.

typedef void(* BIAS::SampleGrabberCBF)(double time_sec)

Definition at line 11 of file SampleGrabberCallback.hh.

typedef std::vector< std::pair< float, float > > BIAS::t_CoordVecf

helper vector of coordinates

Compatibility definition to provide the same interface as CheckerboardDetector.

Definition at line 42 of file CheckerboardDetector.hh.

Definition at line 60 of file PanTiltSoftMotion.hh.

Enumeration Type Documentation

anonymous enum
Enumerator
ID_Quit 
ID_Timer 
ID_Grab 
ID_GrabContinuous 
ID_Key 
ID_Show1 
ID_Show2 
ID_Show3 
ID_Show4 
ID_Show5 
ID_Show6 
ID_Show7 
ID_Show8 
ID_Show9 
ID_Show_FL 
ID_Controller 

Definition at line 70 of file ExampleMixtureOfGaussians.hh.

anonymous enum
Enumerator
ID_LEFT 
ID_RIGHT 
ID_UP 
ID_DOWN 
ID_RESET 
ID_DPQUIT 
ID_DPControl 
ID_RESETFULL 
ID_AUTO 

Definition at line 6 of file DPPanTiltControlDialog.hh.

anonymous enum
Enumerator
ID_About 
ID_Exit 
ID_Next 
ID_Prev 
ID_Save 
ID_Invalid 
ID_Help 
ID_RescaleImage 

Definition at line 62 of file biasClickImageCornersWx.cpp.

anonymous enum
Enumerator
ID_Timer 
ID_Grab 
ID_GrabContinuous 
ID_GrabToStream 
ID_Key 
ID_Fit 
ID_CAMERAS_LISTBOX 
ID_SPLITTER_WINDOW 
ID_HIDE_CAMERALIST 
ID_SHOW_CAMERALIST 
ID_KeepScroll 
ID_Show1 
ID_Show2 
ID_Show3 
ID_Show4 
ID_Show5 
ID_Show6 
ID_Show7 
ID_Show8 
ID_Show9 
ID_SaveParameters 
ID_ShowParameters 
ID_Controller 
ID_Paramframe 
ID_Disable 
ID_Frame1 
ID_Frame2 
ID_FindIEEE1394 
ID_FindUEYE 
ID_FindSwissranger 
ID_FindZess 
ID_FindPMDTec 
ID_FindWebcams 
ID_FindKinect 
ID_FindOpenNI 
ID_FindKinect2 
ID_OpenFlirController 
ID_OpenViscaController 
ID_OpenDPController 

Definition at line 126 of file ShowCamWxFrame.hh.

anonymous enum
Enumerator
ID_Quit 
ID_BUTTON_QUIT 
ID_TIMER 

Definition at line 79 of file GuiWX.hh.

methods for conversion from bayer to rgb

Enumerator
BAYER_DEMOSAIC_METHOD_NEAREST 
BAYER_DEMOSAIC_METHOD_SIMPLE 
BAYER_DEMOSAIC_METHOD_BILINEAR 
BAYER_DEMOSAIC_METHOD_HQLINEAR 
BAYER_DEMOSAIC_METHOD_VNG 
BAYER_DEMOSAIC_METHOD_AHD 

Definition at line 70 of file ImageConvert.hh.

the type of deinterlacing: BIAS_DI_121 : calculate new pixel from old neighbouring pixels with new = (old1+2*old2+old3)/4 BIAS_DI_22 : calculate new pixel from old neighbouring pixels with new = (old1+old2)/2

Enumerator
BIAS_DI_121 
BIAS_DI_22 

Definition at line 41 of file DeInterlace.hh.

Enumerator
BIAS_LOG_NONE 
BIAS_LOG_FATAL 
BIAS_LOG_WARNING 
BIAS_LOG_INFO 
BIAS_LOG_DEBUG 

Definition at line 112 of file LogFacility.hh.

Enumerator
DISTYPE_RADIAL 
DISTYPE_DEF 
DISTYPE_BROWN 
DISTYPE_NONE 
DISTYPE_INVERSE_RAD 
DISTYPE_RAD3 
DISTYPE_INVRAD3 

Definition at line 41 of file ProjectionParametersPerspective.hh.

Enumerator
DEPTH_MODEL_UNDEFINED 
DEPTH_MODEL_POLYNOM 
DEPTH_MODEL_LINEAR 
DEPTH_MODEL_SPLINE 
DEPTH_MODEL_NONE 

Definition at line 39 of file ProjectionParametersPerspectiveDepth.hh.

different styles when drawing cameras, e.g.

in GL or VRML

Enumerator
PyramidMesh 
PyramidSolid 
Arrow 
PyramidMeshWithArrow 
PyramidWithCenterBox 
Undrawn 

Definition at line 294 of file ThreeDOut.hh.

Enumeration for the known IEEE1394 camera models Only used internally in VideoSource_DCAM.

Enumerator
CAMERA_SONY_DFW_X700 
CAMERA_SONY_DFW_V500 
CAMERA_PTGREY_DRAGONFLY_COLOR 
CAMERA_PTGREY_DRAGONFLY_HIRES 
CAMERA_PTGREY_DRAGONFLY_BW 
CAMERA_PTGREY_DRAGONFLY2_COLOR_HIRES 
CAMERA_PTGREY_SCORPION_COLOR_1600 
CAMERA_PTGREY_FIREFLY_COLOR 
CAMERA_PTGREY_FIREFLY_BW 
CAMERA_PTGREY_GRASSHOPPER_COLOR 
CAMERA_PTGREY_FLEA2_BW 
CAMERA_PTGREY_BUMBLEBEE_XB3 
CAMERA_SONY_EVID31 
CAMERA_SONY_DV 
CAMERA_UNIBRAIN_FIREI 
CAMERA_NET_FO323SC 
CAMERA_KAMERAWERK_DRESDEN_LOGILUX_I5 
CAMERA_PTGREY_BUMBLEBEE_XB2 
CAMERA_UNKNOWN 

Definition at line 167 of file VideoSource_DCAM.hh.

Enumerator
LOWER_LEFT 
LOWER_RIGHT 
UPPER_RIGHT 
UPPER_LEFT 
OPTICAL_CENTER 

Definition at line 41 of file GeometryGL.hh.

Enumerator
MONO 
STEREO_UNTOUCHED 
STEREO_CONSUMER_NV 
STEREO_QUADBUFFERED 
STEREO_LEFT_RIGHT 
STEREO_TWOSCREENS 

Definition at line 20 of file RenderModeGL.hh.

Enumerator
CS_NONE 
CS_STRING 
CS_FLOAT 
CS_INT 
CS_BINARY 

Definition at line 36 of file CScommClasses.hh.

different gradients to be used by hiogher level classes

  • GT_Sobel3x3 gradient using 3x3 sobelx and sobely filters
  • GT_Gauss gradient using derivatives of gauss with square kernel
  • GT_GaussAsymmetric gradient using derivatives of gauss
Enumerator
GT_Simple 
GT_Sobel3x3 
GT_Gauss 
GT_GaussAsymmetric 

Definition at line 43 of file FilterBase.hh.

Enumerator
eNT_Default 
eNT_FromDisk 
eNT_FromImageFile 
eNT_Marker 
eNT_Light 
eNT_PointCloud 
eNT_BBox 
eNT_VNTriMesh 

Definition at line 16 of file NodeInfo.hh.

Enumerator
RT_Invalid 
RT_MAD 
RT_X84 
RT_X84M 

Definition at line 48 of file TrackerBaseInterface.hh.

Enumerator
ROI_Corners 
ROI_Mask 
ROI_Points 
ROI_Rows 

Definition at line 40 of file ROI.hh.

Enumerator
TRACKER_SUCCESS 

success (error < maxerror)

TRACKER_NOSTRUCTURE 

no spatial structure is present

TRACKER_OUTOFIMAGE 

point slid out of image

TRACKER_TOOMANYITER 

maxiter is reached and error is above maxerror

TRACKER_OUTOFROI 

a point lies outside of valid region in images

TRACKER_MEANABSDIF 

point was rejected by MAD criterion

TRACKER_IGNOREPOINT 

input point was at infinity

TRACKER_X84 

point is rejected by X84/X84M

TRACKER_ODDAFFINEWARP 

affine warp seems degenerated

TRACKER_ERRORINCREASED 

error increased from last iteration

Definition at line 50 of file TrackerBaseInterface.hh.

defines type or combination of tracker(s) used: simple/weighted estimate a dx,dy, Affine estimate an affine transformation

Enumerator
TT_Invalid 
TT_Simple 
TT_SimpleWeighted 
TT_SimpleMasked 
TT_Similar 
TT_Affine 
TT_Weighted1D 
TT_Affine2 
TT_Homography 

Definition at line 58 of file Tracker.hh.

Enumerator
NONE 
Quat2EulerZYX 
EulerZYX2Quat 
PoseTransform 
Point3DTransform 

Definition at line 15 of file CovTransformPose.hh.

Enumerator
NORMAL 
SMB 

Definition at line 38 of file VideoSource_PMD.hh.

all non-standard IDs related to this dialog – classes inherited from this included and all classes that use this class – should be entered here to decrease conflict possibilities.

Enumerator
ID_WIN_GAUSS 
ID_WIN_MEAN 
ID_WIN_GRADIENT_SOBEL_3X3 
ID_WIN_MEDIAN 
ID_WIN_RESCALE 
ID_WIN_CANNY_EDGE 
ID_WIN_PREVIEW 
ID_PANEL_DOUBLE_VAL 
ID_WIN_BVWX_MAINFRAME 
ID_WIN_IMAGECANVAS_UC 
ID_WIN_IMAGECANVAS_FL 
ID_BTN_FILTER_FDB 
ID_BTN_PREVIEW_FDB 
ID_BTN_RESET_FDB 
ID_WIN_FILTER 

Definition at line 237 of file FilterDialogBase.hh.

Enumerator
DS_POINT_1 
DS_POINT_2 
DS_POINT_3 
DS_POINT_4 
DS_POINT_5 
DS_LINE 

Definition at line 37 of file GraphPlotter.hh.

Enumerator
HIST_POINTS 
HIST_BARS 
HIST_LINES 

Definition at line 42 of file HistogramImage.hh.

accuracy for resampling

Trilinear averages different pyramid levels based on a local isotropic sampling frequency Anisotropic is the most expensive and uses the local jacobian for anti-aliasing, while preserving texture direction which need no smoothing

Enumerator
InterpolationMethod_UNKNOWN 
MapNearestNeighbor 
MapBilinear 
MapBicubic 
MapTrilinear 
MapAnisotropic 
Examples:
ExampleCylinderMapping.cpp.

Definition at line 39 of file BackwardMappingLUTStructs.hh.

Enumerator
NearestNeighbour 
Bilinear 
Bicubic 

Definition at line 40 of file Rescale.hh.

Enumeration for the known lenses for IEEE1394 cameras Only used internally in VideoSource_DCAM.

Enumerator
LENS_SONY_EVID31_BUILTIN 
LENS_SONY_DV_BUILTIN 
LENS_PENTAX_CMOUNT_4_8 
LENS_PENTAX_CMOUNT_8_0 
LENS_PENTAX_CMOUNT_4_2 
LENS_UNKNOWN 

Definition at line 195 of file VideoSource_DCAM.hh.

Enumerator
Solid 
Dashed 

Definition at line 303 of file ThreeDOut.hh.

determines which lowpass filter is used before subsampling

  • LPT_Mean use non-weighted mean across a window
  • LPT_Gauss weight (in a window) with gaussian function
  • LPT_GaussThreshold same as Gauss but does not concerne values under a specified threshold
Enumerator
LPT_Mean 
LPT_Gauss 
LPT_Binomial 
LPT_GaussThreshold 

Definition at line 51 of file FilterBase.hh.

can be passed to matrix constructors to init the matrix with the most often used values

Enumerator
MatrixZero 
MatrixIdentity 

Definition at line 59 of file Matrix.hh.

Enumerator
MOG_RGB 
MOG_RGBD 
MOG_NRGB 
MOG_NRGBD 
MOG_HS 
MOG_HSD 

Definition at line 41 of file MixtureOfGaussians.hh.

Enumerator
modeAxis1 
modeAxis2 
modeAxis3 

Definition at line 41 of file CameraViewController.hh.

Enumerator
PMD_1K 
PMD_3K 
MultiCam_3K 
MultiCam_19K 
NoPMD 

Definition at line 40 of file VideoSource_PMDZess.hh.

Enumerator
POINT_SIMPLE 
POINT_SPLATTING 
POINT_LIGHTFIELD 
POINT_QUADTREE 
POINT_ZBUFFER 
POINT_PROPABILITY 
POINT_MESHED 

Definition at line 45 of file SceneBase.hh.

different styles when drawing points, e.g.

different styles when drawing lines, e.g.

in GL or VRML

Enumerator
Point 
PointSprite 
Sphere 
Box 

Definition at line 299 of file ThreeDOut.hh.

Enumerator
ID_Scale 
ID_Offset 
ID_Scale_L 
ID_Scale_R 
ID_Scale_Steps 
ID_Offset_L 
ID_Offset_R 
ID_Offset_Steps 
ID_Check_Auto_Sc_Of 

Definition at line 13 of file ScaledImageCanvas.cpp.

Enumerator
SPPM_NoParity 
SPPM_EvenParity 
SPPM_OddParity 
SPPM_SpaceParity 

Definition at line 44 of file SerialPortIO.hh.

direction of line if start is in coordinate origin as given by compass

Enumerator
LT_Invalid 
E_NE 
NE_N 
N_NW 
NW_W 
W_SW 
SW_S 
S_SE 
SE_E 

Definition at line 45 of file EightWaySymmetry.hh.

Enumerator
TRIANGLE_SIMPLE 
TRIANGLE_SPLATTING 

Definition at line 55 of file SceneBase.hh.

Function Documentation

wxString BIAS::AsciiToWx ( const char *  thestring)
inline

Converts a C string to a wxString.

Please note the existing wx macros _ and _T/wxT, too

Examples:
ExampleContextWx.cpp, and ExampleMixtureOfGaussians.cpp.

Definition at line 32 of file StringConv.hh.

Referenced by BIAS::ParamGUIPanel::AddBoolWidgets(), BIAS::ParamGUIPanel::AddDoubleWidgets(), BIAS::ParamGUIPanel::AddEnumWidgets(), BIAS::ShowCamWxFrame::AddIEEECameraToMenu(), BIAS::ParamGUIPanel::AddIntWidgets(), BIAS::ParamGUIPanel::AddStringWidgets(), BIAS::ShowCamWxFrame::AddUEyeCameraToMenu(), BIAS::ParamGUIPanel::AddVecDblWidgets(), BIAS::ParamGUIPanel::AddVecIntWidgets(), BIAS::ShowCamWxFrame::AddWebcamToMenu(), BIAS::ParamGUI::GetNotebook(), BIAS::DrawTextWx< StorageType >::GetTextExtend(), BIAS::ShowCamWxFrame::InitCamera(), BIAS::BVWXMainFrame::LoadImageFromList(), BIAS::BVWXMainFrame::LoadImages(), BIAS::BVWXMainFrame::OnAbout(), BIAS::ShowCamWxFrame::OnAbout(), wxTauControlFrame::OnAlgorithm(), BIAS::BVWXMainFrame::OnChangeChannel_1(), BIAS::BVWXMainFrame::OnChangeChannel_2(), BIAS::BVWXMainFrame::OnChangeChannel_3(), BIAS::BVWXMainFrame::OnChangeChannel_4(), BIAS::BVWXMainFrame::OnChangeChannel_5(), BIAS::BVWXMainFrame::OnChangeChannel_6(), BIAS::BVWXMainFrame::OnChangeChannel_7(), BIAS::BVWXMainFrame::OnChangeChannel_ALL(), BIAS::ShowCamWxFrame::OnChangeVideoMode(), BIAS::OpenGLCanvasBase::OnChar(), BIAS::wxViscaControlPanel::OnConnect(), wxTauControlFrame::OnConnect(), BIAS::wxViscaControlPanelButtons::OnConnect(), BIAS::wxViscaControlPanelButtons::OnDown(), BIAS::wxViscaControlPanelButtons::OnDownLeft(), BIAS::wxViscaControlPanelButtons::OnDownRight(), BIAS::dndFileTarget::OnDropFiles(), wxTauControlFrame::OnExternalSync(), BIAS::ShowCamWxFrame::OnFindIEEE1394(), BIAS::ShowCamWxFrame::OnFindPMDTec(), BIAS::ShowCamWxFrame::OnFindSwissRanger(), BIAS::ShowCamWxFrame::OnFindWebcams(), wxTauControlFrame::OnGainMode(), wxTauControlFrame::OnGetSpotMeterValue(), BIAS::BVWXMainFrame::OnHistogramm(), BIAS::BVWXMainFrame::OnImageValueBar(), BIAS::BVWXMainFrame::OnImageValues(), BIAS::BVWXMainFrame::OnInfo(), BIAS::wxViscaControlPanelButtons::OnLeft(), BIAS::BVWXMainFrame::OnMetaData(), wxTauControlFrame::OnOrientation(), wxTauControlFrame::OnPolarity(), wxTauControlFrame::OnReset(), BIAS::wxViscaControlPanelButtons::OnRight(), BIAS::ImageLegendFrame::OnSave(), BIAS::BVWXMainFrame::OnSaveAs(), BIAS::BVWXMainFrame::OnSaveAsMovie(), BIAS::BVWXMainFrame::OnSaveCurrent(), BIAS::BVWXMainFrame::OnSaveList(), wxTauControlFrame::OnSetSpotMeterMode(), wxTauControlFrame::OnSpotMeterDisplay(), BIAS::VideoSource_Controller_Kinect::OnTimer(), BIAS::wxViscaControlPanelButtons::OnUp(), BIAS::wxViscaControlPanelButtons::OnUpLeft(), BIAS::wxViscaControlPanelButtons::OnUpRight(), wxTauControlFrame::OnVideoStandard(), wxTauControlFrame::OnZoom(), BIAS::ShowCamWxFrame::OpenDevice(), BIAS::BVWXMainFrame::PrintConversionError(), BIAS::BVWXMainFrame::PrintSavingError(), BIAS::ScaledImageCanvas::ScaledImageCanvas(), BIAS::wxMatrixPanel::SetMatrix(), BIAS::ScaledImageCanvas::SetNiceRanges(), BIAS::wxProjectionPanel::SetProjection(), BIAS::ScaledImageCanvas::SetRanges(), BIAS::ScaledImageCanvas::SetStatusText(), BIAS::GuiWXFrame::SetTitle(), BIAS::ImageLegendFrame::Setup(), BIAS::wxVectorPanel::SetVector(), BIAS::ImageCanvas::Show(), BIAS::OpenGLCanvasBase::ShowFPS(), BIAS::ImageCanvas::ShowHistogramm(), BIAS::OpenGLCanvasBase::ShowValue(), BIAS::DrawTextWx< StorageType >::Text(), BIAS::ScaledImageCanvas::UpdateScaleOffset(), BIAS::ScaledImageCanvas::UpdateScaleOffsetBorders(), BIAS::HistoImageCanvas::UpdateStatusBar(), BIAS::ZoomImageCanvas::UpdateStatusBar(), BIAS::ImageCanvas::UpdateStatusBar(), BIAS::VideoSource_Controller_Kinect::VideoSource_Controller_Kinect(), wxTauControlFrame::wxTauControlFrame(), BIAS::wxViscaControlPanel::wxViscaControlPanel(), BIAS::wxViscaControlPanelButtons::wxViscaControlPanelButtons(), and BIAS::ImageCanvas::Zoom().

wxString BIAS::AsciiToWx ( const std::string &  thestring)
inline

Converts a std::string to a wxString.

Please note the existing wx macros _ and _T/wxT, too

Definition at line 44 of file StringConv.hh.

double BIAS::BetaDistribution ( double  a,
double  b,
double  x 
)

Definition at line 123 of file GSL.cpp.

double BIAS::BetaDistributionApprox ( double  a,
double  b,
double  x 
)

Definition at line 184 of file GSL.cpp.

References Equal().

void BIAS::biasabort ( )

wrapper for abort() Disables unreachable warnings.

Cannot be header implemented to avoid multiply defined symbols and wring cdecl on WIn32 DLL build.

Author
Jan Woetzel

Definition at line 16 of file biasabort.cpp.

void BIAS::biasexit ( const int  status = 1)

wrapper for exit() Disables unreachable warnings.

Cannot be header implemented to avoid multiply defined symbols and wring cdecl on DLL build.

Author
Jan Woetzel

Definition at line 16 of file biasexit.cpp.

int BIAS::BIASMatrixToMxArr ( const BIAS::Matrix< double > &  mat,
mxArray *&  mxMat 
)
inline

Convert BIAS::Matrix to MATLAB-array, inclusive allocation!

Examples:
ExampleMEX.cpp.

Definition at line 188 of file MatLabInterface.hh.

References BIAS::Matrix< T >::GetCols(), and BIAS::Matrix< T >::GetRows().

int BIAS::BIASVectorToMxArr ( const BIAS::Vector< double > &  vec,
mxArray *&  mxVec 
)
inline

Convert BIAS::Vector to MATLAB-array, inclusive allocation!

Definition at line 165 of file MatLabInterface.hh.

References BIAS::Vector< T >::Size().

template<typename T >
T BIAS::Cast ( const double  input)

correct casting to storage type, incorporates rint for integer values and simple casting for floating point values

Definition at line 11 of file CompareFloatingPoint.cpp.

template<typename T >
BIASCommon_EXPORT T BIAS::Cast ( const double  input)

correct casting to storage type, incorporates rint for integer values and simple casting for floating point values

Definition at line 11 of file CompareFloatingPoint.cpp.

template<>
BIASCommon_EXPORT double BIAS::Cast< double > ( const double  input)

Definition at line 15 of file CompareFloatingPoint.cpp.

template<>
BIASCommon_EXPORT float BIAS::Cast< float > ( const double  input)

Definition at line 19 of file CompareFloatingPoint.cpp.

bool BIAS::CheckResult ( const std::vector< bool > &  est_inliers,
const double &  est_mean,
const std::vector< bool > &  gt_inliers,
const double &  gt_mean,
const double &  gt_sigma3 
)

Definition at line 128 of file TestMeanDoubleHelper.hh.

double BIAS::ChiSquareCulmProbFun ( double  x,
int  deg_freedom 
)

Definition at line 67 of file GSL.cpp.

double BIAS::ChiSquareProbDensFun ( double  x,
int  deg_freedom 
)

Definition at line 48 of file GSL.cpp.

wxString BIAS::CleanString ( const wxString &  input,
const wxString  replaceWith = wxEmptyString 
)
inline
Examples:
ExampleCleanString.cpp.

Definition at line 107 of file StringConv.hh.

References CleanStringIP().

void BIAS::CleanStringIP ( wxString &  input,
const wxString  replaceWith = wxEmptyString 
)
inline

Definition at line 99 of file StringConv.hh.

Referenced by CleanString().

void BIAS::Compute4by1ErrorVector ( KLT_TYPE *  imgdiff,
KLT_TYPE *  gradx,
KLT_TYPE *  grady,
const int  hw,
const int  hh,
BIAS::Vector< KLT_TYPE > &  e 
)
void BIAS::Compute4by4GradientMatrix ( KLT_TYPE *  gradx,
KLT_TYPE *  grady,
const int  hw,
const int  hh,
BIAS::Matrix< KLT_TYPE > &  T 
)
void BIAS::Compute6by1ErrorVector ( KLT_TYPE *  imgdiff,
KLT_TYPE *  gradx,
KLT_TYPE *  grady,
const int  hw,
const int  hh,
BIAS::Vector< KLT_TYPE > &  e 
)
void BIAS::Compute6by6GradientMatrix ( KLT_TYPE *  gradx,
KLT_TYPE *  grady,
const int  hw,
const int  hh,
BIAS::Matrix< KLT_TYPE > &  T 
)
void BIAS::Compute8by1ErrorVector ( KLT_TYPE *  imgdiff,
KLT_TYPE *  gradx,
KLT_TYPE *  grady,
KLT_TYPE  a11,
KLT_TYPE  a12,
KLT_TYPE  a21,
KLT_TYPE  a22,
KLT_TYPE  tx,
KLT_TYPE  ty,
KLT_TYPE  h31,
KLT_TYPE  h32,
const int  hw,
const int  hh,
BIAS::Vector< KLT_TYPE > &  e 
)
void BIAS::Compute8by8GradientMatrix ( KLT_TYPE *  gradx,
KLT_TYPE *  grady,
KLT_TYPE  a11,
KLT_TYPE  a12,
KLT_TYPE  a21,
KLT_TYPE  a22,
KLT_TYPE  tx,
KLT_TYPE  ty,
KLT_TYPE  h31,
KLT_TYPE  h32,
const int  hw,
const int  hh,
BIAS::Matrix< KLT_TYPE > &  T 
)
template<class T , class U >
SharedPtr<T> BIAS::ConstCast ( const SharedPtr< U > &  src)
related
double BIAS::CulmBetaDistribution ( double  a,
double  b,
double  x 
)

Definition at line 142 of file GSL.cpp.

double BIAS::CulmulativeNormalDistribution ( double  x,
double  sigma 
)

culmulative probability function of normal distribution

Author
woelk 09/2006

Definition at line 163 of file GSL.cpp.

template<class T >
unsigned int BIAS::DecimalsToStore ( )
inline

determien the number of deciamls to store, w.g.

to file

Returns
the number of decimals between lower bound guaranteed precision (digits10) and the upper bound max. precision (nr. of binary digits)
Author
Jan Woetzel

Definition at line 76 of file Utils.hh.

void BIAS::DepthCallBack ( freenect_device *  dev,
void *  v_depth,
uint32_t  timestamp 
)
template<class T , class U >
SharedPtr<T> BIAS::DynamicCast ( const SharedPtr< U > &  src)
related
template<typename T >
bool BIAS::Equal ( const T  left,
const T  right,
const T  eps = std::numeric_limits< T >::epsilon() 
)

comparison function for floating point values See http://www.boost.org/libs/test/doc/components/test_tools/ floating_point_comparison.html for discussion

Author
woelk 02/2006
Examples:
ExampleEstimateFisheyePolynomial.cpp, ExampleLaguerre.cpp, ExampleQuaternion.cpp, and TestCalibratedPyramid.cpp.

Definition at line 23 of file CompareFloatingPoint.cpp.

Referenced by BIAS::ThreeDOut::AddTriangleMesh(), BetaDistributionApprox(), BIAS::RectificationBase< InputStorageType, OutputStorageType >::CalculateMeanOrientation(), BIAS::RectificationBase< InputStorageType, OutputStorageType >::CalculateRectifiedBases(), BIAS::RMatrixBase::Check(), BIAS::PlueckerMatrix::CheckConstraint_(), BIAS::ImageBlender::CheckFov(), BIAS::ImageBlenderIncremental::CheckFov_(), BIAS::HomgPoint2DCov::CheckSymmetry(), BIAS::HomgPoint3DCov::CheckSymmetry_(), BIAS::TestFilterBase< FILTER, InputStorageType, OutputStorageType >::CompareImageData_(), ComputeCovariance(), BIAS::RectificationViaProjectionMappingBase< InputStorageType, OutputStorageType >::Disp2Depth(), BIAS::ProjectionParametersGreatCircles::DoesPointProjectIntoImageLocal(), BIAS::ProjectionParametersBase::DoExtrinsicsDiffer(), BIAS::ProjectionParametersSphericalFast::DoIntrinsicsDiffer(), BIAS::RescaleTransfer::Down(), BIAS::GLProjectionParametersBase::DrawWithMatchedParamsAndViewport_(), BIAS::RMatrixBase::EnforceConstraints(), BIAS::PMDImageProc::FitDepthTo2DImage(), BIAS::PMDImageProc::FitModCoeffTo2DImage(), BIAS::TriangleMesh::GenerateTexturedQuad(), BIAS::TriangleMesh::GenerateTexturedQuadStrip(), BIAS::RotationAveraging::GeodesicL1Mean(), BIAS::RMatrixBase::GetCheckFailureReason(), BIAS::TrackballBase::GetMoveinViewDirection(), BIAS::MonteCarloTransform::GetSamples_(), GreaterEqual(), BIAS::PMDImageProc::HFromMeta_(), BIAS::CalibratedPyramid< StorageType >::Init(), BIAS::Conic2D::IntersectConic(), BIAS::Conic2D::IntersectConicProper(), BIAS::HomgPoint3DCov::IsHomogenized(), BIAS::HomgPoint2DCov::IsHomogenized(), BIAS::Matrix3x3< T >::IsIdentity(), BIAS::MeanDoubleRANSACEvaluator::IsInlier(), BIAS::HomgPoint2D::IsNormalized(), BIAS::HomgPoint3DCov::IsZero(), BIAS::HomgPoint2DCov::IsZero(), BIAS::Matrix3x3< T >::IsZero(), LessEqual(), BIAS::ProjectionParametersSphericalSimple::Local2Angles(), BIAS::TextureTransformRotation::MapBackward(), BIAS::TextureTransformEuclidian::MapBackward(), BIAS::TextureTransformSimilar::MapBackward(), BIAS::TrackballControl::MoveInViewingDirection(), BIAS::EParametrization::Normalize(), BIAS::PolynomialSolve::Numeric(), BIAS::Matrix3x3< T >::operator/=(), BIAS::Matrix3x3< T >::operator==(), BIAS::ProjectionParametersSpherical::ProjectLocal(), BIAS::ProjectionParametersSphericalFast::ProjectLocal(), BIAS::ProjectionParametersCylindric::ProjectLocal(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::ProjectOntoUnitCylinder_(), BIAS::ProjectionParametersCylindric::Rescale(), BIAS::ProjectionParametersBase::Rescale(), BIAS::EuclideanTransf3D::Set(), BIAS::HomgPlane3D::Set(), BIAS::RMatrixBase::Set(), BIAS::ProjectionParametersCylindric::SetCylinderOffset(), BIAS::LocalAffineFrame::SetFromMatrix(), BIAS::RMatrixBase::SetFromQuaternion(), BIAS::SVD::Sqrt(), BIAS::SVD::SqrtT(), BIAS::SymmetricMatrix3x3< T >::SymmetricMatrix3x3(), BIAS::PoseParametrizationCovariance::Transform(), BIAS::CamPoseCalib::TransformVec(), BIAS::TriangulationMidPoint::Triangulate_(), BIAS::ProjectionParametersPerspective::UnProjectLocal(), BIAS::ProjectionParametersSphericalSimple::UnProjectToImagePlane(), BIAS::ProjectionParametersZoom::UnProjectToImagePlane(), BIAS::ProjectionParametersGreatCircles::UnProjectToImagePlane(), BIAS::ProjectionParametersSpherical::UnProjectToImagePlane(), BIAS::ProjectionParametersSphericalFast::UnProjectToImagePlane(), BIAS::ProjectionParametersPerspective::UnProjectToImagePlane(), BIAS::ProjectionParametersCylindric::UnProjectToImagePlane(), BIAS::ProjectionParametersPerspective::UpdateMinZLocal(), BIAS::Normalization::Woelk(), and BIAS::GLProjectionParametersPerspective::Z2Depth_().

template<>
BIASCommon_EXPORT bool BIAS::Equal< double > ( const double  left,
const double  right,
const double  eps 
)

Definition at line 29 of file CompareFloatingPoint.cpp.

template<>
BIASCommon_EXPORT bool BIAS::Equal< float > ( const float  left,
const float  right,
const float  eps 
)

Definition at line 44 of file CompareFloatingPoint.cpp.

wxString BIAS::FilenamesToWx ( const char *  thestring)
inline

Definition at line 37 of file StringConv.hh.

wxString BIAS::FilenamesToWx ( const std::string &  thestring)
inline

Definition at line 49 of file StringConv.hh.

void* BIAS::FreenectThreadFunc_ ( void *  arg)
double BIAS::Gamma ( double  x)

Definition at line 95 of file GSL.cpp.

int BIAS::GaussJordanElimination ( BIAS::Matrix< KLT_TYPE > &  a,
BIAS::Vector< KLT_TYPE > &  b 
)
bool BIAS::GenerateRandomData ( Random &  MyRandom,
const unsigned  num_data,
const unsigned  num_outliers,
const double  sigma3,
const unsigned  min_sample_size,
std::vector< double > &  data,
std::vector< bool > &  inliers,
double &  mean 
)
template<class T >
T* BIAS::Get ( SharedPtr< T > &  t)
related
template<class T >
T* const BIAS::Get ( const SharedPtr< T > &  t)
related
double BIAS::GetBaseLevel ( const Vector< double > &  apar,
bool  backdirection 
)
enum eNodeType BIAS::GetNodeType ( const osg::ref_ptr< osg::Node >  node)
inline

Definition at line 48 of file NodeInfo.hh.

References eNT_Default, BIAS::OpenSceneGraphHelper::HasInfo(), and String2NodeType().

void BIAS::GetTSC_hilo ( unsigned int *  hi,
unsigned int *  lo 
)
inline

processor cycles Time Stamp Counter on >= Pentium like CPU's.

High resolution CPU timing information based on x86 assembly rdtsc command. Works for single core machines. Please note that the cycle counter may be unreliable -with speed step etc. on notebooks -with multicore/multiprocessor systems as the cyclec ounters may not be in sync and the schneduler may move thread execution between processing kernels.

Windows: Assembler function without prolog and epilog. Should work on Intel Pentium and newer AMD CPU's, see rdtsc assembler instruction. Return the number of clock cycles since the CPU was powered up or reset. This functions can't be class member inlined because it collides with naked fastcall modifier. int64 has no ANSI equivalent.

Linux: Same approach avoiding int64 usage.

See http://en.wikipedia.org/wiki/RDTSC

Todo:
: For x64 see http://www3.intel.com/cd/ids/developer/asmo-na/eng/257129.htm
Author
Felix Woelk(Linux), Jan Woetzel(Windows)

Definition at line 55 of file CycleCounterTSC.hh.

template<class T >
bool BIAS::Greater ( const T  left,
const T  right,
const T  eps = std::numeric_limits<T>::epsilon() 
)
inline

comparison function for floating point values

Author
woelk 02/2006

Definition at line 65 of file CompareFloatingPoint.hh.

Referenced by BIAS::ThreeDOut::AddEllipsoid(), GreaterEqual(), and BIAS::ThreeDOut::UpdateEllipsoid().

template<class T >
bool BIAS::GreaterEqual ( const T  left,
const T  right,
const T  eps = std::numeric_limits<T>::epsilon() 
)
inline

comparison function for floating point values

Author
woelk 02/2006

Definition at line 73 of file CompareFloatingPoint.hh.

References Equal(), and Greater().

Referenced by BIAS::SVD::Sqrt(), and BIAS::SVD::SqrtT().

template<class StorageType >
bool BIAS::HaveImagesMatchingROI ( const Image< StorageType > &  i1,
const Image< StorageType > &  i2 
)
inline
INST ( unsigned  char)
BIAS::INST ( float  )
BIAS::INST ( int  )
BIAS::INST ( char  )
BIAS::INST ( short  )
BIAS::INST ( double  )
double BIAS::InvChiSquareCulmProbFun ( double  x,
int  deg_freedom 
)
Examples:
ExampleGSL.cpp.

Definition at line 81 of file GSL.cpp.

Referenced by BIAS::AbsoluteOrientationRANSAC::SetSignificance().

double BIAS::InvGamma ( double  x)

Definition at line 109 of file GSL.cpp.

bool BIAS::IsConsoleStream ( const std::ostream &  os)
inline

Helper returning true on console ostreams like cerr, cout Useful to distinguish between console (cout,cerr) and other i.e.

fout fstreams.

Author
Jan Woetzel

Definition at line 54 of file Utils.hh.

Referenced by operator<<(), BIAS::Vector2< T >::operator<<(), BIAS::Vector4< T >::operator<<(), and BIAS::Vector3< T >::operator<<().

std::string BIAS::IsoLatin1ToUtf8 ( const std::string &  s)
inline

Definition at line 93 of file StringConv.hh.

float BIAS::lerp ( const float  a,
const float  b,
const float  f 
)
inline

linear interpolation Cg equivalent function.

Author
Jan Woetzel

Definition at line 39 of file Utils.hh.

double BIAS::lerp ( const double  a,
const double  b,
const double  f 
)
inline

Definition at line 43 of file Utils.hh.

template<typename T >
bool BIAS::Less ( const T  left,
const T  right,
const T  eps = std::numeric_limits<T>::epsilon() 
)
inline

comparison function for floating point values

Test:
tested with TestCompareFloatingPoint.cpp
Author
woelk 02/2006
Examples:
ExampleCompare.cpp.

Definition at line 50 of file CompareFloatingPoint.hh.

Referenced by BIAS::UnscentedTransform::ComputeSigmaPoints_(), BIAS::GLProjectionParametersBase::GetDepth(), and LessEqual().

template<typename T >
bool BIAS::LessEqual ( const T  left,
const T  right,
const T  eps = std::numeric_limits<T>::epsilon() 
)
inline

comparison function for floating point values

Author
woelk 02/2006

Definition at line 58 of file CompareFloatingPoint.hh.

References Equal(), and Less().

void * BIAS::listenthread ( void *  data)
template<class T >
int BIAS::LoadBogK ( const std::string &  filename,
Matrix3x3< T > &  mat 
)
template<class T >
int BIAS::LoadBogRC ( const std::string &  filename,
Matrix3x3< T > &  mat 
)
void BIAS::MouseButtonFunc_ ( int  button,
int  state,
int  x,
int  y 
)
void BIAS::MouseMotionFunc_ ( int  x,
int  y 
)
void BIAS::MousePassiveMotionFunc_ ( int  x,
int  y 
)
int BIAS::MxArrToBIASMatrix ( const mxArray *  mxMat,
BIAS::Matrix< double > &  mat 
)
inline

Convert MATLAB-array to BIAS::Matrix.

Examples:
ExampleMEX.cpp.

Definition at line 137 of file MatLabInterface.hh.

References TNT::Matrix< T >::newsize().

int BIAS::MxArrToBIASVector ( const mxArray *  mxVec,
BIAS::Vector< double > &  vec 
)
inline

Convert MATLAB-array to BIAS::Vector.

Definition at line 105 of file MatLabInterface.hh.

References TNT::Vector< T >::newsize().

std::string BIAS::NodeType2String ( const enum eNodeType &  t)
inline
template<class T >
DualQuaternion<T> BIAS::operator* ( const DualQuaternion< T > &  l,
const T &  scalar 
)
inline
SimilarityTransform BIAS::operator* ( SimilarityTransform &  arg1,
SimilarityTransform &  arg2 
)
inline

Definition at line 197 of file SimilarityTransform.hh.

References BIAS::SimilarityTransform::Mult().

BIAS::Vector3<double> BIAS::operator* ( const SimilarityTransform &  arg1,
const BIAS::Vector3< double > &  vec 
)
inline

Definition at line 205 of file SimilarityTransform.hh.

References BIAS::SimilarityTransform::MultVec().

Polynom BIAS::operator* ( const Polynom &  a,
const Polynom &  b 
)
inline

Definition at line 238 of file Polynom.hh.

Polynom BIAS::operator* ( const double &  d,
const Polynom &  a 
)
inline

Definition at line 244 of file Polynom.hh.

Polynom BIAS::operator* ( const Polynom &  a,
const double &  d 
)
inline

Definition at line 250 of file Polynom.hh.

template<class T >
Vector2<T>& BIAS::operator*= ( Vector2< T > &  vec,
const T &  scalar 
)
inline

Multiplication operator with scalar argument.

Author
Ingo Thomsen, tested

Definition at line 873 of file Vector2.hh.

References BIAS::Vector2< T >::MultiplyIP().

template<class T >
DualQuaternion<T> BIAS::operator+ ( const DualQuaternion< T > &  l,
const DualQuaternion< T > &  r 
)
inline
template<class T >
Vector2<T> BIAS::operator+ ( const Vector2< T > &  vec,
const T &  scalar 
)
inline

Addition operator with scalar argument, returning new vector.

Author
Ingo Thomsen, tested

Definition at line 94 of file Operators.hh.

References BIAS::Vector2< T >::Add().

template<class T >
Vector2<T> BIAS::operator+ ( const T &  scalar,
const Vector2< T > &  vec 
)
inline

Addition operator with scalar argument, returning new vector.

Author
Ingo Thomsen, djung, copy-paste

Definition at line 104 of file Operators.hh.

References BIAS::Vector2< T >::Add().

Polynom BIAS::operator+ ( const Polynom &  a,
const Polynom &  b 
)
inline

Definition at line 226 of file Polynom.hh.

template<class T >
BIASMathBase_EXPORT Vector2<T>& BIAS::operator+= ( Vector2< T > &  vec,
const Vector2< T > &  argvec 
)
inline

add operator for two Vectors

Author
Ingo Thomsen, tested

Definition at line 830 of file Vector2.hh.

References BIAS::Vector2< T >::Add().

template<class T >
Vector2<T>& BIAS::operator+= ( Vector2< T > &  vec,
const T &  scalar 
)
inline

Addition operator with scalar argument.

Author
Ingo Thomsen, tested

Definition at line 857 of file Vector2.hh.

References BIAS::Vector2< T >::AddIP().

template<class T >
DualQuaternion<T> BIAS::operator- ( const DualQuaternion< T > &  l,
const DualQuaternion< T > &  r 
)
inline
Polynom BIAS::operator- ( const Polynom &  a,
const Polynom &  b 
)
inline

Definition at line 232 of file Polynom.hh.

template<class T >
Vector2<T>& BIAS::operator-= ( Vector2< T > &  vec,
const Vector2< T > &  argvec 
)
inline

sub operator for two Vectors

Author
Ingo Thomsen tested

Definition at line 839 of file Vector2.hh.

References BIAS::Vector2< T >::Sub().

template<class T >
Vector2<T>& BIAS::operator-= ( Vector2< T > &  vec,
const T &  scalar 
)
inline

Substraction operator with scalar argument.

Author
Ingo Thomsen, tested

Definition at line 865 of file Vector2.hh.

References BIAS::Vector2< T >::SubIP().

template<class T >
DualQuaternion<T> BIAS::operator/ ( const DualQuaternion< T > &  l,
const T &  scalar 
)
inline
Polynom BIAS::operator/ ( const Polynom &  a,
const double &  d 
)
inline

Definition at line 256 of file Polynom.hh.

Polynom BIAS::operator/ ( const Polynom &  a,
const Polynom &  b 
)
inline

Definition at line 262 of file Polynom.hh.

template<class T >
BIASMathBase_EXPORT Vector2<T>& BIAS::operator/= ( Vector2< T > &  vec,
const Vector2< T > &  argvec 
)
inline

elementwise division

Author
JW

Definition at line 846 of file Vector2.hh.

References BIAS::Vector2< T >::DivideIP().

template<class T >
Vector2<T>& BIAS::operator/= ( Vector2< T > &  vec,
const T &  scalar 
)
inline

Division operator with scalar argument.

Author
Ingo Thomsen, tested

Definition at line 881 of file Vector2.hh.

References BIAS::Vector2< T >::DivideIP().

bool BIAS::operator< ( const BIAS::Polynom p1,
const BIAS::Polynom p2 
)
inline

Definition at line 293 of file Polynom.hh.

References BIAS::Polynom::GetOrder().

template<class T >
std::ostream & BIAS::operator<< ( std::ostream &  os,
const Array2D< T > &  arg 
)
Examples:
ExampleCMU1394.cpp, ExampleSharedPtr.cpp, and ExampleSparseArray2D.cpp.

Definition at line 260 of file Array2D.hh.

template<class T >
std::ostream & BIAS::operator<< ( std::ostream &  os,
const SparseArray2D< T > &  t 
)

Definition at line 289 of file SparseArray2D.hh.

ostream & BIAS::operator<< ( std::ostream &  os,
const enum ERoiType type 
)

Definition at line 51 of file ROI.cpp.

References ROI_Corners, ROI_Mask, ROI_Points, and ROI_Rows.

template<class T >
std::ostream & BIAS::operator<< ( std::ostream &  os,
const Matrix3x3< T > &  mat 
)

Definition at line 734 of file Matrix3x3.cpp.

template<class BaseClassType , class TagType >
std::ostream & BIAS::operator<< ( std::ostream &  os,
const BaseFactory< BaseClassType, TagType > &  bf 
)

Definition at line 661 of file BaseFactory.hh.

References BIAS::BaseFactory< BaseClassType, TagType >::Map_.

std::ostream& BIAS::operator<< ( std::ostream &  os,
const Feat &  f 
)
inline

Definition at line 56 of file CornerDetectorGradient.hh.

template<class T >
std::ostream & BIAS::operator<< ( std::ostream &  os,
const SharedPtr< T > &  t 
)

Definition at line 269 of file SharedPtrImpl.hh.

References Get().

ostream & BIAS::operator<< ( std::ostream &  os,
const enum ETrackerResult res 
)
ostream & BIAS::operator<< ( std::ostream &  os,
const enum ERejectionType rt 
)

Definition at line 41 of file TrackerBaseInterface.cpp.

References RT_Invalid, RT_MAD, RT_X84, and RT_X84M.

std::ostream & BIAS::operator<< ( std::ostream &  os,
const RParametrization p 
)
std::ostream & BIAS::operator<< ( std::ostream &  os,
const osg::Matrix m 
)

stream operator for osg matrix (woelk 10/2009)

Definition at line 519 of file OpenSceneGraphHelper.cpp.

std::ostream & BIAS::operator<< ( std::ostream &  os,
const osg::Vec3 v 
)

stream operator for osg vector (woelk 10/2009)

Definition at line 534 of file OpenSceneGraphHelper.cpp.

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersBufferedRay &  p 
)
inline

Definition at line 145 of file ProjectionParametersBufferedRay.hh.

ostream & BIAS::operator<< ( std::ostream &  os,
const MatchDataBase m 
)
std::ostream & BIAS::operator<< ( std::ostream &  os,
const PoseParametrization p 
)
ostream & BIAS::operator<< ( std::ostream &  os,
const GenSynthMatchesRig m 
)

Prints the contained GenSynthMatches objects to the given ostream.

Definition at line 42 of file GenSynthMatchesRig.cpp.

References BIAS::GenSynthMatchesRig::GetCams().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersOrthographic &  p 
)
inline
std::ostream & BIAS::operator<< ( std::ostream &  os,
const BIAS::TimeStamp ts 
)

Standard output operator for TimeStamps.

Definition at line 151 of file TimeStamp.cpp.

References BIAS::TimeStamp::GetMSec().

std::ostream & BIAS::operator<< ( std::ostream &  os,
const EParametrization p 
)
std::ostream& BIAS::operator<< ( std::ostream &  os,
const SimilarityTransform &  p 
)
inline
template<class T >
BIASMathBase_EXPORT std::ostream & BIAS::operator<< ( std::ostream &  os,
const SymmetricMatrix3x3< T > &  mat 
)

Definition at line 198 of file SymmetricMatrix3x3.cpp.

References IsConsoleStream().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersSphericalSimple &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  stream,
const BIAS::SparseMatrix matrix 
)
inline

Definition at line 239 of file SparseMatrix.hh.

References BIAS::SparseMatrix::Print().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersGreatCircles &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  s,
const BIAS::Polynom p 
)
inline

Definition at line 274 of file Polynom.hh.

References BIAS::Polynom::GetOrder().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const Pose &  p 
)
inline

Write pose transformation to stream.

See Also
Pose::Save()

Definition at line 288 of file Pose.hh.

References BIAS::CoordinateTransform3D::C_, BIAS::Pose::Cov_, BIAS::CoordinateTransform3D::Q_, and BIAS::CoordinateTransform3D::scale_.

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersZoom &  p 
)
inline

Definition at line 311 of file ProjectionParametersZoom.hh.

std::ostream& BIAS::operator<< ( std::ostream &  os,
Conic2D::ConicType &  t 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersCylindric &  p 
)
inline
BIASGeometryBase_EXPORT std::ostream& BIAS::operator<< ( std::ostream &  os,
const enum HomgPoint2D::EPosition  pos 
)
std::ostream& BIAS::operator<< ( std::ostream &  os,
const CoordinateTransform3D &  p 
)
inline

Write 3d coordinate transformation to stream.

See Also
CoordinateTransform3D::Save()

Definition at line 372 of file CoordinateTransform3D.hh.

References BIAS::CoordinateTransform3D::C_, BIAS::CoordinateTransform3D::Q_, and BIAS::CoordinateTransform3D::scale_.

ostream & BIAS::operator<< ( std::ostream &  os,
const GenSynthMatches m 
)
std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersProjective &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersPerspectiveDepth &  p 
)
inline
ostream & BIAS::operator<< ( std::ostream &  os,
const ROI roi 
)
std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersSphericalFast &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersSpherical &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const Projection &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const BIAS::Vector< char > &  vec 
)
inline

Definition at line 511 of file Vector.hh.

References IsConsoleStream().

template<class T >
std::ostream& BIAS::operator<< ( std::ostream &  os,
const BIAS::Vector< T > &  vec 
)
related

Definition at line 535 of file Vector.hh.

References IsConsoleStream().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersDynamicLoad &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const Vector2< unsigned char > &  vec 
)
inline

Definition at line 714 of file Vector2.hh.

References IsConsoleStream().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersPerspective &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const Vector4< char > &  vec 
)
inline

Definition at line 749 of file Vector4.hh.

References IsConsoleStream().

std::ostream& BIAS::operator<< ( std::ostream &  os,
const ProjectionParametersBase &  p 
)
inline
std::ostream& BIAS::operator<< ( std::ostream &  os,
const BIAS::Vector3< char > &  vec 
)
inline

Definition at line 829 of file Vector3.hh.

References IsConsoleStream().

BIASImageBase_EXPORT std::ostream & BIAS::operator<< ( std::ostream &  os,
const ImageBase img2 
)
BIASImageBase_EXPORT std::ostream & BIAS::operator<< ( std::ostream &  os,
const ImageBase::EStorageType st 
)
BIASImageBase_EXPORT std::ostream & BIAS::operator<< ( std::ostream &  os,
const ImageBase::EColorModel st 
)
bool BIAS::operator> ( const BIAS::Polynom p1,
const BIAS::Polynom p2 
)
inline

Definition at line 302 of file Polynom.hh.

References BIAS::Polynom::GetOrder().

template<class T >
std::istream & BIAS::operator>> ( std::istream &  is,
Matrix3x3< T > &  mat 
)

Definition at line 717 of file Matrix3x3.cpp.

std::istream & BIAS::operator>> ( std::istream &  is,
RParametrization p 
)

Definition at line 116 of file RParametrization.cpp.

References BIAS::RParametrization::Set().

istream & BIAS::operator>> ( std::istream &  is,
MatchDataBase m 
)

Definition at line 332 of file MatchDataBase.cpp.

std::istream & BIAS::operator>> ( std::istream &  is,
PoseParametrization p 
)

Definition at line 232 of file PoseParametrization.cpp.

References BIAS::PoseParametrization::Set().

std::istream & BIAS::operator>> ( std::istream &  is,
BIAS::TimeStamp ts 
)

Standard input operator for TimeStamps.

Definition at line 157 of file TimeStamp.cpp.

Referenced by operator>>().

std::istream & BIAS::operator>> ( std::istream &  is,
EParametrization p 
)

Definition at line 329 of file EParametrization.cpp.

References BIAS::EParametrization::Set().

std::istream& BIAS::operator>> ( std::istream &  is,
SimilarityTransform &  p 
)
inline
template<class T >
BIASMathBase_EXPORT std::istream & BIAS::operator>> ( std::istream &  is,
SymmetricMatrix3x3< T > &  mat 
)

Definition at line 213 of file SymmetricMatrix3x3.cpp.

References BIAS::SymmetricMatrix3x3< T >::Data_, and operator>>().

std::istream& BIAS::operator>> ( std::istream &  s,
BIAS::Polynom p 
)
inline

Definition at line 268 of file Polynom.hh.

std::istream& BIAS::operator>> ( std::istream &  is,
Pose &  p 
)
inline

Read pose transformation from stream.

See Also
Pose::Load()

Definition at line 303 of file Pose.hh.

References BIAS::CoordinateTransform3D::C_, BIAS::Pose::Cov_, BIAS::CoordinateTransform3D::Q_, and BIAS::CoordinateTransform3D::scale_.

std::istream& BIAS::operator>> ( std::istream &  is,
CoordinateTransform3D &  p 
)
inline

Read 3d coordinate transformation from stream.

See Also
CoordinateTransform3D::Load()

Definition at line 381 of file CoordinateTransform3D.hh.

References BIAS::CoordinateTransform3D::C_, BIAS::CoordinateTransform3D::Q_, and BIAS::CoordinateTransform3D::scale_.

std::istream& BIAS::operator>> ( std::istream &  is,
Vector2< unsigned char > &  vec 
)
inline

Definition at line 782 of file Vector2.hh.

References BIAS::Vector2< T >::GetData(), and BIAS::Vector2< T >::Size().

std::istream& BIAS::operator>> ( std::istream &  is,
Vector4< char > &  vec 
)
inline

Definition at line 826 of file Vector4.hh.

References BIAS::Vector4< T >::GetData(), and BIAS::Vector4< T >::Size().

std::istream& BIAS::operator>> ( std::istream &  is,
Vector3< char > &  vec 
)
inline

Definition at line 907 of file Vector3.hh.

References BIAS::Vector3< T >::GetData().

BIASImageBase_EXPORT std::istream & BIAS::operator>> ( std::istream &  is,
BIAS::ImageBase img 
)
double BIAS::Realtime ( void  )

Definition at line 65 of file Timing.cpp.

double BIAS::realtime_ ( void  )
void * BIAS::receivethread ( void *  data)

these are wrapper to comply to the pthread_create() interface

Definition at line 1035 of file CScommBase.cpp.

References BIAS::CSCommWithClientNr::comm, BIAS::CSCommWithClientNr::commNr, and BIAS::CScommBase::receiveThread_().

template<class T >
unsigned BIAS::RefCount ( const SharedPtr< T > &  t)
related
void BIAS::Render_ ( )
void BIAS::Reshape_ ( int  width,
int  height 
)

Definition at line 412 of file ContextGLUT.cpp.

References BIAS::RenderContextBase::WindowReshape().

int BIAS::ScanBus ( std::stringstream &  ofs)
int BIAS::ScanBus ( std::vector< CameraInfo > &  camInfos)
void BIAS::sincos ( const float  xRad,
float &  s,
float &  c 
)
inline

computes sin and cosinus with float precision

Cg equivalent function.

Author
Jan Woetzel

Definition at line 25 of file Utils.hh.

void BIAS::sincos ( const double  xRad,
double &  s,
double &  c 
)
inline

Definition at line 30 of file Utils.hh.

void BIAS::SpecialKeyFunc_ ( int  key,
int  x,
int  y 
)

Definition at line 276 of file ContextGLUT.cpp.

References BIAS::RenderContextBase::SpecialKeyPressed().

void BIAS::SpecialKeyUpFunc_ ( int  key,
int  x,
int  y 
)

Definition at line 344 of file ContextGLUT.cpp.

References BIAS::RenderContextBase::SpecialKeyUp().

void BIAS::StandardKeyFunc_ ( unsigned char  key,
int  x,
int  y 
)

Definition at line 261 of file ContextGLUT.cpp.

References BIAS::RenderContextBase::StandardKeyPressed().

void BIAS::StandardKeyUpFunc_ ( unsigned char  key,
int  x,
int  y 
)

Definition at line 269 of file ContextGLUT.cpp.

References BIAS::RenderContextBase::StandardKeyUp().

enum eNodeType BIAS::String2NodeType ( const std::string &  val)
inline

Definition at line 35 of file NodeInfo.hh.

References NodeTypeXMLStrings.

Referenced by GetNodeType().

BIASOpenGLFramework_EXPORT void BIAS::SwapGLObjects ( glfTexture A,
glfTexture B 
)

Will throw an exception if one texture has id 0 or if textures have different targets.

Author
bartczak 03/2009
Examples:
ExamplePlainPerPixelProcessing.cpp.

Definition at line 31 of file glfTexture.cpp.

References BIAS::glfTexture::id_, and BIAS::glfTexture::target_.

void BIAS::VideoCallback ( freenect_device *  dev,
void *  rgb,
uint32_t  timestamp 
)
void BIAS::WhenIdle_ ( )

Variable Documentation

const int BIAS::attribsRGBAD[]
Initial value:
= { WX_GL_RGBA,
WX_GL_MIN_RED, 1,
WX_GL_MIN_GREEN, 1,
WX_GL_MIN_BLUE, 1,
WX_GL_MIN_ALPHA, 1,
WX_GL_STENCIL_SIZE, 0,
WX_GL_DEPTH_SIZE, 1,
WX_GL_DOUBLEBUFFER,
0
}

 helper to simplify setting up format "red,green,blue,alpha,depth" JW

to be used as (int*)&attribsRGBAD JW

Definition at line 87 of file OpenGLCanvasBase.hh.

const int BIAS::attribsRGBASD[]
Initial value:
= { WX_GL_RGBA,
WX_GL_MIN_RED, 1,
WX_GL_MIN_GREEN, 1,
WX_GL_MIN_BLUE, 1,
WX_GL_MIN_ALPHA, 1,
WX_GL_STENCIL_SIZE, 1,
WX_GL_DEPTH_SIZE, 1,
WX_GL_DOUBLEBUFFER,
0
}

   helper to simplify setting up format "red,green,blue,alpha,stencil,depth" JW

to be used as (int*)&attribsRGBASD JW

Definition at line 100 of file OpenGLCanvasBase.hh.

template<class T >
class BIASVideoSource_EXPORT BIAS::Camera

Definition at line 46 of file VideoSource_Base.hh.

int BIAS::capMode_
template class BIASOpenCLFramework_EXPORT BIAS::clfFilter< float, float >

Definition at line 168 of file clfFilter.cpp.

template class BIASOpenCLFramework_EXPORT BIAS::clfFilter< unsigned char, unsigned char >

Definition at line 169 of file clfFilter.cpp.

template class BIASOpenCLFramework_EXPORT BIAS::clfGauss< float, float >

Definition at line 126 of file clfGauss.cpp.

template class BIASOpenCLFramework_EXPORT BIAS::clfGradientGauss< float, float >

Definition at line 155 of file clfGradientGauss.cpp.

pthread_mutex_t BIAS::coloravail_mutex = PTHREAD_MUTEX_INITIALIZER

Definition at line 59 of file VideoSource_Kinect_win32.cpp.

freenect_video_format BIAS::current_format = FREENECT_VIDEO_BAYER

Definition at line 54 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_().

template class BIASImage_EXPORT BIAS::CylindricalRectification< char, char >

Definition at line 629 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< double, double >

Definition at line 657 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< float, float >

Definition at line 622 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< float, unsigned char >

Definition at line 624 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< int, int >

Definition at line 645 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< short, short >

Definition at line 637 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned char, char >

Definition at line 628 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned char, float >

Definition at line 623 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned char, unsigned char >

Definition at line 621 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned short, float >

Definition at line 649 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned short, int >

Definition at line 653 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned short, short >

Definition at line 641 of file CylindricalRectification.cpp.

template class BIASImage_EXPORT BIAS::CylindricalRectification< unsigned short, unsigned short >

Definition at line 633 of file CylindricalRectification.cpp.

float * BIAS::depth_front

Definition at line 49 of file VideoSource_Kinect_win32.cpp.

float* BIAS::depth_mid

Definition at line 49 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack().

pthread_mutex_t BIAS::depthavail_mutex = PTHREAD_MUTEX_INITIALIZER

Definition at line 60 of file VideoSource_Kinect_win32.cpp.

BIAS::Image<float>* BIAS::depthLookupTable_
volatile int BIAS::die = 0

Definition at line 44 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_().

int BIAS::edgeTable[256]

Definition at line 40 of file MarchingCubes.cpp.

Referenced by BIAS::MarchingCubes::PolygoniseCube().

template class BIASImage_EXPORT BIAS::FFT2D_free< float >

Definition at line 219 of file FFT2D_free.cpp.

template class BIASImage_EXPORT BIAS::FFT2D_free< short >

Definition at line 222 of file FFT2D_free.cpp.

template class BIASImage_EXPORT BIAS::FFT2D_free< unsigned char >

Definition at line 216 of file FFT2D_free.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< char, char >

Definition at line 70 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< char, float >

Definition at line 71 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< double, double >

Definition at line 97 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< float, float >

Definition at line 65 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< int, float >

Definition at line 85 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< int, int >

Definition at line 83 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< short, short >

Definition at line 75 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned char, char >

Definition at line 69 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned char, float >

Definition at line 66 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned char, int >

Definition at line 84 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned char, unsigned char >

Definition at line 55 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned char, unsigned short >

Definition at line 58 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned int, unsigned int >

Definition at line 61 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned short, float >

Definition at line 89 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned short, int >

Definition at line 93 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned short, short >

Definition at line 79 of file Bilateral.cpp.

template class BIASFilter_EXPORT BIAS::FILTER_INSTANTIATION_CLASS< unsigned short, unsigned short >

Definition at line 57 of file Bilateral.cpp.

class BIASGeometry_EXPORT BIAS::FMatrix
pthread_t BIAS::freenect_thread

Definition at line 43 of file VideoSource_Kinect_win32.cpp.

freenect_context* BIAS::freenectContext_ = NULL

Definition at line 41 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_().

freenect_device* BIAS::freenectDevice_ = NULL

Definition at line 40 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_().

pthread_mutex_t BIAS::gl_backbuf_mutex = PTHREAD_MUTEX_INITIALIZER

Definition at line 56 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack(), and VideoCallback().

pthread_cond_t BIAS::gl_frame_cond = PTHREAD_COND_INITIALIZER

Definition at line 57 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack(), and VideoCallback().

class BIASGLviewer_EXPORT BIAS::GLProjectionParametersInterface

Definition at line 46 of file ControlInterface.hh.

int BIAS::got_depth = 0

Definition at line 65 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack().

int BIAS::got_rgb = 0

Definition at line 64 of file VideoSource_Kinect_win32.cpp.

Referenced by VideoCallback().

class BIASGui_EXPORT BIAS::GuiWXApp

Definition at line 47 of file GuiWX.hh.

Referenced by BIAS::GuiWX::guiThreadFunc_().

class BIASGui_EXPORT BIAS::GuiWXFrame

Definition at line 46 of file GuiWX.hh.

Referenced by BIAS::GuiWXApp::Init().

class BIASGeometryBase_EXPORT BIAS::HomgPoint2D
Examples:
EvaluateAlignment.cpp, Example7Point.cpp, ExampleCamPoseCalib.cpp, and ExampleDrawConic.cpp.

Definition at line 59 of file Triangulation.hh.

Referenced by BIAS::PMDImageProc::CrossCheck(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesCylindric_(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesPerspective_(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesSpherical_(), BIAS::ImageCanvasCheckerboardExtract::DisplayCheckerboardCorners(), BIAS::PMDImageProc::Fit2DToDepthImage(), BIAS::TriangleMesh::GenerateDenseMesh(), BIAS::TriangleMesh::GenerateImagePlane(), BIAS::TextureMapping< InputStorageType, OutputStorageType >::GetBoundingBox(), BIAS::ProjectionMapping< InputStorageType, OutputStorageType >::GetBoundingBox(), BIAS::Triangulation::GetCovarianceProjective(), BIAS::PMatrix::GetFieldOfView(), BIAS::PMatrix::GetFieldOfViewY(), BIAS::ProjectionParametersPerspective::GetIdealK(), BIAS::HMatrix::GetMappedRange(), BIAS::PMatrix::GetProjectionError(), BIAS::LocalAffineFrame::GlobalToLocal(), BIAS::ImageDraw< StorageType >::InterpolatedCircleCenter(), BIAS::ImageDraw< StorageType >::InterpolatedLine(), BIAS::ImageDraw< StorageType >::InterpolatedLineGrey(), BIAS::Primitives::LocalNormalizedVertexCloud(), BIAS::LocalAffineFrame::LocalToGlobal(), BIAS::glfMatrix::MakeProjectionMatrix(), BIAS::TriangleMesh::MakeTriangles_(), BIAS::ImageCanvasCheckerboardExtract::ManuallySetSelectionMode(), BIAS::ImageCanvasCheckerboardExtract::OnLeftMouseButton(), BIAS::ImageCanvasCheckerboardExtract::OnRightMouseButton(), BIAS::ImageWarper< StorageType >::Process(), BIAS::ProjectionParametersProjective::Project(), BIAS::ProjectionParametersPerspective::ProjectLocal(), BIAS::GenGroundTruth::ReadCorrespondences(), BIAS::ImageCanvasCheckerboardExtract::SelectCheckerboardCorners(), BIAS::ImageAlignment::SetAlignmentPixelsRectangular(), BIAS::ImageCanvasCheckerboardExtract::SetPatternParameters(), BIAS::TrackerBaseInterface< StorageType >::Track(), BIAS::TrackerBaseAffine< StorageType >::TrackAffine_(), BIAS::GLProjectionParametersBase::TranslateDepthToZ(), BIAS::GLProjectionParametersBase::UnProject(), BIAS::GLProjectionParametersPerspective::UpdateGLProjectionMatrix_(), and BIAS::ProjectionParametersPerspective::UpdateMinZLocal().

class BIASGeometryBase_EXPORT BIAS::HomgPoint2DCov

Definition at line 60 of file Triangulation.hh.

Referenced by BIAS::Covariance3Dto2DHomg::Project().

class BIASGeometryBase_EXPORT BIAS::HomgPoint3D
Examples:
ExampleAutoCalib.cpp, ExampleCamPoseCalib.cpp, ExampleEParametrization.cpp, ExampleFMatrix.cpp, ExampleProjectionParametersPerspective2.cpp, ExampleProjectionParametersProjective.cpp, and FMatrixTest.cpp.

Definition at line 61 of file Triangulation.hh.

Referenced by BIAS::PMatrixBase::Backproject(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesCylindric_(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesPerspective_(), BIAS::CylindricalRectification< InputStorageType, OutputStorageType >::DetermineCylindricCameraBoundriesSpherical_(), BIAS::TriangleMesh::GenerateDenseMesh(), BIAS::TriangleMesh::GenerateTexturedCamera(), BIAS::TriangleMesh::GenerateTexturedQuad(), BIAS::TriangleMesh::GenerateTexturedQuadStrip(), BIAS::PlueckerMatrix::GetDirection(), BIAS::PlueckerMatrix::GetNormal(), BIAS::ProjectionMapping< InputStorageType, OutputStorageType >::GetSourceCoordinates_(), BIAS::OnlyRotationControl::LeftAndRightMouseMoved(), BIAS::OnlyRotationControl::LeftMouseDoubleClicked(), BIAS::OnlyRotationControl::LeftMouseMoved(), BIAS::TriangleMesh::MakeTriangles_(), BIAS::ForwardMappingNearestNeighbour< InputStorageType, OutputStorageType >::Map(), BIAS::HMatrix::MapAcrossPlane(), BIAS::OnlyRotationControl::MiddleMouseMoved(), BIAS::FlyControl::MoveDirection(), BIAS::TrackballControl::MoveInViewingDirection(), BIAS::EpipolarLine::ProjectEpipolarPlane(), BIAS::GenGroundTruth::ReadWorldPoints(), BIAS::OnlyRotationControl::RightMouseMoved(), BIAS::SceneText::SceneText(), BIAS::SceneTextScreen::SceneTextScreen(), BIAS::GLProjectionParametersBase::UnProject(), BIAS::ProjectionParametersSphericalSimple::UnProjectToImagePlane(), BIAS::ProjectionParametersZoom::UnProjectToImagePlane(), BIAS::ProjectionParametersGreatCircles::UnProjectToImagePlane(), BIAS::ProjectionParametersSpherical::UnProjectToImagePlane(), BIAS::ProjectionParametersSphericalFast::UnProjectToImagePlane(), BIAS::ProjectionParametersPerspective::UnProjectToImagePlane(), and BIAS::ProjectionParametersProjective::UnProjectToRay().

class BIASGeometryBase_EXPORT BIAS::HomgPoint3DCov

Definition at line 62 of file Triangulation.hh.

template<class StorageType >
class BIASImageBase_EXPORT BIAS::Image
class BIASImageBase_EXPORT BIAS::ImageConvert

Definition at line 89 of file ImageBase.hh.

float BIAS::lookup_[2048]

Definition at line 51 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack().

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix

Definition at line 37 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix2x2

Definition at line 39 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix2x3

Definition at line 41 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix3x2

Definition at line 42 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix3x3

Definition at line 35 of file HomgPoint3DCov.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix3x4

Definition at line 47 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Matrix4x4

Definition at line 45 of file Operators.hh.

const float BIAS::maxGain = 29.0f
const int BIAS::maxMessageNumber = 10000000
const float BIAS::maxShutter = 0.034f
const float BIAS::minGain = 0.1f
const float BIAS::minShutter = 0.01f
pthread_cond_t BIAS::newColorAvail_ = PTHREAD_COND_INITIALIZER

Definition at line 61 of file VideoSource_Kinect_win32.cpp.

Referenced by VideoCallback().

pthread_cond_t BIAS::newDepthAvail_ = PTHREAD_COND_INITIALIZER

Definition at line 62 of file VideoSource_Kinect_win32.cpp.

Referenced by DepthCallBack().

std::string BIAS::NodeTypeXMLStrings[]
static
Initial value:
= { "NT_Default",
"NT_FromDisk",
"NT_FromImageFile",
"NT_Marker",
"NT_Light",
"NT_PointCloud",
"NT_BBox",
"NT_VNTriMesh"}

Definition at line 26 of file NodeInfo.hh.

Referenced by NodeType2String(), String2NodeType(), BIAS::NodeInfo::XMLIn(), and BIAS::NodeInfo::XMLOut().

unsigned BIAS::nrOfReflectivityParameters_ =4
static
unsigned BIAS::nrOfSplineParameters_ =12
static
class BIASUtils_EXPORT BIAS::ParamCallbackInterface

Definition at line 42 of file ParamTypes.hh.

class BIASGui_EXPORT BIAS::ParamGUI

Definition at line 64 of file ParamGUI.hh.

template class BIASImage_EXPORT BIAS::PlanarRectification< char, char >

Definition at line 294 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< double, double >

Definition at line 322 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< float, float >

Definition at line 288 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< float, unsigned char >

Definition at line 290 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< int, int >

Definition at line 310 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< short, short >

Definition at line 302 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned char, char >

Definition at line 293 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned char, float >

Definition at line 289 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned char, unsigned char >

Definition at line 287 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned short, float >

Definition at line 314 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned short, int >

Definition at line 318 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned short, short >

Definition at line 306 of file PlanarRectification.cpp.

template class BIASImage_EXPORT BIAS::PlanarRectification< unsigned short, unsigned short >

Definition at line 298 of file PlanarRectification.cpp.

class BIASGeometry_EXPORT BIAS::PMatrix
class BIASGeometry_EXPORT BIAS::Pose

Definition at line 56 of file Triangulation.hh.

class BIASCommon_EXPORT BIAS::ProgressSemaphore

Definition at line 15 of file ProgressSemaphorePool.hh.

class BIASGeometry_EXPORT BIAS::ProjectionParametersBase

Definition at line 55 of file Triangulation.hh.

template<class T >
class BIASGeometryBase_EXPORT BIAS::Quaternion

Definition at line 37 of file RMatrixBase.hh.

Referenced by BIAS::Quaternion< T >::Mult().

class BIASGLviewer_EXPORT BIAS::RenderContextBase

Definition at line 27 of file SceneText.hh.

freenect_video_format BIAS::requested_format = FREENECT_VIDEO_BAYER

Definition at line 53 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_().

unsigned char* BIAS::rgb_back

Definition at line 50 of file VideoSource_Kinect_win32.cpp.

Referenced by FreenectThreadFunc_(), and VideoCallback().

unsigned char * BIAS::rgb_front

Definition at line 50 of file VideoSource_Kinect_win32.cpp.

unsigned char * BIAS::rgb_mid

Definition at line 50 of file VideoSource_Kinect_win32.cpp.

Referenced by VideoCallback().

class BIASGeometryBase_EXPORT BIAS::RMatrixBase

Definition at line 52 of file PMatrixBase.hh.

class BIASGLviewer_EXPORT BIAS::SceneBGImage

Definition at line 25 of file GLProjectionParametersBase.hh.

bool BIAS::SingletonDebugOutput_ = false

This variable is defined in Singleton.cpp and steers the debug output of all Singleton classes.

Definition at line 27 of file Singleton.cpp.

Referenced by BIAS::Singleton< T >::DeleteInstance_(), and BIAS::Singleton< T >::GetInstance().

bool BIAS::switch_

Definition at line 68 of file VideoSource_Kinect_win32.cpp.

template<class T >
class BIASMathBase_EXPORT BIAS::SymmetricMatrix3x3

Definition at line 35 of file SymmetricMatrix3x3.hh.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseAffine2< float >

Definition at line 1105 of file TrackerBaseAffine2.cpp.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseAffine2< unsigned char >

Definition at line 1104 of file TrackerBaseAffine2.cpp.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseAffine< float >

Definition at line 1062 of file TrackerBaseAffine.cpp.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseAffine< unsigned char >

Definition at line 1061 of file TrackerBaseAffine.cpp.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseHomography< float >

Definition at line 187 of file TrackerBaseHomography.cpp.

template class BIASMatcher2D_EXPORT BIAS::TrackerBaseHomography< unsigned char >

Definition at line 186 of file TrackerBaseHomography.cpp.

int BIAS::triTable[256][16]

Definition at line 75 of file MarchingCubes.cpp.

Referenced by BIAS::MarchingCubes::PolygoniseCube().

const int BIAS::UDP_PACKAGE_SIZE = 40000
class BIASImageBase_EXPORT BIAS::UUID

forward declaration for stream operators

Definition at line 64 of file UUID.hh.

Referenced by BIAS::ImageBase::ImageBase(), BIAS::UUID::IsConsecutive(), and operator>>().

template<class T >
class BIASMathBase_EXPORT BIAS::Vector

Definition at line 35 of file PoseParametrizationCovariance.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Vector2

Definition at line 45 of file Matrix2x2.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Vector3

Definition at line 44 of file Operators.hh.

template<class T >
class BIASMathBase_EXPORT BIAS::Vector4

Definition at line 46 of file Operators.hh.

class BIASVideoSource_EXPORT BIAS::VideoSourceCapabilities

Definition at line 48 of file VideoSource_Base.hh.