Calvar::AlvarLoader | |
►Calvar::Bitset | Bitset is a basic class for handling bit sequences |
Calvar::BitsetExt | An extended Bitset ( BitsetExt ) for handling e.g. Hamming encoding/decoding |
►Calvar::Camera | Simple Camera class for calculating distortions, orientation or projections with pre-calibrated camera |
Calvar::CameraEC | Version of Camera using external container |
Calvar::CameraMoves | |
►Calvar::Capture | Capture interface that plugins must implement |
Calvar::plugins::CaptureCmu | Implementation of Capture interface for Cmu plugin |
Calvar::plugins::CaptureDSCapture | Implementation of Capture interface for DSCapture plugin |
Calvar::plugins::CaptureFile | Implementation of Capture interface for File plugin |
Calvar::plugins::CaptureHighgui | Implementation of Capture interface for Highgui plugin |
Calvar::plugins::CapturePtgrey | Implementation of Capture interface for Ptgrey plugin |
Calvar::CaptureDevice | CaptureDevice holder for camera information |
Calvar::CaptureFactory | CaptureFactory for creating Capture classes |
Calvar::CaptureFactory::CaptureFactoryDestroyer | CaptureFactoryDestroyer for deleting the CaptureFactory singleton |
Calvar::CaptureFactoryPrivate | |
►Calvar::CapturePlugin | CapturePlugin interface that plugins must implement |
Calvar::plugins::CapturePluginCmu | Implementation of CapturePlugin interface for Cmu plugin |
Calvar::plugins::CapturePluginDSCapture | Implementation of CapturePlugin interface for DSCapture plugin |
Calvar::plugins::CapturePluginFile | Implementation of CapturePlugin interface for File plugin |
Calvar::plugins::CapturePluginHighgui | Implementation of CapturePlugin interface for Highgui plugin |
Calvar::plugins::CapturePluginPtgrey | Implementation of CapturePlugin interface for Ptgrey plugin |
Calvar::Container3d< T > | Generic container to store any information in 3D (features, photos, ...) |
Calvar::Container3dLimitDist< T > | Functor class for Container3d Limit() to limit the search space with distance |
Calvar::Container3dSortDist< T > | Functor class for Container3d Sort() to sort the search base using distance to specified origin |
Calvar::Container3dSortSize< T > | Functor class for Container3d Sort() to sort the search base using content size |
►CCvPoint2D64f | |
Calvar::Point< CvPoint2D64f > | |
CCvTestbed | CvTestbed is a class for making quick OpenCV test applications |
Calvar::DirectoryIterator | DirectoryIterator for iterating over files and directories |
Calvar::DirectoryIteratorPrivate | |
Calvar::DirectoryIteratorPrivateData | |
Calvar::DoEraseTest< T > | This is default functor for testing which items in the container should be erased |
Calvar::DoHandleTest< T > | This is a default functor for testing which items in the container should be handled by each method |
►CDrawable | |
COwnDrawable | |
COwnDrawable | |
►Calvar::ExternalContainer | Basic structure to be usable with EC methods |
Calvar::SimpleSfM::Feature | Extended version of ExternalContainer structure used internally in SimpleSfM |
Calvar::TrackerOrientation::Feature | |
►CFernClassifier | |
Calvar::FernClassifierWrapper | FernClassifier subclass that implements binary reading and writting |
Calvar::FernImageDetector | Image detector based on a Fern classifier |
Calvar::FernPoseEstimator | Pose estimation class for FernImageDetector |
Calvar::FileFormatUtils | Utility functions for file reading / writing |
►Calvar::Filter | Filter is pure virtual class describing the basic virtual interface for all filters |
►Calvar::FilterAverage | FilterAverage provides an average filter |
Calvar::FilterMedian | FilterMedian provides an median filter |
►Calvar::FilterRunningAverage | FilterRunningAverage provides an weighted running average filter |
Calvar::FilterDoubleExponentialSmoothing | FilterDoubleExponentialSmoothing provides an weighted running average filter |
Calvar::FilterArray< F > | Class for handling an array of filtered values |
►Calvar::Histogram | Class for N-dimensional Histograms |
Calvar::HistogramSubpixel | N-dimensional Histograms calculating also the subpixel average for max bin |
Calvar::Homography | Simple Homography class for finding and projecting points between two planes |
CCvTestbed::Image | Image structure to store the images internally |
Calvar::Index | Class for N-dimensional index to be used e.g. with STL maps |
Calvar::IntegralGradient | IntegralGradient is used for calculating rectangular image gradients rapidly |
Calvar::IntegralImage | IntegralImage is used for calculating rectangular image sums and averages rapidly |
Calvar::IntIndex | Class for calculating "evenly spaced" integer indices for data sequence |
►Citerator | |
Calvar::Container3d< T >::Iterator | Iterator for going through the items in Container3d in the specified order |
►Calvar::MarkerIterator | Iterator type for traversing templated Marker vector without the template |
Calvar::MarkerIteratorImpl< T > | Iterator implementation for traversing templated Marker vector without the template |
►CIVideoCallback | |
Calvar::plugins::CaptureDSCapture::VideoSampler | |
►Calvar::KalmanCore | Core implementation for Kalman |
►Calvar::Kalman | Kalman implementation |
►Calvar::KalmanEkf | Extended Kalman Filter (EKF) implementation |
CKalmanOwn | |
►Calvar::KalmanSensorCore | Core implementation for Kalman sensor |
►Calvar::KalmanSensor | Kalman sensor implementation |
►Calvar::KalmanSensorEkf | Extended Kalman Filter (EKF) sensor implementation |
CKalmanSensorOwn | |
Calvar::KalmanVisualize | Class for visualizing Kalman filter |
►Calvar::Labeling | Base class for labeling connected components from binary image |
Calvar::LabelingCvSeq | Labeling class that uses OpenCV routines to find connected components |
Calvar::Line | Struct representing a line. The line is parametrized by its center and direction vector |
►Calvar::Marker | Basic 2D Marker functionality |
Calvar::MarkerArtoolkit | MarkerArtoolkit for using matrix markers similar with the ones used in ARToolkit |
Calvar::MarkerData | MarkerData contains matrix of Hamming encoded data |
Calvar::MultiMarkerInitializer::MarkerMeasurement | MarkerMeasurement that holds the maker id |
►Calvar::MarkerDetectorImpl | Templateless version of MarkerDetector. Please use MarkerDetector instead |
►Calvar::MarkerDetector< M > | MarkerDetector for detecting markers of type M |
Calvar::MarkerDetectorEC< M > | Version of MarkerDetector using external container |
►Calvar::MarkerDetector< alvar::MarkerData > | |
Calvar::MarkerDetectorEC< alvar::MarkerData > | |
Car_track_alvar::MedianFilter | |
►Calvar::MultiMarker | Base class for using MultiMarker |
Calvar::MultiMarkerBundle | Multi marker that uses bundle adjustment to refine the 3D positions of the markers (point cloud) |
Calvar::MultiMarkerEC | Version of MultiMarker using external container |
Calvar::MultiMarkerFiltered | Multi marker that is constructed by first calculating the marker poses directly relative to base marker and then filtering the results using e.g. median filter |
Calvar::MultiMarkerInitializer | Initializes multi marker by estimating their relative positions from one or more images |
Calvar::Mutex | Mutex for synchronizing multiple threads |
Calvar::MutexPrivate | |
Calvar::MutexPrivateData | |
Calvar::Optimization | Non-linear optimization routines. There are three methods implemented that include Gauss-Newton, Levenberg-Marquardt and Tukey m-estimator |
Car_track_alvar::PlaneFitResult | |
Calvar::Plugin | Plugin for loading dynamic libraries |
Calvar::PluginPrivate | |
Calvar::PluginPrivateData | |
Calvar::ProjectParams | |
Calvar::ProjPoints | Simple structure for collecting 2D and 3D points e.g. for camera calibration |
►Calvar::RansacImpl | Internal implementation of RANSAC. Please use Ransac or IndexRansac |
Calvar::IndexRansac< MODEL > | Implementation of a general RANdom SAmple Consensus algorithm with implicit parameters |
Calvar::Ransac< MODEL, PARAMETER > | Implementation of a general RANdom SAmple Consensus algorithm |
►Calvar::Rotation | Rotation structure and transformations between different parameterizations |
Calvar::Pose | Pose representation derived from the Rotation class |
►Cruntime_error | |
Calvar::AlvarException | ALVAR exception class |
Calvar::Serialization | Class for serializing class content to/from file or std::iostream |
Calvar::SerializationFormatterXml | |
Calvar::SimpleSfM | Simple structure from motion implementation using CameraEC , MarkerDetectorEC and TrackerFeaturesEC |
Calvar::StartThreadParameters | |
CState | |
►CTestCase | |
Ctest_ar.TestArAlvarRos | |
Calvar::Threads | Threads vector for handling multiple threads |
Calvar::ThreadsPrivate | |
Calvar::ThreadsPrivateData | |
Calvar::Timer | Timer for measuring execution time |
Calvar::TimerPrivate | |
Calvar::TimerPrivateData | |
►Calvar::Tracker | Pure virtual base class for tracking optical flow |
►Calvar::TrackerFeatures | TrackerFeatures tracks features using OpenCV's cvGoodFeaturesToTrack and cvCalcOpticalFlowPyrLK |
Calvar::TrackerFeaturesEC | Version of TrackerFeatures using external container |
Calvar::TrackerOrientation | Track orientation based only on features in the image plane |
►Calvar::TrackerPsa | TrackerPsa implements a very simple PSA tracker |
Calvar::TrackerPsaRot | TrackerPsaRot implements a slightly extended version of a TrackerPsa which can also detect sideways rotation |
►Calvar::TrackerStat | TrackerStat deduces the optical flow based on tracked features using Seppo Valli's statistical tracking |
Calvar::TrackerStatRot | TrackerStatRot implements a slightly extended version of TrackerStat which can also detect sideways rotation |
Calvar::TrifocalTensor | Trifocal tensor works for three images like a fundamental matrix works for two images |
►Calvar::Uncopyable | Uncopyable for preventing object copies |
Calvar::Lock | Lock for simplifying mutex handling |
Calvar::UnscentedKalman | Implementation of unscented kalman filter (UKF) for filtering non-linear processes |
Calvar::UnscentedObservation | Observation model for an unscented kalman filter |
Calvar::UnscentedProcess | Process model for an unscented kalman filter |
►CC | |
Calvar::Point< C, D > | Simple Point class meant to be inherited from OpenCV point-classes. For example: Point<CvPoint2D64f> p |