| Calvar::AlvarLoader | |
| ►Calvar::Bitset | Bitset is a basic class for handling bit sequences | 
| ►Calvar::Camera | Simple Camera class for calculating distortions, orientation or projections with pre-calibrated camera | 
| Calvar::CameraMoves | |
| ►Calvar::Capture | Capture interface that plugins must implement | 
| 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::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 | |
| 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 | |
| ►Calvar::ExternalContainer | Basic structure to be usable with EC methods | 
| Calvar::TrackerOrientation::Feature | |
| ►CFernClassifier | |
| 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::FilterArray< F > | Class for handling an array of filtered values | 
| ►Calvar::Histogram | Class for N-dimensional Histograms | 
| 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 | |
| ►CIVideoCallback | |
| ►Calvar::KalmanCore | Core implementation for Kalman | 
| ►Calvar::KalmanSensorCore | Core implementation for Kalman sensor | 
| Calvar::KalmanVisualize | Class for visualizing Kalman filter | 
| ►Calvar::Labeling | Base class for labeling connected components from binary image | 
| Calvar::Line | Struct representing a line. The line is parametrized by its center and direction vector | 
| ►Calvar::Marker | Basic 2D Marker functionality | 
| ►Calvar::MarkerDetectorImpl | Templateless version of MarkerDetector. Please use MarkerDetector instead | 
| Car_track_alvar::MedianFilter | |
| ►Calvar::MultiMarker | Base class for using MultiMarker | 
| 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::Rotation | Rotation structure and transformations between different parameterizations | 
| ►Cruntime_error | |
| 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 | |
| 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::TrifocalTensor | Trifocal tensor works for three images like a fundamental matrix works for two images | 
| ►Calvar::Uncopyable | Uncopyable for preventing object copies | 
| 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 |