Open3D
0.8.0
About Open3D
Getting Started
Compiling from source
Building Documentation
Contributing to Open3D
Tutorial
Basic
Advanced
Reconstruction system
C++ interface
Docker
Reference
Python API
open3d.camera
open3d.color_map
open3d.geometry
open3d.io
open3d.integration
open3d.odometry
open3d.registration
open3d.utility
open3d.visualization
Open3D
Docs
»
Index
Index
_
|
A
|
B
|
C
|
D
|
E
|
F
|
G
|
H
|
I
|
K
|
L
|
M
|
N
|
O
|
P
|
Q
|
R
|
S
|
T
|
U
|
V
|
W
|
X
|
Y
|
Z
_
__init__() (open3d.camera.PinholeCameraIntrinsic method)
(open3d.camera.PinholeCameraParameters method)
(open3d.camera.PinholeCameraTrajectory method)
(open3d.color_map.ColorMapOptimizationOption method)
(open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdge method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.KDTreeFlann method)
(open3d.geometry.KDTreeSearchParam method)
(open3d.geometry.KDTreeSearchParamHybrid method)
(open3d.geometry.KDTreeSearchParamKNN method)
(open3d.geometry.KDTreeSearchParamRadius method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OctreeColorLeafNode method)
(open3d.geometry.OctreeInternalNode method)
(open3d.geometry.OctreeLeafNode method)
(open3d.geometry.OctreeNode method)
(open3d.geometry.OctreeNodeInfo method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.Voxel method)
(open3d.geometry.VoxelGrid method)
(open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
(open3d.io.AzureKinectMKVMetadata method)
(open3d.io.AzureKinectMKVReader method)
(open3d.io.AzureKinectRecorder method)
(open3d.io.AzureKinectSensor method)
(open3d.io.AzureKinectSensorConfig method)
(open3d.odometry.OdometryOption method)
(open3d.odometry.RGBDOdometryJacobian method)
(open3d.odometry.RGBDOdometryJacobianFromColorTerm method)
(open3d.odometry.RGBDOdometryJacobianFromHybridTerm method)
(open3d.registration.CorrespondenceChecker method)
(open3d.registration.CorrespondenceCheckerBasedOnDistance method)
(open3d.registration.CorrespondenceCheckerBasedOnEdgeLength method)
(open3d.registration.CorrespondenceCheckerBasedOnNormal method)
(open3d.registration.FastGlobalRegistrationOption method)
(open3d.registration.Feature method)
(open3d.registration.GlobalOptimizationConvergenceCriteria method)
(open3d.registration.GlobalOptimizationGaussNewton method)
(open3d.registration.GlobalOptimizationLevenbergMarquardt method)
(open3d.registration.GlobalOptimizationMethod method)
(open3d.registration.GlobalOptimizationOption method)
(open3d.registration.ICPConvergenceCriteria method)
(open3d.registration.PoseGraph method)
(open3d.registration.PoseGraphEdge method)
(open3d.registration.PoseGraphEdgeVector method)
(open3d.registration.PoseGraphNode method)
(open3d.registration.PoseGraphNodeVector method)
(open3d.registration.RANSACConvergenceCriteria method)
(open3d.registration.RegistrationResult method)
(open3d.registration.TransformationEstimation method)
(open3d.registration.TransformationEstimationPointToPlane method)
(open3d.registration.TransformationEstimationPointToPoint method)
(open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
(open3d.visualization.RenderOption method)
(open3d.visualization.SelectionPolygonVolume method)
(open3d.visualization.ViewControl method)
(open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
A
add_geometry() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
adjacency_list() (open3d.geometry.TriangleMesh property)
All (open3d.geometry.FilterScope attribute)
append() (open3d.registration.PoseGraphEdgeVector method)
(open3d.registration.PoseGraphNodeVector method)
(open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
Average (open3d.geometry.SimplificationContraction attribute)
axis_max() (open3d.visualization.SelectionPolygonVolume property)
axis_min() (open3d.visualization.SelectionPolygonVolume property)
AxisAlignedBoundingBox (class in open3d.geometry)
AxisAlignedBoundingBox.Type (class in open3d.geometry)
AxisAngle (open3d.geometry.RotationType attribute)
AzureKinectMKVMetadata (class in open3d.io)
AzureKinectMKVReader (class in open3d.io)
AzureKinectRecorder (class in open3d.io)
AzureKinectSensor (class in open3d.io)
AzureKinectSensorConfig (class in open3d.io)
B
background_color() (open3d.visualization.RenderOption property)
boundary_half_edges_from_vertex() (open3d.geometry.HalfEdgeTriangleMesh method)
boundary_vertices_from_vertex() (open3d.geometry.HalfEdgeTriangleMesh method)
bounding_polygon() (open3d.visualization.SelectionPolygonVolume property)
C
capture_depth_float_buffer() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
capture_depth_image() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
capture_depth_point_cloud() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
capture_frame() (open3d.io.AzureKinectSensor method)
capture_screen_float_buffer() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
capture_screen_image() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
carve_depth_map() (open3d.geometry.VoxelGrid method)
carve_silhouette() (open3d.geometry.VoxelGrid method)
center() (open3d.geometry.OrientedBoundingBox property)
change_field_of_view() (open3d.visualization.ViewControl method)
Check() (open3d.registration.CorrespondenceChecker method)
(open3d.registration.CorrespondenceCheckerBasedOnDistance method)
(open3d.registration.CorrespondenceCheckerBasedOnEdgeLength method)
(open3d.registration.CorrespondenceCheckerBasedOnNormal method)
child_index() (open3d.geometry.OctreeNodeInfo property)
children() (open3d.geometry.OctreeInternalNode property)
clear() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
clone() (open3d.geometry.OctreeColorLeafNode method)
(open3d.geometry.OctreeLeafNode method)
close() (open3d.io.AzureKinectMKVReader method)
(open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
close_record() (open3d.io.AzureKinectRecorder method)
cluster_dbscan() (open3d.geometry.PointCloud method)
Color (open3d.geometry.FilterScope attribute)
(open3d.visualization.MeshColorOption attribute)
(open3d.visualization.MeshShadeOption attribute)
(open3d.visualization.PointColorOption attribute)
color() (open3d.geometry.AxisAlignedBoundingBox property)
(open3d.geometry.OctreeColorLeafNode property)
(open3d.geometry.OrientedBoundingBox property)
(open3d.geometry.RGBDImage property)
(open3d.geometry.Voxel property)
color_map_optimization() (in module open3d.color_map)
color_type() (open3d.integration.ScalableTSDFVolume property)
(open3d.integration.TSDFVolume property)
(open3d.integration.UniformTSDFVolume property)
ColorMapOptimizationOption (class in open3d.color_map)
colors() (open3d.geometry.LineSet property)
(open3d.geometry.PointCloud property)
compute_adjacency_list() (open3d.geometry.TriangleMesh method)
compute_convex_hull() (open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
compute_fpfh_feature() (in module open3d.registration)
compute_half_edges() (open3d.geometry.HalfEdgeTriangleMesh method)
compute_mahalanobis_distance() (open3d.geometry.PointCloud method)
compute_mean_and_covariance() (open3d.geometry.PointCloud method)
compute_nearest_neighbor_distance() (open3d.geometry.PointCloud method)
compute_point_cloud_distance() (open3d.geometry.PointCloud method)
compute_rgbd_odometry() (in module open3d.odometry)
compute_rmse() (open3d.registration.TransformationEstimation method)
(open3d.registration.TransformationEstimationPointToPlane method)
(open3d.registration.TransformationEstimationPointToPoint method)
compute_transformation() (open3d.registration.TransformationEstimation method)
(open3d.registration.TransformationEstimationPointToPlane method)
(open3d.registration.TransformationEstimationPointToPoint method)
compute_triangle_normals() (open3d.geometry.TriangleMesh method)
compute_vertex_normals() (open3d.geometry.TriangleMesh method)
confidence() (open3d.registration.PoseGraphEdge property)
connect() (open3d.io.AzureKinectSensor method)
convert_from_pinhole_camera_parameters() (open3d.visualization.ViewControl method)
convert_from_point_cloud() (open3d.geometry.Octree method)
convert_to_pinhole_camera_parameters() (open3d.visualization.ViewControl method)
correspondence_set() (open3d.registration.RegistrationResult property)
CorrespondenceChecker (class in open3d.registration)
CorrespondenceCheckerBasedOnDistance (class in open3d.registration)
CorrespondenceCheckerBasedOnEdgeLength (class in open3d.registration)
CorrespondenceCheckerBasedOnNormal (class in open3d.registration)
count() (open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
create_arrow() (open3d.geometry.TriangleMesh static method)
create_box() (open3d.geometry.TriangleMesh static method)
create_cone() (open3d.geometry.TriangleMesh static method)
create_coordinate_frame() (open3d.geometry.TriangleMesh static method)
create_cylinder() (open3d.geometry.TriangleMesh static method)
create_dense() (open3d.geometry.VoxelGrid static method)
create_from_axis_aligned_bounding_box() (open3d.geometry.LineSet static method)
create_from_color_and_depth() (open3d.geometry.RGBDImage static method)
create_from_depth_image() (open3d.geometry.PointCloud static method)
create_from_mesh() (open3d.geometry.HalfEdgeTriangleMesh static method)
create_from_nyu_format() (open3d.geometry.RGBDImage static method)
create_from_octree() (open3d.geometry.VoxelGrid method)
create_from_oriented_bounding_box() (open3d.geometry.LineSet static method)
create_from_point_cloud() (open3d.geometry.TetraMesh static method)
(open3d.geometry.VoxelGrid static method)
create_from_point_cloud_ball_pivoting() (open3d.geometry.TriangleMesh static method)
create_from_point_cloud_correspondences() (open3d.geometry.LineSet static method)
create_from_point_cloud_within_bounds() (open3d.geometry.VoxelGrid static method)
create_from_redwood_format() (open3d.geometry.RGBDImage static method)
create_from_rgbd_image() (open3d.geometry.PointCloud static method)
create_from_sun_format() (open3d.geometry.RGBDImage static method)
create_from_tetra_mesh() (open3d.geometry.LineSet static method)
create_from_triangle_mesh() (open3d.geometry.LineSet static method)
(open3d.geometry.VoxelGrid static method)
create_from_triangle_mesh_within_bounds() (open3d.geometry.VoxelGrid static method)
create_from_tum_format() (open3d.geometry.RGBDImage static method)
create_from_voxel_grid() (open3d.geometry.Octree method)
create_icosahedron() (open3d.geometry.TriangleMesh static method)
create_moebius() (open3d.geometry.TriangleMesh static method)
create_octahedron() (open3d.geometry.TriangleMesh static method)
create_pyramid() (open3d.geometry.Image method)
create_sphere() (open3d.geometry.TriangleMesh static method)
create_tetrahedron() (open3d.geometry.TriangleMesh static method)
create_torus() (open3d.geometry.TriangleMesh static method)
create_window() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
crop() (open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
crop_point_cloud() (open3d.visualization.SelectionPolygonVolume method)
crop_triangle_mesh() (open3d.visualization.SelectionPolygonVolume method)
D
data() (open3d.registration.Feature property)
Debug (open3d.utility.VerbosityLevel attribute)
decrease_mu() (open3d.registration.FastGlobalRegistrationOption property)
Default (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.MeshShadeOption attribute)
(open3d.visualization.PointColorOption attribute)
depth() (open3d.geometry.OctreeNodeInfo property)
(open3d.geometry.RGBDImage property)
depth_threshold_for_discontinuity_check() (open3d.color_map.ColorMapOptimizationOption property)
depth_threshold_for_visiblity_check() (open3d.color_map.ColorMapOptimizationOption property)
destroy_window() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
dimension() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
(open3d.registration.Feature method)
distance_threshold() (open3d.registration.CorrespondenceCheckerBasedOnDistance property)
division_factor() (open3d.registration.FastGlobalRegistrationOption property)
DoubleVector (class in open3d.utility)
draw_geometries() (in module open3d.visualization)
draw_geometries_with_animation_callback() (in module open3d.visualization)
draw_geometries_with_custom_animation() (in module open3d.visualization)
draw_geometries_with_editing() (in module open3d.visualization)
draw_geometries_with_key_callbacks() (in module open3d.visualization)
E
edge_prune_threshold() (open3d.registration.GlobalOptimizationOption property)
edges() (open3d.registration.PoseGraph property)
Error (open3d.utility.VerbosityLevel attribute)
estimate_normals() (open3d.geometry.PointCloud method)
euler_poincare_characteristic() (open3d.geometry.TriangleMesh method)
evaluate_registration() (in module open3d.registration)
extend() (open3d.registration.PoseGraphEdgeVector method)
(open3d.registration.PoseGraphNodeVector method)
(open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
extract_point_cloud() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
extract_triangle_mesh() (open3d.geometry.TetraMesh method)
(open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
extract_voxel_grid() (open3d.integration.UniformTSDFVolume method)
extract_voxel_point_cloud() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
extrinsic() (open3d.camera.PinholeCameraParameters property)
F
FastGlobalRegistrationOption (class in open3d.registration)
Fatal (open3d.utility.VerbosityLevel attribute)
Feature (class in open3d.registration)
filter() (open3d.geometry.Image method)
filter_pyramid() (open3d.geometry.Image static method)
filter_sharpen() (open3d.geometry.TriangleMesh method)
filter_smooth_laplacian() (open3d.geometry.TriangleMesh method)
filter_smooth_simple() (open3d.geometry.TriangleMesh method)
filter_smooth_taubin() (open3d.geometry.TriangleMesh method)
FilterScope (class in open3d.geometry)
fitness() (open3d.registration.RegistrationResult property)
G
Gaussian3 (open3d.geometry.ImageFilterType attribute)
Gaussian5 (open3d.geometry.ImageFilterType attribute)
Gaussian7 (open3d.geometry.ImageFilterType attribute)
Geometry (class in open3d.geometry)
Geometry.Type (class in open3d.geometry)
Geometry2D (class in open3d.geometry)
Geometry2D.Type (class in open3d.geometry)
Geometry3D (class in open3d.geometry)
Geometry3D.Type (class in open3d.geometry)
get_axis_aligned_bounding_box() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_boundaries() (open3d.geometry.HalfEdgeTriangleMesh method)
get_box_points() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.OrientedBoundingBox method)
get_center() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_field_of_view() (open3d.visualization.ViewControl method)
get_focal_length() (open3d.camera.PinholeCameraIntrinsic method)
get_geometry_type() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_information_matrix_from_point_clouds() (in module open3d.registration)
get_init_function() (open3d.geometry.OctreeColorLeafNode static method)
get_line_coordinate() (open3d.geometry.LineSet method)
get_max_bound() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_metadata() (open3d.io.AzureKinectMKVReader method)
get_min_bound() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_non_manifold_edges() (open3d.geometry.TriangleMesh method)
get_non_manifold_vertices() (open3d.geometry.TriangleMesh method)
get_oriented_bounding_box() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_picked_points() (open3d.visualization.VisualizerWithEditing method)
get_principal_point() (open3d.camera.PinholeCameraIntrinsic method)
get_render_option() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
get_search_type() (open3d.geometry.KDTreeSearchParam method)
(open3d.geometry.KDTreeSearchParamHybrid method)
(open3d.geometry.KDTreeSearchParamKNN method)
(open3d.geometry.KDTreeSearchParamRadius method)
get_self_intersecting_triangles() (open3d.geometry.TriangleMesh method)
get_skew() (open3d.camera.PinholeCameraIntrinsic method)
get_update_function() (open3d.geometry.OctreeColorLeafNode static method)
get_verbosity_level() (in module open3d.utility)
get_view_control() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
get_voxel() (open3d.geometry.VoxelGrid method)
get_window_name() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
global_optimization() (in module open3d.registration)
GlobalOptimizationConvergenceCriteria (class in open3d.registration)
GlobalOptimizationGaussNewton (class in open3d.registration)
GlobalOptimizationLevenbergMarquardt (class in open3d.registration)
GlobalOptimizationMethod (class in open3d.registration)
GlobalOptimizationOption (class in open3d.registration)
Gray32 (open3d.integration.TSDFVolumeColorType attribute)
grid_index() (open3d.geometry.Voxel property)
H
half_dilation_kernel_size_for_discontinuity_map() (open3d.color_map.ColorMapOptimizationOption property)
half_edges() (open3d.geometry.HalfEdgeTriangleMesh property)
HalfEdge (class in open3d.geometry)
HalfEdgeTriangleMesh (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
HalfEdgeTriangleMesh.Type (class in open3d.geometry)
has_adjacency_list() (open3d.geometry.TriangleMesh method)
has_colors() (open3d.geometry.LineSet method)
(open3d.geometry.PointCloud method)
(open3d.geometry.VoxelGrid method)
has_half_edges() (open3d.geometry.HalfEdgeTriangleMesh method)
has_lines() (open3d.geometry.LineSet method)
has_normals() (open3d.geometry.PointCloud method)
has_points() (open3d.geometry.LineSet method)
(open3d.geometry.PointCloud method)
has_tetras() (open3d.geometry.TetraMesh method)
has_triangle_normals() (open3d.geometry.TriangleMesh method)
has_triangles() (open3d.geometry.TriangleMesh method)
has_vertex_colors() (open3d.geometry.TriangleMesh method)
has_vertex_normals() (open3d.geometry.TriangleMesh method)
has_vertices() (open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
has_voxels() (open3d.geometry.VoxelGrid method)
height() (open3d.camera.PinholeCameraIntrinsic property)
(open3d.io.AzureKinectMKVMetadata property)
HybridSearch (open3d.geometry.KDTreeSearchParam attribute)
(open3d.geometry.KDTreeSearchParam.Type attribute)
(open3d.geometry.KDTreeSearchParamHybrid attribute)
(open3d.geometry.KDTreeSearchParamHybrid.Type attribute)
(open3d.geometry.KDTreeSearchParamKNN attribute)
(open3d.geometry.KDTreeSearchParamKNN.Type attribute)
(open3d.geometry.KDTreeSearchParamRadius attribute)
(open3d.geometry.KDTreeSearchParamRadius.Type attribute)
I
ICPConvergenceCriteria (class in open3d.registration)
Image (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
Image.Type (class in open3d.geometry)
image_boundary_margin() (open3d.color_map.ColorMapOptimizationOption property)
ImageFilterType (class in open3d.geometry)
Info (open3d.utility.VerbosityLevel attribute)
information() (open3d.registration.PoseGraphEdge property)
init_sensor() (open3d.io.AzureKinectRecorder method)
inlier_rmse() (open3d.registration.RegistrationResult property)
insert() (open3d.registration.PoseGraphEdgeVector method)
(open3d.registration.PoseGraphNodeVector method)
(open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
insert_point() (open3d.geometry.Octree method)
integrate() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
intrinsic() (open3d.camera.PinholeCameraParameters property)
intrinsic_matrix() (open3d.camera.PinholeCameraIntrinsic property)
IntVector (class in open3d.utility)
invisible_vertex_color_knn() (open3d.color_map.ColorMapOptimizationOption property)
is_boundary() (open3d.geometry.HalfEdge method)
is_edge_manifold() (open3d.geometry.TriangleMesh method)
is_empty() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
is_eof() (open3d.io.AzureKinectMKVReader method)
is_intersecting() (open3d.geometry.TriangleMesh method)
is_opened() (open3d.io.AzureKinectMKVReader method)
is_orientable() (open3d.geometry.TriangleMesh method)
is_point_in_bound() (open3d.geometry.Octree static method)
is_record_created() (open3d.io.AzureKinectRecorder method)
is_self_intersecting() (open3d.geometry.TriangleMesh method)
is_valid() (open3d.camera.PinholeCameraIntrinsic method)
is_vertex_manifold() (open3d.geometry.TriangleMesh method)
is_watertight() (open3d.geometry.TriangleMesh method)
iteration_number() (open3d.registration.FastGlobalRegistrationOption property)
iteration_number_per_pyramid_level() (open3d.odometry.OdometryOption property)
K
KDTreeFlann (class in open3d.geometry)
KDTreeSearchParam (class in open3d.geometry)
KDTreeSearchParam.Type (class in open3d.geometry)
KDTreeSearchParamHybrid (class in open3d.geometry)
KDTreeSearchParamHybrid.Type (class in open3d.geometry)
KDTreeSearchParamKNN (class in open3d.geometry)
KDTreeSearchParamKNN.Type (class in open3d.geometry)
KDTreeSearchParamRadius (class in open3d.geometry)
KDTreeSearchParamRadius.Type (class in open3d.geometry)
Kinect2ColorCameraDefault (open3d.camera.PinholeCameraIntrinsicParameters attribute)
Kinect2DepthCameraDefault (open3d.camera.PinholeCameraIntrinsicParameters attribute)
knn() (open3d.geometry.KDTreeSearchParamKNN property)
KNNSearch (open3d.geometry.KDTreeSearchParam attribute)
(open3d.geometry.KDTreeSearchParam.Type attribute)
(open3d.geometry.KDTreeSearchParamHybrid attribute)
(open3d.geometry.KDTreeSearchParamHybrid.Type attribute)
(open3d.geometry.KDTreeSearchParamKNN attribute)
(open3d.geometry.KDTreeSearchParamKNN.Type attribute)
(open3d.geometry.KDTreeSearchParamRadius attribute)
(open3d.geometry.KDTreeSearchParamRadius.Type attribute)
L
length() (open3d.integration.UniformTSDFVolume property)
light_on() (open3d.visualization.RenderOption property)
line_width() (open3d.visualization.RenderOption property)
lines() (open3d.geometry.LineSet property)
LineSet (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
LineSet.Type (class in open3d.geometry)
list_devices() (open3d.io.AzureKinectSensor static method)
load_from_json() (open3d.visualization.RenderOption method)
locate_leaf_node() (open3d.geometry.Octree method)
lower_scale_factor() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
M
Matrix4dVector (class in open3d.utility)
max_bound() (open3d.geometry.AxisAlignedBoundingBox property)
max_correspondence_distance() (open3d.registration.GlobalOptimizationOption property)
max_depth() (open3d.geometry.Octree property)
(open3d.odometry.OdometryOption property)
max_depth_diff() (open3d.odometry.OdometryOption property)
max_iteration() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
(open3d.registration.ICPConvergenceCriteria property)
(open3d.registration.RANSACConvergenceCriteria property)
max_iteration_lm() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
max_nn() (open3d.geometry.KDTreeSearchParamHybrid property)
max_validation() (open3d.registration.RANSACConvergenceCriteria property)
maximum_allowable_depth() (open3d.color_map.ColorMapOptimizationOption property)
maximum_correspondence_distance() (open3d.registration.FastGlobalRegistrationOption property)
maximum_iteration() (open3d.color_map.ColorMapOptimizationOption property)
maximum_tuple_count() (open3d.registration.FastGlobalRegistrationOption property)
mesh_color_option() (open3d.visualization.RenderOption property)
mesh_shade_option() (open3d.visualization.RenderOption property)
mesh_show_back_face() (open3d.visualization.RenderOption property)
MeshColorOption (class in open3d.visualization)
MeshShadeOption (class in open3d.visualization)
min_bound() (open3d.geometry.AxisAlignedBoundingBox property)
min_depth() (open3d.odometry.OdometryOption property)
min_relative_increment() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
min_relative_residual_increment() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
min_residual() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
min_right_term() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
N
next() (open3d.geometry.HalfEdge property)
next_frame() (open3d.io.AzureKinectMKVReader method)
nodes() (open3d.registration.PoseGraph property)
non_rigid_anchor_point_weight() (open3d.color_map.ColorMapOptimizationOption property)
non_rigid_camera_coordinate() (open3d.color_map.ColorMapOptimizationOption property)
None (open3d.integration.TSDFVolumeColorType attribute)
Normal (open3d.geometry.FilterScope attribute)
(open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
normal_angle_threshold() (open3d.registration.CorrespondenceCheckerBasedOnNormal property)
normalize_normals() (open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
normals() (open3d.geometry.PointCloud property)
num() (open3d.registration.Feature method)
number_of_vertical_anchors() (open3d.color_map.ColorMapOptimizationOption property)
O
Octree (class in open3d.geometry)
Octree.Type (class in open3d.geometry)
OctreeColorLeafNode (class in open3d.geometry)
OctreeInternalNode (class in open3d.geometry)
OctreeLeafNode (class in open3d.geometry)
OctreeNode (class in open3d.geometry)
OctreeNodeInfo (class in open3d.geometry)
OdometryOption (class in open3d.odometry)
Off (open3d.utility.VerbosityLevel attribute)
open() (open3d.io.AzureKinectMKVReader method)
open_record() (open3d.io.AzureKinectRecorder method)
OptimizePoseGraph() (open3d.registration.GlobalOptimizationGaussNewton method)
(open3d.registration.GlobalOptimizationLevenbergMarquardt method)
(open3d.registration.GlobalOptimizationMethod method)
ordered_half_edge_from_vertex() (open3d.geometry.HalfEdgeTriangleMesh property)
orient_normals_to_align_with_direction() (open3d.geometry.PointCloud method)
orient_normals_towards_camera_location() (open3d.geometry.PointCloud method)
orient_triangles() (open3d.geometry.TriangleMesh method)
OrientedBoundingBox (class in open3d.geometry)
OrientedBoundingBox.Type (class in open3d.geometry)
origin() (open3d.geometry.Octree property)
(open3d.geometry.OctreeNodeInfo property)
(open3d.geometry.VoxelGrid property)
orthogonal_axis() (open3d.visualization.SelectionPolygonVolume property)
P
paint_uniform_color() (open3d.geometry.LineSet method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
parameters() (open3d.camera.PinholeCameraTrajectory property)
PinholeCameraIntrinsic (class in open3d.camera)
PinholeCameraIntrinsicParameters (class in open3d.camera)
PinholeCameraParameters (class in open3d.camera)
PinholeCameraTrajectory (class in open3d.camera)
point_color_option() (open3d.visualization.RenderOption property)
point_show_normal() (open3d.visualization.RenderOption property)
point_size() (open3d.visualization.RenderOption property)
PointCloud (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
PointCloud.Type (class in open3d.geometry)
PointColorOption (class in open3d.visualization)
points() (open3d.geometry.LineSet property)
(open3d.geometry.PointCloud property)
poll_events() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
pop() (open3d.registration.PoseGraphEdgeVector method)
(open3d.registration.PoseGraphNodeVector method)
(open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
pose() (open3d.registration.PoseGraphNode property)
PoseGraph (class in open3d.registration)
PoseGraphEdge (class in open3d.registration)
PoseGraphEdgeVector (class in open3d.registration)
PoseGraphNode (class in open3d.registration)
PoseGraphNodeVector (class in open3d.registration)
preference_loop_closure() (open3d.registration.GlobalOptimizationOption property)
PrimeSenseDefault (open3d.camera.PinholeCameraIntrinsicParameters attribute)
Q
Quadric (open3d.geometry.SimplificationContraction attribute)
R
radius() (open3d.geometry.KDTreeSearchParamHybrid property)
(open3d.geometry.KDTreeSearchParamRadius property)
RadiusSearch (open3d.geometry.KDTreeSearchParam attribute)
(open3d.geometry.KDTreeSearchParam.Type attribute)
(open3d.geometry.KDTreeSearchParamHybrid attribute)
(open3d.geometry.KDTreeSearchParamHybrid.Type attribute)
(open3d.geometry.KDTreeSearchParamKNN attribute)
(open3d.geometry.KDTreeSearchParamKNN.Type attribute)
(open3d.geometry.KDTreeSearchParamRadius attribute)
(open3d.geometry.KDTreeSearchParamRadius.Type attribute)
RANSACConvergenceCriteria (class in open3d.registration)
read_azure_kinect_mkv_metadata() (in module open3d.io)
read_azure_kinect_sensor_config() (in module open3d.io)
read_feature() (in module open3d.io)
read_image() (in module open3d.io)
read_line_set() (in module open3d.io)
read_pinhole_camera_intrinsic() (in module open3d.io)
read_pinhole_camera_parameters() (in module open3d.io)
read_pinhole_camera_trajectory() (in module open3d.io)
read_point_cloud() (in module open3d.io)
read_pose_graph() (in module open3d.io)
read_selection_polygon_volume() (in module open3d.visualization)
read_triangle_mesh() (in module open3d.io)
read_voxel_grid() (in module open3d.io)
record_frame() (open3d.io.AzureKinectRecorder method)
reference_node() (open3d.registration.GlobalOptimizationOption property)
register_animation_callback() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
register_key_callback() (open3d.visualization.VisualizerWithKeyCallback method)
registration_colored_icp() (in module open3d.registration)
registration_fast_based_on_feature_matching() (in module open3d.registration)
registration_icp() (in module open3d.registration)
registration_ransac_based_on_correspondence() (in module open3d.registration)
registration_ransac_based_on_feature_matching() (in module open3d.registration)
RegistrationResult (class in open3d.registration)
relative_fitness() (open3d.registration.ICPConvergenceCriteria property)
relative_rmse() (open3d.registration.ICPConvergenceCriteria property)
remove() (open3d.utility.DoubleVector method)
(open3d.utility.IntVector method)
(open3d.utility.Matrix4dVector method)
(open3d.utility.Vector2iVector method)
(open3d.utility.Vector3dVector method)
(open3d.utility.Vector3iVector method)
(open3d.utility.Vector4iVector method)
remove_degenerate_tetras() (open3d.geometry.TetraMesh method)
remove_degenerate_triangles() (open3d.geometry.TriangleMesh method)
remove_duplicated_tetras() (open3d.geometry.TetraMesh method)
remove_duplicated_triangles() (open3d.geometry.TriangleMesh method)
remove_duplicated_vertices() (open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
remove_geometry() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
remove_non_manifold_edges() (open3d.geometry.TriangleMesh method)
remove_none_finite_points() (open3d.geometry.PointCloud method)
remove_radius_outlier() (open3d.geometry.PointCloud method)
remove_statistical_outlier() (open3d.geometry.PointCloud method)
remove_unreferenced_vertices() (open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
RenderOption (class in open3d.visualization)
reset() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
reset_view_point() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
resize() (open3d.registration.Feature method)
resolution() (open3d.integration.UniformTSDFVolume property)
RGB8 (open3d.integration.TSDFVolumeColorType attribute)
RGBDImage (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
RGBDImage.Type (class in open3d.geometry)
RGBDOdometryJacobian (class in open3d.odometry)
RGBDOdometryJacobianFromColorTerm (class in open3d.odometry)
RGBDOdometryJacobianFromHybridTerm (class in open3d.odometry)
root_node() (open3d.geometry.Octree property)
rotate() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
(open3d.visualization.ViewControl method)
RotationType (class in open3d.geometry)
run() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
S
sample_points_poisson_disk() (open3d.geometry.TriangleMesh method)
sample_points_uniformly() (open3d.geometry.TriangleMesh method)
save_to_json() (open3d.visualization.RenderOption method)
ScalableTSDFVolume (class in open3d.integration)
scale() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
(open3d.visualization.ViewControl method)
sdf_trunc() (open3d.integration.ScalableTSDFVolume property)
(open3d.integration.TSDFVolume property)
(open3d.integration.UniformTSDFVolume property)
search_hybrid_vector_3d() (open3d.geometry.KDTreeFlann method)
search_hybrid_vector_xd() (open3d.geometry.KDTreeFlann method)
search_knn_vector_3d() (open3d.geometry.KDTreeFlann method)
search_knn_vector_xd() (open3d.geometry.KDTreeFlann method)
search_radius_vector_3d() (open3d.geometry.KDTreeFlann method)
search_radius_vector_xd() (open3d.geometry.KDTreeFlann method)
search_vector_3d() (open3d.geometry.KDTreeFlann method)
search_vector_xd() (open3d.geometry.KDTreeFlann method)
seek_timestamp() (open3d.io.AzureKinectMKVReader method)
select_down_sample() (open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
SelectionPolygonVolume (class in open3d.visualization)
set_constant_z_far() (open3d.visualization.ViewControl method)
set_constant_z_near() (open3d.visualization.ViewControl method)
set_feature() (open3d.geometry.KDTreeFlann method)
set_geometry() (open3d.geometry.KDTreeFlann method)
set_intrinsics() (open3d.camera.PinholeCameraIntrinsic method)
set_matrix_data() (open3d.geometry.KDTreeFlann method)
set_verbosity_level() (in module open3d.utility)
show_coordinate_frame() (open3d.visualization.RenderOption property)
similarity_threshold() (open3d.registration.CorrespondenceCheckerBasedOnEdgeLength property)
SimplificationContraction (class in open3d.geometry)
simplify_quadric_decimation() (open3d.geometry.TriangleMesh method)
simplify_vertex_clustering() (open3d.geometry.TriangleMesh method)
size() (open3d.geometry.Octree property)
(open3d.geometry.OctreeNodeInfo property)
Sobel3dx (open3d.geometry.ImageFilterType attribute)
Sobel3dy (open3d.geometry.ImageFilterType attribute)
source_node_id() (open3d.registration.PoseGraphEdge property)
stream_length_usec() (open3d.io.AzureKinectMKVMetadata property)
subdivide_loop() (open3d.geometry.TriangleMesh method)
subdivide_midpoint() (open3d.geometry.TriangleMesh method)
T
target_node_id() (open3d.registration.PoseGraphEdge property)
TetraMesh (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
TetraMesh.Type (class in open3d.geometry)
tetras() (open3d.geometry.TetraMesh property)
to_octree() (open3d.geometry.VoxelGrid method)
to_voxel_grid() (open3d.geometry.Octree method)
transform() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
transformation() (open3d.registration.PoseGraphEdge property)
(open3d.registration.RegistrationResult property)
TransformationEstimation (class in open3d.registration)
TransformationEstimationPointToPlane (class in open3d.registration)
TransformationEstimationPointToPoint (class in open3d.registration)
translate() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.Octree method)
(open3d.geometry.OrientedBoundingBox method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TetraMesh method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
(open3d.visualization.ViewControl method)
triangle_index() (open3d.geometry.HalfEdge property)
triangle_normals() (open3d.geometry.TriangleMesh property)
TriangleMesh (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
TriangleMesh.Type (class in open3d.geometry)
triangles() (open3d.geometry.TriangleMesh property)
TSDFVolume (class in open3d.integration)
TSDFVolumeColorType (class in open3d.integration)
tuple_scale() (open3d.registration.FastGlobalRegistrationOption property)
twin() (open3d.geometry.HalfEdge property)
U
uncertain() (open3d.registration.PoseGraphEdge property)
uniform_down_sample() (open3d.geometry.PointCloud method)
UniformTSDFVolume (class in open3d.integration)
unset_constant_z_far() (open3d.visualization.ViewControl method)
unset_constant_z_near() (open3d.visualization.ViewControl method)
Unspecified (open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
update_geometry() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
update_renderer() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
upper_scale_factor() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
use_absolute_scale() (open3d.registration.FastGlobalRegistrationOption property)
V
Vector2iVector (class in open3d.utility)
Vector3dVector (class in open3d.utility)
Vector3iVector (class in open3d.utility)
Vector4iVector (class in open3d.utility)
VerbosityLevel (class in open3d.utility)
Vertex (open3d.geometry.FilterScope attribute)
vertex_colors() (open3d.geometry.TriangleMesh property)
vertex_indices() (open3d.geometry.HalfEdge property)
vertex_normals() (open3d.geometry.TriangleMesh property)
vertices() (open3d.geometry.TetraMesh property)
(open3d.geometry.TriangleMesh property)
ViewControl (class in open3d.visualization)
Visualizer (class in open3d.visualization)
VisualizerWithEditing (class in open3d.visualization)
VisualizerWithKeyCallback (class in open3d.visualization)
volume() (open3d.geometry.AxisAlignedBoundingBox method)
(open3d.geometry.OrientedBoundingBox method)
Voxel (class in open3d.geometry)
voxel_down_sample() (open3d.geometry.PointCloud method)
voxel_down_sample_and_trace() (open3d.geometry.PointCloud method)
voxel_length() (open3d.integration.ScalableTSDFVolume property)
(open3d.integration.TSDFVolume property)
(open3d.integration.UniformTSDFVolume property)
voxel_size() (open3d.geometry.VoxelGrid property)
VoxelGrid (class in open3d.geometry)
(open3d.geometry.AxisAlignedBoundingBox attribute)
(open3d.geometry.AxisAlignedBoundingBox.Type attribute)
(open3d.geometry.Geometry attribute)
(open3d.geometry.Geometry.Type attribute)
(open3d.geometry.Geometry2D attribute)
(open3d.geometry.Geometry2D.Type attribute)
(open3d.geometry.Geometry3D attribute)
(open3d.geometry.Geometry3D.Type attribute)
(open3d.geometry.HalfEdgeTriangleMesh attribute)
(open3d.geometry.HalfEdgeTriangleMesh.Type attribute)
(open3d.geometry.Image attribute)
(open3d.geometry.Image.Type attribute)
(open3d.geometry.LineSet attribute)
(open3d.geometry.LineSet.Type attribute)
(open3d.geometry.Octree attribute)
(open3d.geometry.Octree.Type attribute)
(open3d.geometry.OrientedBoundingBox attribute)
(open3d.geometry.OrientedBoundingBox.Type attribute)
(open3d.geometry.PointCloud attribute)
(open3d.geometry.PointCloud.Type attribute)
(open3d.geometry.RGBDImage attribute)
(open3d.geometry.RGBDImage.Type attribute)
(open3d.geometry.TetraMesh attribute)
(open3d.geometry.TetraMesh.Type attribute)
(open3d.geometry.TriangleMesh attribute)
(open3d.geometry.TriangleMesh.Type attribute)
(open3d.geometry.VoxelGrid attribute)
(open3d.geometry.VoxelGrid.Type attribute)
VoxelGrid.Type (class in open3d.geometry)
voxels() (open3d.geometry.VoxelGrid property)
W
Warning (open3d.utility.VerbosityLevel attribute)
width() (open3d.camera.PinholeCameraIntrinsic property)
(open3d.io.AzureKinectMKVMetadata property)
with_scaling() (open3d.registration.TransformationEstimationPointToPoint property)
write_azure_kinect_mkv_metadata() (in module open3d.io)
write_azure_kinect_sensor_config() (in module open3d.io)
write_feature() (in module open3d.io)
write_image() (in module open3d.io)
write_line_set() (in module open3d.io)
write_pinhole_camera_intrinsic() (in module open3d.io)
write_pinhole_camera_parameters() (in module open3d.io)
write_pinhole_camera_trajectory() (in module open3d.io)
write_point_cloud() (in module open3d.io)
write_pose_graph() (in module open3d.io)
write_triangle_mesh() (in module open3d.io)
write_voxel_grid() (in module open3d.io)
X
x_axis() (open3d.geometry.OrientedBoundingBox property)
XCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
XYZ (open3d.geometry.RotationType attribute)
XZY (open3d.geometry.RotationType attribute)
Y
y_axis() (open3d.geometry.OrientedBoundingBox property)
YCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
YXZ (open3d.geometry.RotationType attribute)
YZX (open3d.geometry.RotationType attribute)
Z
z_axis() (open3d.geometry.OrientedBoundingBox property)
ZCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
ZXY (open3d.geometry.RotationType attribute)
ZYX (open3d.geometry.RotationType attribute)
Docs version
0.8.0
Versions