Copen3d::ml::impl::Accumulator< TReal, TFeat, POS_FN, FEAT_FN > | |
Copen3d::ml::impl::AccumulatorBackprop< TReal, TFeat, POS_FN, FEAT_FN > | |
Copen3d::ml::impl::Adaptor< T > | Adaptor for nanoflann |
Copen3d::core::AdvancedIndexer | |
Copen3d::core::AdvancedIndexPreprocessor | This class is based on PyTorch's aten/src/ATen/native/Indexing.cpp |
Copen3d::visualization::gui::Application | |
Copen3d::FunctionTraits< ReturnType(Args...)>::arg< i > | |
Copen3d::io::rpc::messages::Array | |
Copen3d::io::ArrayAdapter< T > | |
Copen3d::t::io::AttributePtr | |
Copen3d::t::io::PLYReaderState::AttrState | |
Copen3d::geometry::AvgColorVoxel | Class to aggregate color values from different votes in one voxel Computes the average color value in the voxel |
Copen3d::geometry::BallPivoting | |
Copen3d::geometry::BallPivotingEdge | |
Copen3d::geometry::BallPivotingTriangle | |
Copen3d::geometry::BallPivotingVertex | |
Copen3d::BinaryFunctionTraits< T > | |
Copen3d::core::Blob | |
Copen3d::visualization::rendering::FilamentResourceManager::BoxedResource< ResourceType > | |
Copen3d::visualization::rendering::RenderToBuffer::Buffer | |
Copen3d::core::Cacher | |
►Copen3d::visualization::rendering::Camera | |
Copen3d::visualization::rendering::FilamentCamera | |
Copen3d::io::rpc::messages::CameraData | Struct for storing camera data |
Copen3d::utility::filesystem::CFile | |
Copen3d::t::io::CharVector | |
►CCivetHandler | |
Copen3d::visualization::webrtc_server::RequestHandler | |
►CCivetServer | |
Copen3d::visualization::webrtc_server::HttpServerRequestHandler | |
Copen3d::visualization::gui::Color | |
Copen3d::t::geometry::kernel::tsdf::ColoredVoxel16i | |
Copen3d::t::geometry::kernel::tsdf::ColoredVoxel32f | |
Copen3d::visualization::rendering::ColorGradingParams | Manages |
►Copen3d::visualization::ColorMap | |
Copen3d::visualization::ColorMapGray | |
Copen3d::visualization::ColorMapHot | |
Copen3d::visualization::ColorMapJet | See Matlab's Jet colormap |
Copen3d::visualization::ColorMapSummer | See Matlab's Summer colormap |
Copen3d::visualization::ColorMapWinter | See Matlab's Winter colormap |
►Copen3d::io::rpc::ConnectionBase | Base class for all connections |
Copen3d::io::rpc::BufferConnection | Implements a connection writing to a buffer |
Copen3d::io::rpc::Connection | |
Copen3d::utility::ConsoleProgressUpdater | Update_progress(double percent) functor for ProgressBar |
Copen3d::utility::constexpr_optional_base< T > | |
Copen3d::utility::constexpr_storage_t< T > | |
Copen3d::core::Tensor::ConstIterator | Const iterator for Tensor |
Copen3d::geometry::poisson::ConstraintDual< Dim, Real > | |
Copen3d::visualization::gui::Widget::Constraints | |
Copen3d::t::pipelines::slac::ControlGrid | |
Copen3d::t::geometry::kernel::tsdf::Coord3i | |
Copen3d::t::geometry::kernel::voxel_grid::Coord3i | |
Copen3d::t::geometry::kernel::tsdf::Coord3iHash | |
Copen3d::t::geometry::kernel::voxel_grid::Coord3iHash | |
►Copen3d::pipelines::registration::CorrespondenceChecker | Base class that checks if two (small) point clouds can be aligned |
Copen3d::pipelines::registration::CorrespondenceCheckerBasedOnDistance | Check if two aligned point clouds are close |
Copen3d::pipelines::registration::CorrespondenceCheckerBasedOnEdgeLength | Check if two point clouds build the polygons with similar edge lengths |
Copen3d::pipelines::registration::CorrespondenceCheckerBasedOnNormal | Class to check if two aligned point clouds have similar normals |
Copen3d::ml::op_util::CountArgs< args > | |
Copen3d::utility::CountingProgressReporter | |
Copen3d::visualization::gui::FontDescription::CPRange | |
Copen3d::core::kernel::CPUArgReductionEngine | |
Copen3d::core::CPUHashBackendBufferAccessor | |
Copen3d::utility::CPUInfo | CPU information |
Copen3d::core::kernel::CPUReductionEngine | |
Copen3d::core::CUDAHashBackendBufferAccessor | |
►CCustomClassHolder | |
CRaggedTensor | |
Copen3d::core::nns::NanoFlannIndexHolder< METRIC, TReal, TIndex >::DataAdaptor | This class is the Adaptor for connecting Open3D Tensor and NanoFlann |
Copen3d::data::Dataset | Base Open3D dataset class |
Copen3d::core::Device | |
►Copen3d::core::DeviceHashBackend | |
Copen3d::core::SlabHashBackend< Key, Hash, Eq > | |
Copen3d::core::StdGPUHashBackend< Key, Hash, Eq > | |
Copen3d::core::TBBHashBackend< Key, Hash, Eq > | |
►Copen3d::core::DeviceMemoryManager | Interface for all concrete memory manager classses |
Copen3d::core::CachedMemoryManager | |
Copen3d::core::CPUMemoryManager | |
Copen3d::ml::op_util::Dim | Class for dimensions for which the value should be inferred |
Copen3d::ml::op_util::DimValue | Class for representing a possibly unknown dimension value |
Copen3d::ml::op_util::DimX< TLeft, TRight, TOp > | Dim expression class |
Copen3d::ml::op_util::DimXDivide | |
Copen3d::ml::op_util::DimXMinus | |
Copen3d::ml::op_util::DimXMultiply | |
Copen3d::ml::op_util::DimXOr | |
Copen3d::ml::op_util::DimXPlus | |
Copen3d::visualization::gui::DirEntry | |
CDLContext | A Device context for Tensor and operator |
CDLDataType | The data type the tensor can hold |
CDLManagedTensor | C Tensor object, manage memory of DLTensor. This data structure is intended to facilitate the borrowing of DLTensor by another framework. It is not meant to transfer the tensor. When the borrowing framework doesn't need the tensor, it should call the deleter to notify the host that the resource is no longer needed |
CDLTensor | Plain C Tensor object, does not manage memory |
►Copen3d::t::geometry::DrawableGeometry | Mix-in class for geometry types that can be visualized |
Copen3d::t::geometry::LineSet | A LineSet contains points and lines joining them and optionally attributes on the points and lines |
Copen3d::t::geometry::PointCloud | A point cloud contains a list of 3D points |
Copen3d::t::geometry::TriangleMesh | A triangle mesh contains vertices and triangles |
Copen3d::visualization::DrawAction | |
Copen3d::visualization::gui::DrawContext | |
Copen3d::visualization::DrawObject | |
Copen3d::visualization::visualizer::O3DVisualizer::DrawObject | |
Copen3d::visualization::gui::UIImage::DrawParams | |
Copen3d::core::Dtype | |
Copen3d::visualization::rendering::EngineInstance | |
Copen3d::visualization::gui::Application::EnvUnlocker | |
Copen3d::pipelines::registration::FastGlobalRegistrationOption | Options for FastGlobalRegistration |
Copen3d::pipelines::registration::Feature | Class to store featrues for registration |
Copen3d::geometry::poisson::FEMTreeProfiler< Dim, Real > | |
Copen3d::visualization::rendering::FilamentResourceManager | |
►CFixedRadiusSearchOpKernel | |
CFixedRadiusSearchOpKernelCPU< T > | |
Copen3d::visualization::gui::FontContext | |
Copen3d::visualization::gui::FontDescription | |
Copen3d::t::pipelines::slam::Frame | Frame is a container class storing an intrinsic matrix and several 2D tensors, from depth map, vertex map, to color map, in a customized way |
►CFunctionTraits | |
Copen3d::FunctionTraits< T & > | |
Copen3d::FunctionTraits< T * > | |
Copen3d::FunctionTraits< T ClassType::* > | |
Copen3d::core::FunctionTraits< T > | |
►Copen3d::FunctionTraits< ReturnType(Args...)> | |
Copen3d::FunctionTraits< ReturnType(ClassType::*)(Args...) const > | |
►Copen3d::t::geometry::Geometry | The base geometry class |
Copen3d::t::geometry::Image | Stores image with customizable rows, cols, channels, dtype and device |
Copen3d::t::geometry::LineSet | A LineSet contains points and lines joining them and optionally attributes on the points and lines |
Copen3d::t::geometry::PointCloud | A point cloud contains a list of 3D points |
Copen3d::t::geometry::RGBDImage | RGBDImage A pair of color and depth images |
Copen3d::t::geometry::TriangleMesh | A triangle mesh contains vertices and triangles |
►Copen3d::geometry::Geometry | The base geometry class |
►Copen3d::geometry::Geometry2D | The base geometry class for 2D geometries |
Copen3d::geometry::Image | Stores image with customizable width, height, num of channels and bytes per channel |
Copen3d::geometry::RGBDImage | RGBDImage is for a pair of registered color and depth images, |
Copen3d::visualization::SelectionPolygon | |
►Copen3d::geometry::Geometry3D | The base geometry class for 3D geometries |
Copen3d::geometry::AxisAlignedBoundingBox | A bounding box that is aligned along the coordinate axes |
Copen3d::geometry::LineSet | LineSet define a sets of lines in 3D. A typical application is to display the point cloud correspondence pairs |
►Copen3d::geometry::MeshBase | MeshBash Class |
Copen3d::geometry::HalfEdgeTriangleMesh | HalfEdgeTriangleMesh inherits TriangleMesh class with the addition of HalfEdge data structure for each half edge in the mesh as well as related functions |
Copen3d::geometry::TetraMesh | Tetra mesh contains vertices and tetrahedra represented by the indices to the vertices |
Copen3d::geometry::TriangleMesh | Triangle mesh contains vertices and triangles represented by the indices to the vertices |
Copen3d::geometry::Octree | Octree datastructure |
Copen3d::geometry::OrientedBoundingBox | A bounding box oriented along an arbitrary frame of reference |
Copen3d::geometry::PointCloud | A point cloud consists of point coordinates, and optionally point colors and point normals |
Copen3d::geometry::VoxelGrid | VoxelGrid is a collection of voxels which are aligned in grid |
Copen3d::visualization::PointCloudPicker | A utility class to store picked points of a pointcloud |
►Copen3d::visualization::rendering::GeometryBuffersBuilder | |
►Copen3d::visualization::rendering::LineSetBuffersBuilder | |
Copen3d::visualization::rendering::TemporaryLineSetBuilder | |
Copen3d::visualization::rendering::PointCloudBuffersBuilder | |
Copen3d::visualization::rendering::TLineSetBuffersBuilder | |
Copen3d::visualization::rendering::TMeshBuffersBuilder | |
Copen3d::visualization::rendering::TPointCloudBuffersBuilder | |
►Copen3d::visualization::rendering::TriangleMeshBuffersBuilder | |
Copen3d::visualization::rendering::TemporaryMeshBuilder | |
►Copen3d::visualization::glsl::GeometryRenderer | |
Copen3d::visualization::glsl::AxisAlignedBoundingBoxRenderer | |
Copen3d::visualization::glsl::CoordinateFrameRenderer | |
Copen3d::visualization::glsl::ImageRenderer | |
Copen3d::visualization::glsl::LineSetRenderer | |
Copen3d::visualization::glsl::OctreeRenderer | |
Copen3d::visualization::glsl::OrientedBoundingBoxRenderer | |
Copen3d::visualization::glsl::PointCloudPickerRenderer | |
Copen3d::visualization::glsl::PointCloudPickingRenderer | |
Copen3d::visualization::glsl::PointCloudRenderer | |
Copen3d::visualization::glsl::RGBDImageRenderer | |
Copen3d::visualization::glsl::SelectionPolygonRenderer | |
Copen3d::visualization::glsl::TetraMeshRenderer | |
Copen3d::visualization::glsl::TriangleMeshRenderer | |
Copen3d::visualization::glsl::VoxelGridRenderer | |
Copen3d::io::rpc::messages::GetMeshData | Struct for defining a "get_mesh_data" message, which requests mesh data |
Copen3d::pipelines::registration::GlobalOptimizationConvergenceCriteria | Convergence criteria of GlobalOptimization |
►Copen3d::pipelines::registration::GlobalOptimizationMethod | Base class for global optimization method |
Copen3d::pipelines::registration::GlobalOptimizationGaussNewton | Global optimization with Gauss-Newton algorithm |
Copen3d::pipelines::registration::GlobalOptimizationLevenbergMarquardt | Global optimization with Levenberg-Marquardt algorithm |
Copen3d::pipelines::registration::GlobalOptimizationOption | Option for GlobalOptimization |
Copen3d::visualization::rendering::Gradient | |
Copen3d::visualization::GuiSettingsModel | |
Copen3d::geometry::HalfEdgeTriangleMesh::HalfEdge | HalfEdge class contains vertex, triangle info about a half edge, as well as relations of next and twin half edge |
Copen3d::utility::detail_::has_overloaded_addressof< T > | |
Cstd::hash< open3d::core::Device > | |
Cstd::hash< open3d::utility::optional< T & > > | |
Cstd::hash< open3d::utility::optional< T > > | |
Copen3d::utility::hash_eigen< T > | |
Copen3d::utility::hash_enum_class | |
Copen3d::utility::hash_tuple< TT > | |
Copen3d::utility::hash_tuple< std::tuple< TT... > > | |
Copen3d::core::HashBackendBuffer | |
Copen3d::core::HashMap | |
Copen3d::core::HashSet | |
Copen3d::core::HashBackendBuffer::HeapTop | |
Copen3d::visualization::webrtc_server::IceServer | |
Copen3d::pipelines::registration::ICPConvergenceCriteria | Class that defines the convergence criteria of ICP |
Copen3d::t::pipelines::registration::ICPConvergenceCriteria | Class that defines the convergence criteria of ICP |
►Copen3d::utility::IJsonConvertible | |
Copen3d::camera::PinholeCameraIntrinsic | Contains the pinhole camera intrinsic parameters |
Copen3d::camera::PinholeCameraParameters | Contains both intrinsic and extrinsic pinhole camera parameters |
Copen3d::camera::PinholeCameraTrajectory | |
Copen3d::geometry::Octree | Octree datastructure |
►Copen3d::geometry::OctreeNode | The base class for octree node |
►Copen3d::geometry::OctreeInternalNode | OctreeInternalNode class, containing OctreeNode children |
Copen3d::geometry::OctreeInternalPointNode | OctreeInternalPointNode class is an OctreeInternalNode containing a list of indices which is the union of all its children's list of indices |
►Copen3d::geometry::OctreeLeafNode | OctreeLeafNode base class |
►Copen3d::geometry::OctreeColorLeafNode | OctreeColorLeafNode class is an OctreeLeafNode containing color |
Copen3d::geometry::OctreePointColorLeafNode | OctreePointColorLeafNode class is an OctreeColorLeafNode containing a list of indices corresponding to the point cloud points contained in this leaf node |
Copen3d::io::MKVMetadata | |
►Copen3d::io::RGBDSensorConfig | |
Copen3d::io::AzureKinectSensorConfig | |
Copen3d::t::io::RealSenseSensorConfig | |
Copen3d::pipelines::color_map::ImageWarpingField | |
Copen3d::pipelines::registration::PoseGraph | Data structure defining the pose graph |
Copen3d::pipelines::registration::PoseGraphEdge | Edge of PoseGraph |
Copen3d::pipelines::registration::PoseGraphNode | Node of PoseGraph |
Copen3d::t::io::RGBDVideoMetadata | RGBD video metadata |
Copen3d::t::io::TSDFVoxelGridMetadata | |
►Copen3d::visualization::RenderOption | Defines rendering options for visualizer |
Copen3d::visualization::RenderOptionWithEditing | |
Copen3d::visualization::SelectionPolygonVolume | Select a polygon volume for cropping |
Copen3d::visualization::ViewParameters | |
Copen3d::visualization::ViewTrajectory | |
Copen3d::visualization::gui::ImguiFilamentBridge | |
Copen3d::visualization::gui::TabControl::Impl | |
Copen3d::visualization::gui::Task::Impl | |
Copen3d::visualization::gui::TextEdit::Impl | |
Copen3d::visualization::gui::ToggleSwitch::Impl | |
Copen3d::visualization::gui::LUTTreeCell::Impl | |
Copen3d::visualization::gui::ColormapTreeCell::Impl | |
Copen3d::visualization::gui::CheckableTextTreeCell::Impl | |
Copen3d::visualization::gui::TreeView::Impl | |
Copen3d::visualization::gui::UIImage::Impl | |
Copen3d::visualization::gui::VectorEdit::Impl | |
Copen3d::visualization::gui::Widget::Impl | |
Copen3d::visualization::gui::Window::Impl | |
Copen3d::t::geometry::RaycastingScene::Impl | |
Ccore::Tensor::Iterator::Impl | |
Copen3d::utility::CPUInfo::Impl | |
Copen3d::visualization::GuiVisualizer::Impl | |
Ccore::Tensor::ConstIterator::Impl | |
Copen3d::visualization::visualizer::O3DVisualizer::Impl | |
Copen3d::visualization::webrtc_server::WebRTCWindowSystem::Impl | |
Copen3d::utility::ISAInfo::Impl | |
Copen3d::utility::Logger::Impl | |
►Copen3d::core::TensorKey::Impl | |
Copen3d::core::TensorKey::IndexImpl | |
Copen3d::core::TensorKey::IndexTensorImpl | |
Copen3d::core::TensorKey::SliceImpl | |
Copen3d::visualization::gui::Application::Impl | |
Copen3d::visualization::gui::BitmapWindowSystem::Impl | |
Copen3d::visualization::gui::Button::Impl | |
Copen3d::visualization::gui::Checkbox::Impl | |
Copen3d::visualization::gui::ColorEdit::Impl | |
Copen3d::visualization::gui::Combobox::Impl | |
Copen3d::visualization::gui::Dialog::Impl | |
Copen3d::visualization::gui::FileDialog::Impl | |
Copen3d::visualization::gui::ImageWidget::Impl | |
Copen3d::visualization::gui::ImguiFilamentBridge::Impl | |
Copen3d::visualization::gui::Label::Impl | |
Copen3d::visualization::gui::Label3D::Impl | |
Copen3d::visualization::gui::Layout1D::Impl | |
Copen3d::visualization::gui::CollapsableVert::Impl | |
Copen3d::visualization::gui::ScrollableVert::Impl | |
Copen3d::visualization::gui::VGrid::Impl | |
Copen3d::visualization::gui::ListView::Impl | |
Copen3d::visualization::gui::Menu::Impl | |
Copen3d::visualization::gui::MenuImgui::Impl | |
Copen3d::visualization::gui::NumberEdit::Impl | |
Copen3d::visualization::gui::ProgressBar::Impl | |
Copen3d::visualization::gui::SceneWidget::Impl | |
Copen3d::visualization::gui::Slider::Impl | |
Copen3d::visualization::gui::StackedWidget::Impl | |
Copen3d::utility::in_place_t | |
Copen3d::core::Indexer | |
Copen3d::core::IndexerIterator | |
Copen3d::utility::nullopt_t::init | |
Copen3d::core::tensor_init::InitializerDim< L > | |
Copen3d::core::tensor_init::InitializerDim< std::initializer_list< L > > | |
Copen3d::core::tensor_init::InitializerShapeImpl< D > | |
Copen3d::core::tensor_init::InitializerShapeImpl< 0 > | |
►CInputPointStreamWithData | |
Copen3d::geometry::poisson::Open3DPointStream< Real > | |
►Copen3d::io::IntArrayBase | |
Copen3d::io::IntArray< T > | |
Copen3d::visualization::gui::Interactors | |
Copen3d::ml::impl::InterpolationVec< T, VECSIZE, INTERPOLATION > | Class for computing interpolation weights |
Copen3d::ml::impl::InterpolationVec< T, VECSIZE, InterpolationMode::LINEAR > | Implementation for LINEAR (uses coordinate clamping) |
Copen3d::ml::impl::InterpolationVec< T, VECSIZE, InterpolationMode::LINEAR_BORDER > | Implementation for LINEAR_BORDER (uses zero border instead of clamping) |
Copen3d::ml::impl::InterpolationVec< T, VECSIZE, InterpolationMode::NEAREST_NEIGHBOR > | Implementation for NEAREST_NEIGHBOR |
Copen3d::geometry::IntersectionTest | |
►CInvertNeighborsListOpKernel | |
CInvertNeighborsListOpKernelCPU< TIndex, TAttr > | |
Copen3d::utility::ISAInfo | ISA information |
Copen3d::visualization::gui::TreeView::Impl::Item | |
Copen3d::core::Tensor::Iterator | Iterator for Tensor |
Copen3d::core::IndexerIterator::Iterator | |
Copen3d::core::iterator_t | |
Copen3d::geometry::KDTreeFlann | KDTree with FLANN for nearest neighbor search |
►Copen3d::geometry::KDTreeSearchParam | Base class for KDTree search parameters |
Copen3d::geometry::KDTreeSearchParamHybrid | KDTree search parameters for hybrid KNN and radius search |
Copen3d::geometry::KDTreeSearchParamKNN | KDTree search parameters for pure KNN search |
Copen3d::geometry::KDTreeSearchParamRadius | KDTree search parameters for pure radius search |
Copen3d::visualization::gui::KeyEvent | |
►CKnnSearchOpKernel | |
CKnnSearchOpKernelCPU< T > | |
Copen3d::visualization::gui::Label3D | |
Copen3d::visualization::gui::LayoutContext | |
Copen3d::visualization::rendering::Light | |
Copen3d::visualization::rendering::LightDescription | |
Copen3d::visualization::GuiSettingsModel::LightingProfile | |
Copen3d::visualization::GuiSettingsModel::LitMaterial | |
Copen3d::utility::Logger | Logger class should be used as a global singleton object (GetInstance()) |
►Clogic_error | |
Copen3d::utility::bad_optional_access | |
Copen3d::visualization::gui::Margins | |
Copen3d::visualization::rendering::Material | |
Copen3d::geometry::TriangleMesh::Material | |
►Copen3d::visualization::rendering::MaterialModifier | |
Copen3d::visualization::rendering::FilamentMaterialModifier | |
Copen3d::geometry::TriangleMesh::Material::MaterialParameter | |
Copen3d::visualization::gui::MaterialPool | |
Copen3d::visualization::rendering::MaterialRecord | |
Copen3d::visualization::GuiSettingsModel::Materials | |
►Copen3d::visualization::rendering::MatrixInteractorLogic | |
Copen3d::visualization::rendering::IBLRotationInteractorLogic | |
Copen3d::visualization::rendering::LightDirectionInteractorLogic | |
►Copen3d::visualization::rendering::RotationInteractorLogic | |
►Copen3d::visualization::rendering::CameraInteractorLogic | |
Copen3d::visualization::rendering::CameraSphereInteractorLogic | |
Copen3d::visualization::rendering::ModelInteractorLogic | |
Copen3d::core::nns::MemoryAllocation | A class for managing memory segments within a memory allocation |
Copen3d::ml::impl::MemoryAllocation | A class for managing memory segments within a memory allocation |
Copen3d::core::MemoryCache | |
Copen3d::core::MemoryManager | |
Copen3d::core::MemoryManagerStatistic | |
►Copen3d::visualization::gui::MenuBase | |
Copen3d::visualization::gui::Menu | |
Copen3d::visualization::gui::MenuImgui | |
Copen3d::visualization::gui::MenuMacOS | |
Copen3d::visualization::gui::MenuImgui::Impl::MenuItem | |
Copen3d::io::rpc::messages::MeshData | Struct for storing MeshData, e.g., PointClouds, TriangleMesh, . |
Copen3d::visualization::rendering::TriangleMeshModel::MeshInfo | |
►Copen3d::io::rpc::MessageProcessorBase | |
Copen3d::io::rpc::DummyMessageProcessor | |
Copen3d::visualization::MessageProcessor | |
Copen3d::utility::MiniVec< T, N > | |
Copen3d::t::geometry::kernel::tsdf::MiniVecCache | |
Copen3d::t::geometry::kernel::voxel_grid::MiniVecCache | |
Copen3d::utility::MiniVecEq< T, N > | |
Copen3d::utility::MiniVecHash< T, N > | |
Copen3d::io::MKVReader | |
Copen3d::io::MKVWriter | |
Copen3d::t::pipelines::slam::Model | |
Copen3d::visualization::Visualizer::MouseControl | |
Copen3d::visualization::gui::MouseEvent | |
►Copen3d::visualization::gui::SceneWidget::MouseInteractor | |
Copen3d::visualization::gui::FlyInteractor | |
Copen3d::visualization::gui::PickPointsInteractor | |
Copen3d::visualization::gui::RotateIBLInteractor | |
Copen3d::visualization::gui::RotateSunInteractor | |
►Copen3d::visualization::gui::RotationInteractor | |
►Copen3d::visualization::gui::RotateCameraInteractor | |
Copen3d::visualization::gui::PickInteractor | |
Copen3d::visualization::gui::RotateCameraSphereInteractor | |
Copen3d::visualization::gui::RotateModelInteractor | |
CNanoFlann | KDTree with NanoFlann for nearest neighbor search |
CNanoFlann | KDTree with NanoFlann for nearest neighbor search |
►Copen3d::core::nns::NanoFlannIndexHolderBase | Base struct for NanoFlann index holder |
Copen3d::core::nns::NanoFlannIndexHolder< METRIC, TReal, TIndex > | NanoFlann Index Holder |
Copen3d::core::nns::NearestNeighborSearch | A Class for nearest neighbor search |
Copen3d::core::nns::NeighborSearchAllocator< T, TIndex > | |
CNeighborSearchAllocator< T, TIndex > | |
Copen3d::core::tensor_init::NestedInitializerImpl< T, D > | |
Copen3d::core::tensor_init::NestedInitializerImpl< T, 0 > | |
►CNmsOpKernel | |
CNmsOpKernelCPU | |
►Copen3d::core::nns::NNSIndex | |
Copen3d::core::nns::FaissIndex | Faiss for nearest neighbor search |
Copen3d::core::nns::FixedRadiusIndex | FixedRadiusIndex for nearest neighbor range search |
Copen3d::core::nns::KnnIndex | |
Copen3d::core::nns::NanoFlannIndex | |
Copen3d::pipelines::color_map::NonRigidOptimizerOption | |
►CNotifier | |
►Copen3d::visualization::webrtc_server::BitmapTrackSource | |
Copen3d::visualization::webrtc_server::ImageTrackSource | |
Copen3d::visualization::webrtc_server::VideoFilter< T > | VideoFilter is a templated class for video frame processing |
Copen3d::NullaryFunctionTraits< T > | |
Copen3d::utility::nullopt_t | |
Copen3d::t::io::NumpyArray | |
Copen3d::visualization::visualizer::O3DVisualizerSelections | |
Copen3d::geometry::OctreeNodeInfo | OctreeNode's information |
Copen3d::t::pipelines::odometry::OdometryConvergenceCriteria | |
Copen3d::t::pipelines::odometry::OdometryLossParams | |
Copen3d::pipelines::odometry::OdometryOption | |
Copen3d::t::pipelines::odometry::OdometryResult | |
Copen3d::core::OffsetCalculator< NARGS, index_t > | |
Copen3d::geometry::poisson::Open3DData | |
Copen3d::core::Open3DDLManagedTensor | Open3D DLPack Tensor manager |
Copen3d::visualization::rendering::Open3DScene | |
Copen3d::geometry::poisson::Open3DVertex< _Real > | |
►COpKernel | |
CBallQueryOpKernel | |
►CBuildSpatialHashTableOpKernel | |
CBuildSpatialHashTableOpKernelCPU< T > | |
►CContinuousConvBackpropFilterOpKernel< TIndex > | |
CContinuousConvBackpropFilterOpKernelCPU< TFeat, TOut, TReal, TIndex > | |
►CContinuousConvOpKernel< TIndex > | |
CContinuousConvOpKernelCPU< TFeat, TOut, TReal, TIndex > | |
►CContinuousConvTransposeBackpropFilterOpKernel< TIndex > | |
CContinuousConvTransposeBackpropFilterOpKernelCPU< TFeat, TOut, TReal, TIndex > | |
►CContinuousConvTransposeOpKernel< TIndex > | |
CContinuousConvTransposeOpKernelCPU< TFeat, TOut, TReal, TIndex > | |
CFurthestPointSamplingOpKernel | |
CRoiPoolOpKernel | |
►CSparseConvBackpropFilterOpKernel< TIndex > | |
CSparseConvBackpropFilterOpKernelCPU< TFeat, TOut, TIndex, TKernelIndex > | |
►CSparseConvOpKernel< TIndex > | |
CSparseConvOpKernelCPU< TFeat, TOut, TIndex, TKernelIndex > | |
►CSparseConvTransposeBackpropFilterOpKernel< TIndex > | |
CSparseConvTransposeBackpropFilterOpKernelCPU< TFeat, TOut, TIndex, TKernelIndex > | |
►CSparseConvTransposeOpKernel< TIndex > | |
CSparseConvTransposeOpKernelCPU< TFeat, TOut, TIndex, TKernelIndex > | |
CThreeInterpolateGradOpKernel | |
CThreeInterpolateOpKernel | |
CThreeNNOpKernel | |
CTrilinearDevoxelizeGradOpKernel | |
CTrilinearDevoxelizeOpKernel | |
Copen3d::utility::optional< T & > | |
Copen3d::utility::optional< T && > | |
Copen3d::utility::optional_base< T > | |
►COptionalBase | |
Copen3d::utility::optional< T > | |
Copen3d::utility::optional< int64_t > | |
Copen3d::utility::optional< unsigned int > | |
Copen3d::utility::Overloaded< Ts > | |
►Copen3d::utility::Overloaded< Ts... > | |
Copen3d::utility::Overloaded< T1, Ts... > | |
Copen3d::core::Pair< First, Second > | |
►CParametrizedLine | |
►Copen3d::geometry::Line3D | Line3D is a class which derives from Eigen::ParametrizedLine<double, 3> in order to capture the semantic differences between a "line", "ray", and "line segment" for operations in which the difference is important, such as intersection and distance tests. The underlying Eigen object can always be retrieved with the .Line() method |
Copen3d::geometry::Ray3D | A ray is a semantic interpretation of Eigen::ParametrizedLine which has an origin and a direction and extends infinitely only in that specific direction |
Copen3d::geometry::Segment3D | A segment is a semantic interpretation of Eigen::ParametrizedLine which has an origin and an endpoint and exists finitely between them |
Copen3d::t::io::PCDHeader | |
Copen3d::t::io::PCLPointField | |
Copen3d::visualization::webrtc_server::PeerConnectionManager | |
Copen3d::visualization::gui::SceneWidget::PickableGeometry | |
Copen3d::visualization::VisualizerWithVertexSelection::PickedPoint | |
Copen3d::t::io::PLYReaderState | |
Copen3d::visualization::rendering::Gradient::Point | |
Copen3d::visualization::gui::Point | |
Copen3d::ml::contrib::Point | |
Copen3d::ml::contrib::PointCloud | |
Copen3d::core::PointerOrder< Block > | |
Copen3d::ml::contrib::PointXYZ | |
Copen3d::visualization::gui::Application::Impl::Posted | |
►Copen3d::utility::ProgressBar | |
Copen3d::utility::OMPProgressBar | |
Copen3d::visualization::rendering::Camera::ProjectionInfo | |
Copen3d::geometry::Qhull | |
Copen3d::geometry::Quadric | |
►CRadiusSearchOpKernel | |
CRadiusSearchOpKernelCPU< T > | |
Copen3d::pipelines::registration::RANSACConvergenceCriteria | Class that defines the convergence criteria of RANSAC |
Copen3d::geometry::RANSACResult | Stores the current best result in the RANSAC algorithm |
Copen3d::t::geometry::RaycastingScene | A scene class with basic ray casting and closest point queries |
Copen3d::t::io::ReadAttributePtr | |
Copen3d::io::ReadPointCloudOption | Optional parameters to ReadPointCloud |
Copen3d::io::ReadTriangleMeshOptions | |
Copen3d::io::ReadTriangleModelOptions | |
Copen3d::core::RealBlock | |
Copen3d::t::io::RealSenseValidConfigs | |
Copen3d::visualization::gui::Rect | |
►CReduceSubarraysSumOpKernel | |
CReduceSubarraysSumOpKernelCPU< T > | |
Copen3d::pipelines::registration::RegistrationResult | |
Copen3d::t::pipelines::registration::RegistrationResult | |
►Copen3d::visualization::rendering::REHandle_abstract | |
Copen3d::visualization::rendering::REHandle< entityType > | |
Copen3d::visualization::rendering::REHandle< EntityType::IndexBuffer > | |
Copen3d::visualization::rendering::REHandle< EntityType::Light > | |
Copen3d::visualization::rendering::REHandle< EntityType::MaterialInstance > | |
Copen3d::visualization::rendering::REHandle< EntityType::RenderTarget > | |
Copen3d::visualization::rendering::REHandle< EntityType::Scene > | |
Copen3d::visualization::rendering::REHandle< EntityType::Texture > | |
Copen3d::visualization::rendering::REHandle< EntityType::VertexBuffer > | |
Copen3d::visualization::rendering::REHandle< EntityType::View > | |
►Copen3d::visualization::rendering::Renderer | |
Copen3d::visualization::rendering::FilamentRenderer | |
Copen3d::visualization::rendering::RenderRequest | |
►Copen3d::visualization::rendering::RenderToBuffer | |
Copen3d::visualization::rendering::FilamentRenderToBuffer | |
Copen3d::io::rpc::messages::Reply | |
Copen3d::io::rpc::messages::Request | |
Copen3d::visualization::rendering::ResourceLoadRequest | |
►Copen3d::pipelines::odometry::RGBDOdometryJacobian | Base class that computes Jacobian from two RGB-D images |
Copen3d::pipelines::odometry::RGBDOdometryJacobianFromColorTerm | Class to compute Jacobian using color term |
Copen3d::pipelines::odometry::RGBDOdometryJacobianFromHybridTerm | Class to compute Jacobian using hybrid term |
►Copen3d::io::RGBDRecorder | |
Copen3d::io::AzureKinectRecorder | |
►Copen3d::io::RGBDSensor | |
Copen3d::io::AzureKinectSensor | |
►Copen3d::t::io::RGBDSensor | Interface class for control of RGBD cameras |
Copen3d::t::io::RealSenseSensor | RealSense camera discovery, configuration, streaming and recording |
►Copen3d::t::io::RGBDVideoReader | |
Copen3d::t::io::RSBagReader | |
Copen3d::pipelines::color_map::RigidOptimizerOption | |
Copen3d::t::pipelines::registration::RobustKernel | |
►Copen3d::pipelines::registration::RobustKernel | |
Copen3d::pipelines::registration::CauchyLoss | |
Copen3d::pipelines::registration::GMLoss | |
Copen3d::pipelines::registration::HuberLoss | |
Copen3d::pipelines::registration::L1Loss | |
Copen3d::pipelines::registration::L2Loss | |
Copen3d::pipelines::registration::TukeyLoss | |
Copen3d::ml::contrib::SampledData | |
Copen3d::core::Scalar | |
►Copen3d::visualization::rendering::Scene | |
Copen3d::visualization::rendering::FilamentScene | |
Copen3d::visualization::gui::ScissorRectKey | |
Copen3d::visualization::visualizer::O3DVisualizerSelections::SelectedIndex | |
Copen3d::visualization::gui::SelectionIndexLookup | |
Copen3d::core::nns::NanoFlannIndexHolder< METRIC, TReal, TIndex >::SelectNanoflannAdaptor< M, fake > | Adaptor Selector |
Copen3d::ml::impl::SelectNanoflannAdaptor< METRIC, T > | |
Copen3d::core::nns::NanoFlannIndexHolder< METRIC, TReal, TIndex >::SelectNanoflannAdaptor< L1, fake > | |
Copen3d::ml::impl::SelectNanoflannAdaptor< L1, T > | |
Copen3d::core::nns::NanoFlannIndexHolder< METRIC, TReal, TIndex >::SelectNanoflannAdaptor< L2, fake > | |
Copen3d::ml::impl::SelectNanoflannAdaptor< L2, T > | |
Copen3d::io::rpc::messages::SetActiveCamera | |
Copen3d::io::rpc::messages::SetCameraData | |
Copen3d::io::rpc::messages::SetMeshData | |
Copen3d::io::rpc::messages::SetProperties | |
Copen3d::io::rpc::messages::SetTime | |
Copen3d::visualization::GuiVisualizer::Impl::Settings | |
►Copen3d::visualization::glsl::ShaderWrapper | |
►Copen3d::visualization::glsl::ImageMaskShader | |
Copen3d::visualization::glsl::ImageMaskShaderForImage | |
►Copen3d::visualization::glsl::ImageShader | |
Copen3d::visualization::glsl::ImageShaderForImage | |
►Copen3d::visualization::glsl::NormalShader | |
Copen3d::visualization::glsl::NormalShaderForPointCloud | |
Copen3d::visualization::glsl::NormalShaderForTriangleMesh | |
►Copen3d::visualization::glsl::PhongShader | |
Copen3d::visualization::glsl::PhongShaderForPointCloud | |
Copen3d::visualization::glsl::PhongShaderForTriangleMesh | |
►Copen3d::visualization::glsl::PickingShader | |
Copen3d::visualization::glsl::PickingShaderForPointCloud | |
►Copen3d::visualization::glsl::RGBDImageShader | |
Copen3d::visualization::glsl::RGBDImageShaderForImage | |
►Copen3d::visualization::glsl::Simple2DShader | |
Copen3d::visualization::glsl::Simple2DShaderForSelectionPolygon | |
►Copen3d::visualization::glsl::SimpleBlackShader | |
Copen3d::visualization::glsl::SimpleBlackShaderForPointCloudNormal | |
Copen3d::visualization::glsl::SimpleBlackShaderForTriangleMeshWireFrame | |
►Copen3d::visualization::glsl::SimpleShader | |
Copen3d::visualization::glsl::SimpleShaderForAxisAlignedBoundingBox | |
Copen3d::visualization::glsl::SimpleShaderForLineSet | |
Copen3d::visualization::glsl::SimpleShaderForOctreeFace | |
Copen3d::visualization::glsl::SimpleShaderForOctreeLine | |
Copen3d::visualization::glsl::SimpleShaderForOrientedBoundingBox | |
Copen3d::visualization::glsl::SimpleShaderForPointCloud | |
Copen3d::visualization::glsl::SimpleShaderForTetraMesh | |
Copen3d::visualization::glsl::SimpleShaderForTriangleMesh | |
Copen3d::visualization::glsl::SimpleShaderForVoxelGridFace | |
Copen3d::visualization::glsl::SimpleShaderForVoxelGridLine | |
►Copen3d::visualization::glsl::TexturePhongShader | |
Copen3d::visualization::glsl::TexturePhongShaderForTriangleMesh | |
►Copen3d::visualization::glsl::TextureSimpleShader | |
Copen3d::visualization::glsl::TextureSimpleShaderForTriangleMesh | |
Copen3d::visualization::gui::Size | |
Copen3d::core::SizeOrder< Block > | |
Copen3d::core::Slab | |
Copen3d::core::SlabHashBackendImpl< Key, Hash, Eq > | |
Copen3d::core::SlabNodeManager | |
Copen3d::core::SlabNodeManagerImpl | |
Copen3d::t::pipelines::slac::SLACDebugOption | |
Copen3d::t::pipelines::slac::SLACOptimizerParams | |
Copen3d::io::rpc::messages::Status | |
Copen3d::core::StdAllocator< T > | |
Copen3d::core::StdGPUAllocator< T > | |
Copen3d::utility::storage_t< T > | |
Copen3d::geometry::poisson::SystemDual< Dim, Real > | |
Copen3d::geometry::poisson::SystemDual< Dim, double > | |
►CT1 | |
Copen3d::utility::Overloaded< T1 > | |
Copen3d::utility::Overloaded< T1, Ts... > | |
Copen3d::t::geometry::kernel::TArrayIndexer< index_t > | |
Copen3d::visualization::gui::Task | |
Copen3d::core::Tensor | |
Copen3d::core::TensorIterator | |
Copen3d::core::TensorKey | TensorKey is used to represent single index, slice or advanced indexing on a Tensor |
Copen3d::core::TensorList | |
Copen3d::core::TensorRef | A minimalistic class that reference a Tensor |
Copen3d::visualization::gui::TextInputEvent | |
Copen3d::io::TextureImages | |
Copen3d::visualization::rendering::TextureSamplerParameters | |
Copen3d::visualization::gui::Theme | |
Copen3d::visualization::gui::TickEvent | |
►Copen3d::utility::Timer | |
Copen3d::utility::FPSTimer | |
Copen3d::utility::ScopeTimer | |
►Copen3d::t::pipelines::registration::TransformationEstimation | |
Copen3d::t::pipelines::registration::TransformationEstimationForColoredICP | |
Copen3d::t::pipelines::registration::TransformationEstimationPointToPlane | |
Copen3d::t::pipelines::registration::TransformationEstimationPointToPoint | |
►Copen3d::pipelines::registration::TransformationEstimation | |
Copen3d::pipelines::registration::TransformationEstimationForColoredICP | |
Copen3d::pipelines::registration::TransformationEstimationForGeneralizedICP | |
Copen3d::pipelines::registration::TransformationEstimationPointToPlane | |
Copen3d::pipelines::registration::TransformationEstimationPointToPoint | |
Copen3d::t::geometry::kernel::TransformIndexer | Helper class for converting coordinates/indices between 3D/3D, 3D/2D, 2D/3D |
Copen3d::visualization::rendering::TriangleMeshModel | |
Copen3d::utility::trivial_init_t | |
►Copen3d::pipelines::integration::TSDFVolume | Base class of the Truncated Signed Distance Function (TSDF) volume |
Copen3d::pipelines::integration::ScalableTSDFVolume | |
Copen3d::pipelines::integration::UniformTSDFVolume | UniformTSDFVolume implements the classic TSDF volume with uniform voxel grid (Curless and Levoy 1996) |
Copen3d::t::geometry::TSDFVoxelGrid | |
Copen3d::visualization::gui::UIImage | |
Copen3d::visualization::visualizer::O3DVisualizer::UIState | |
Copen3d::core::linalg::kernel::un< scalar_t > | |
Copen3d::UnaryFunctionTraits< T > | |
Copen3d::utility::UniformRandIntGenerator | Draw pseudo-random integers bounded by min and max (inclusive) from a uniform distribution |
Copen3d::visualization::GuiSettingsModel::UnlitMaterial | |
►Cunordered_map | |
Copen3d::t::geometry::TensorMap | |
Copen3d::core::ValueExtractor< Key > | |
►Cvector | |
Copen3d::core::DynamicSizeVector | |
Copen3d::core::SizeVector | |
Copen3d::utility::VerbosityContextManager | |
►CVideoSinkInterface | |
Copen3d::visualization::webrtc_server::VideoScaler | |
►CVideoSourceInterface | |
Copen3d::visualization::webrtc_server::ImageCapturer | |
Copen3d::visualization::webrtc_server::VideoScaler | |
►CVideoTrackSourceInterface | |
Copen3d::visualization::webrtc_server::BitmapTrackSourceInterface | |
►Copen3d::visualization::rendering::View | |
Copen3d::visualization::rendering::FilamentView | |
►Copen3d::visualization::ViewControl | View controller for visualizer |
Copen3d::visualization::ViewControlWithCustomAnimation | |
Copen3d::visualization::ViewControlWithEditing | |
Copen3d::core::VirtualBlock | |
►Copen3d::visualization::Visualizer | The main Visualizer class |
Copen3d::visualization::VisualizerWithCustomAnimation | |
Copen3d::visualization::VisualizerWithEditing | Visualizer with editing capabilities |
Copen3d::visualization::VisualizerWithKeyCallback | Visualizer with custom key callack capabilities |
Copen3d::visualization::VisualizerWithVertexSelection | |
Copen3d::pipelines::integration::ScalableTSDFVolume::VolumeUnit | |
►Copen3d::geometry::Voxel | Base Voxel class, containing grid id and color |
Copen3d::geometry::TSDFVoxel | |
Copen3d::t::geometry::kernel::tsdf::Voxel32f | |
Copen3d::t::geometry::VoxelBlockGrid | |
►CVoxelizeOpKernel | |
CVoxelizeOpKernelCPU< T > | |
CVoxelizeOutputAllocator | |
►CVoxelPoolingGradOpKernel | |
CVoxelPoolingGradOpKernelCPU< TReal, TFeat > | |
►CVoxelPoolingOpKernel | |
CVoxelPoolingOpKernelCPU< TReal, TFeat > | |
►Copen3d::visualization::gui::Widget | |
►Copen3d::visualization::gui::Button | |
►Copen3d::visualization::SmallButton | |
Copen3d::visualization::SmallToggleButton | |
Copen3d::visualization::gui::CheckableTextTreeCell | |
Copen3d::visualization::gui::Checkbox | |
Copen3d::visualization::gui::ColorEdit | |
Copen3d::visualization::gui::ColormapTreeCell | |
Copen3d::visualization::gui::Combobox | |
►Copen3d::visualization::gui::Dialog | Base class for dialogs |
Copen3d::visualization::gui::FileDialog | |
Copen3d::visualization::gui::ImageWidget | |
Copen3d::visualization::gui::Label | |
►Copen3d::visualization::gui::Layout1D | |
Copen3d::visualization::gui::Horiz | Lays out widgets horizontally |
►Copen3d::visualization::gui::Vert | Lays out widgets vertically |
Copen3d::visualization::gui::CollapsableVert | |
Copen3d::visualization::gui::ScrollableVert | This a vertical layout that scrolls if it is smaller than its contents |
Copen3d::visualization::GuiSettingsView | |
Copen3d::visualization::gui::Layout1D::Fixed | |
Copen3d::visualization::gui::Layout1D::Stretch | |
Copen3d::visualization::gui::ListView | |
Copen3d::visualization::gui::LUTTreeCell | |
Copen3d::visualization::gui::NumberEdit | |
Copen3d::visualization::gui::ProgressBar | |
Copen3d::visualization::gui::SceneWidget | |
Copen3d::visualization::gui::Slider | |
Copen3d::visualization::gui::StackedWidget | |
Copen3d::visualization::gui::TabControl | |
Copen3d::visualization::gui::TextEdit | |
Copen3d::visualization::gui::ToggleSwitch | |
Copen3d::visualization::gui::TreeView | |
Copen3d::visualization::gui::VectorEdit | |
Copen3d::visualization::gui::VGrid | |
►Copen3d::visualization::gui::Window | |
Copen3d::visualization::GuiVisualizer | |
Copen3d::visualization::visualizer::O3DVisualizer | |
►Copen3d::visualization::gui::WindowSystem | |
►Copen3d::visualization::gui::BitmapWindowSystem | |
Copen3d::visualization::webrtc_server::WebRTCWindowSystem | WebRTCWindowSystem is a BitmapWindowSystem with a WebRTC server that sends video frames to remote clients for visualization |
Copen3d::visualization::gui::GLFWWindowSystem | |
Copen3d::t::io::WriteAttributePtr | |
Copen3d::io::WritePointCloudOption | Optional parameters to WritePointCloud |
►Copen3d::io::rpc::ZMQReceiver | Class for the server side receiving requests from a client |
Copen3d::io::rpc::DummyReceiver | |
►CFunction | |
CContinuousConvFunction | |
CContinuousConvTransposeFunction | |
CSparseConvFunction | |
CSparseConvTransposeFunction | |
CVoxelPoolingFunction | |