Open3D
0.6.0
About Open3D
Getting Started
Compiling from source
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
|
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.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.PointCloud method)
(open3d.geometry.RGBDImage method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
(open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume 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.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.HalfEdgeTriangleMesh property)
(open3d.geometry.TriangleMesh property)
Always (open3d.utility.VerbosityLevel 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)
axis_max() (open3d.visualization.SelectionPolygonVolume property)
axis_min() (open3d.visualization.SelectionPolygonVolume property)
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_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)
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)
clear() (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.PointCloud method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
close() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
Color (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.MeshShadeOption attribute)
(open3d.visualization.PointColorOption attribute)
color() (open3d.geometry.RGBDImage 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)
(open3d.geometry.VoxelGrid property)
compute_adjacency_list() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
compute_fpfh_feature() (in module open3d.registration)
compute_half_edges() (open3d.geometry.HalfEdgeTriangleMesh method)
compute_point_cloud_mahalanobis_distance() (in module open3d.geometry)
compute_point_cloud_mean_and_covariance() (in module open3d.geometry)
compute_point_cloud_nearest_neighbor_distance() (in module open3d.geometry)
compute_point_cloud_to_point_cloud_distance() (in module open3d.geometry)
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.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
compute_vertex_normals() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
confidence() (open3d.registration.PoseGraphEdge property)
convert_from_pinhole_camera_parameters() (open3d.visualization.ViewControl 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)
create_half_edge_mesh_from_mesh() (in module open3d.geometry)
create_image_pyramid() (in module open3d.geometry)
create_mesh_arrow() (in module open3d.geometry)
create_mesh_box() (in module open3d.geometry)
create_mesh_cone() (in module open3d.geometry)
create_mesh_coordinate_frame() (in module open3d.geometry)
create_mesh_cylinder() (in module open3d.geometry)
create_mesh_sphere() (in module open3d.geometry)
create_point_cloud_from_depth_image() (in module open3d.geometry)
create_point_cloud_from_rgbd_image() (in module open3d.geometry)
create_rgbd_image_from_color_and_depth() (in module open3d.geometry)
create_rgbd_image_from_nyu_format() (in module open3d.geometry)
create_rgbd_image_from_redwood_format() (in module open3d.geometry)
create_rgbd_image_from_sun_format() (in module open3d.geometry)
create_rgbd_image_from_tum_format() (in module open3d.geometry)
create_surface_voxel_grid_from_point_cloud() (in module open3d.geometry)
create_window() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
crop_point_cloud() (in module open3d.geometry)
(open3d.visualization.SelectionPolygonVolume method)
crop_triangle_mesh() (in module open3d.geometry)
(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.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.Geometry method)
(open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.PointCloud 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() (in module open3d.geometry)
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)
extract_point_cloud() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(open3d.integration.UniformTSDFVolume method)
extract_triangle_mesh() (open3d.integration.ScalableTSDFVolume method)
(open3d.integration.TSDFVolume method)
(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)
Feature (class in open3d.registration)
filter_image() (in module open3d.geometry)
filter_image_pyramid() (in module 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_boundaries() (open3d.geometry.HalfEdgeTriangleMesh method)
get_field_of_view() (open3d.visualization.ViewControl method)
get_focal_length() (open3d.camera.PinholeCameraIntrinsic method)
get_geometry_type() (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.PointCloud method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_information_matrix_from_point_clouds() (in module open3d.registration)
get_line_coordinate() (open3d.geometry.LineSet method)
get_max_bound() (open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.PointCloud method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
get_min_bound() (open3d.geometry.Geometry2D method)
(open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.Image method)
(open3d.geometry.LineSet method)
(open3d.geometry.PointCloud 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_skew() (open3d.camera.PinholeCameraIntrinsic method)
get_verbosity_level() (in module open3d.utility)
get_view_control() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback 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)
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.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.PointCloud attribute)
(open3d.geometry.PointCloud.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.HalfEdgeTriangleMesh method)
(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_triangle_normals() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
has_triangles() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
has_vertex_colors() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
has_vertex_normals() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
has_vertices() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
has_voxels() (open3d.geometry.VoxelGrid method)
height() (open3d.camera.PinholeCameraIntrinsic 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.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.PointCloud attribute)
(open3d.geometry.PointCloud.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)
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)
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)
is_boundary() (open3d.geometry.HalfEdge method)
is_empty() (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.PointCloud method)
(open3d.geometry.TriangleMesh method)
(open3d.geometry.VoxelGrid method)
is_valid() (open3d.camera.PinholeCameraIntrinsic 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.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.PointCloud attribute)
(open3d.geometry.PointCloud.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)
load_from_json() (open3d.visualization.RenderOption method)
lower_scale_factor() (open3d.registration.GlobalOptimizationConvergenceCriteria property)
M
Matrix4dVector (class in open3d.utility)
max_correspondence_distance() (open3d.registration.GlobalOptimizationOption property)
max_depth() (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_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)
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.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
normal_angle_threshold() (open3d.registration.CorrespondenceCheckerBasedOnNormal property)
normalize_normals() (open3d.geometry.HalfEdgeTriangleMesh method)
(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
OdometryOption (class in open3d.odometry)
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() (in module open3d.geometry)
orient_normals_towards_camera_location() (in module open3d.geometry)
origin() (open3d.geometry.VoxelGrid property)
orthogonal_axis() (open3d.visualization.SelectionPolygonVolume property)
P
paint_uniform_color() (open3d.geometry.HalfEdgeTriangleMesh 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.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.PointCloud attribute)
(open3d.geometry.PointCloud.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)
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)
purge() (open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.TriangleMesh method)
R
radius() (open3d.geometry.KDTreeSearchParamHybrid property)
(open3d.geometry.KDTreeSearchParamRadius property)
radius_outlier_removal() (in module open3d.geometry)
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_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)
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)
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)
RGBDOdometryJacobian (class in open3d.odometry)
RGBDOdometryJacobianFromColorTerm (class in open3d.odometry)
RGBDOdometryJacobianFromHybridTerm (class in open3d.odometry)
rotate() (open3d.visualization.ViewControl method)
run() (open3d.visualization.Visualizer method)
(open3d.visualization.VisualizerWithEditing method)
(open3d.visualization.VisualizerWithKeyCallback method)
S
save_to_json() (open3d.visualization.RenderOption method)
ScalableTSDFVolume (class in open3d.integration)
scale() (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)
select_down_sample() (in module open3d.geometry)
SelectionPolygonVolume (class in open3d.visualization)
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)
Sobel3dx (open3d.geometry.ImageFilterType attribute)
Sobel3dy (open3d.geometry.ImageFilterType attribute)
source_node_id() (open3d.registration.PoseGraphEdge property)
statistical_outlier_removal() (in module open3d.geometry)
T
target_node_id() (open3d.registration.PoseGraphEdge property)
transform() (open3d.geometry.Geometry3D method)
(open3d.geometry.HalfEdgeTriangleMesh method)
(open3d.geometry.LineSet method)
(open3d.geometry.PointCloud 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.visualization.ViewControl method)
triangle_index() (open3d.geometry.HalfEdge property)
triangle_normals() (open3d.geometry.HalfEdgeTriangleMesh property)
(open3d.geometry.TriangleMesh property)
TriangleMesh (class in open3d.geometry)
(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.PointCloud attribute)
(open3d.geometry.PointCloud.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.HalfEdgeTriangleMesh property)
(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() (in module open3d.geometry)
UniformTSDFVolume (class in open3d.integration)
Unspecified (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.PointCloud attribute)
(open3d.geometry.PointCloud.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)
VerbosityLevel (class in open3d.utility)
vertex_colors() (open3d.geometry.HalfEdgeTriangleMesh property)
(open3d.geometry.TriangleMesh property)
vertex_indices() (open3d.geometry.HalfEdge property)
vertex_normals() (open3d.geometry.HalfEdgeTriangleMesh property)
(open3d.geometry.TriangleMesh property)
vertices() (open3d.geometry.HalfEdgeTriangleMesh 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)
voxel_down_sample() (in module open3d.geometry)
voxel_down_sample_and_trace() (in module open3d.geometry)
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.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.PointCloud attribute)
(open3d.geometry.PointCloud.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)
with_scaling() (open3d.registration.TransformationEstimationPointToPoint property)
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
XCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
Y
YCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
Z
ZCoordinate (open3d.visualization.MeshColorOption attribute)
(open3d.visualization.PointColorOption attribute)
Docs version
0.6.0
Versions