Blender  V3.3
Functions | Variables
btQuadWord.h File Reference
#include "btScalar.h"
#include "btMinMax.h"

Go to the source code of this file.

Functions

SIMD_FORCE_INLINE const btScalargetX () const
 Return the x value. More...
 
SIMD_FORCE_INLINE const btScalargetY () const
 Return the y value. More...
 
SIMD_FORCE_INLINE const btScalargetZ () const
 Return the z value. More...
 
SIMD_FORCE_INLINE void setX (btScalar _x)
 Set the x value. More...
 
SIMD_FORCE_INLINE void setY (btScalar _y)
 Set the y value. More...
 
SIMD_FORCE_INLINE void setZ (btScalar _z)
 Set the z value. More...
 
SIMD_FORCE_INLINE void setW (btScalar _w)
 Set the w value. More...
 
SIMD_FORCE_INLINE const btScalarx () const
 Return the x value. More...
 
SIMD_FORCE_INLINE const btScalary () const
 Return the y value. More...
 
SIMD_FORCE_INLINE const btScalarz () const
 Return the z value. More...
 
SIMD_FORCE_INLINE const btScalarw () const
 Return the w value. More...
 
SIMD_FORCE_INLINE operator btScalar * ()
 operator btScalar*() replaces operator[], using implicit conversion. We added operator != and operator == to avoid pointer comparisons. More...
 
SIMD_FORCE_INLINE operator const btScalar * () const
 
SIMD_FORCE_INLINE bool operator== (const btQuadWord &other) const
 
SIMD_FORCE_INLINE bool operator!= (const btQuadWord &other) const
 
SIMD_FORCE_INLINE void setValue (const btScalar &_x, const btScalar &_y, const btScalar &_z)
 Set x,y,z and zero w. More...
 
SIMD_FORCE_INLINE void setValue (const btScalar &_x, const btScalar &_y, const btScalar &_z, const btScalar &_w)
 Set the values. More...
 
SIMD_FORCE_INLINE btQuadWord (const btScalar &_x, const btScalar &_y, const btScalar &_z)
 Three argument constructor (zeros w) More...
 
SIMD_FORCE_INLINE btQuadWord (const btScalar &_x, const btScalar &_y, const btScalar &_z, const btScalar &_w)
 Initializing constructor. More...
 
SIMD_FORCE_INLINE void setMax (const btQuadWord &other)
 Set each element to the max of the current values and the values of another btQuadWord. More...
 
SIMD_FORCE_INLINE void setMin (const btQuadWord &other)
 Set each element to the min of the current values and the values of another btQuadWord. More...
 

Variables

 btQuadWord
 The btQuadWord class is base class for btVector3 and btQuaternion. Some issues under PS3 Linux with IBM 2.1 SDK, gcc compiler prevent from using aligned quadword. More...
 

Function Documentation

◆ btQuadWord() [1/2]

SIMD_FORCE_INLINE btQuadWord ( const btScalar _x,
const btScalar _y,
const btScalar _z 
)

Three argument constructor (zeros w)

Parameters
xValue of x
yValue of y
zValue of z

Definition at line 188 of file btQuadWord.h.

References m_floats.

◆ btQuadWord() [2/2]

SIMD_FORCE_INLINE btQuadWord ( const btScalar _x,
const btScalar _y,
const btScalar _z,
const btScalar _w 
)

Initializing constructor.

Parameters
xValue of x
yValue of y
zValue of z
wValue of w

Definition at line 199 of file btQuadWord.h.

References m_floats.

◆ getX()

SIMD_FORCE_INLINE const btScalar& getX ( ) const

◆ getY()

SIMD_FORCE_INLINE const btScalar& getY ( ) const

Return the y value.

Definition at line 101 of file btQuadWord.h.

References m_floats.

Referenced by btConnectivityProcessor::processTriangle().

◆ getZ()

SIMD_FORCE_INLINE const btScalar& getZ ( ) const

Return the z value.

Definition at line 103 of file btQuadWord.h.

References m_floats.

Referenced by btConnectivityProcessor::processTriangle().

◆ operator btScalar *()

SIMD_FORCE_INLINE operator btScalar * ( )

operator btScalar*() replaces operator[], using implicit conversion. We added operator != and operator == to avoid pointer comparisons.

Definition at line 124 of file btQuadWord.h.

References m_floats.

◆ operator const btScalar *()

SIMD_FORCE_INLINE operator const btScalar * ( ) const

Definition at line 125 of file btQuadWord.h.

References m_floats.

◆ operator!=()

SIMD_FORCE_INLINE bool operator!= ( const btQuadWord other) const

Definition at line 139 of file btQuadWord.h.

◆ operator==()

SIMD_FORCE_INLINE bool operator== ( const btQuadWord other) const

Definition at line 127 of file btQuadWord.h.

References m_floats.

◆ setMax()

SIMD_FORCE_INLINE void setMax ( const btQuadWord other)

Set each element to the max of the current values and the values of another btQuadWord.

Parameters
otherThe other btQuadWord to compare with

Definition at line 207 of file btQuadWord.h.

References btSetMax(), and m_floats.

◆ setMin()

SIMD_FORCE_INLINE void setMin ( const btQuadWord other)

Set each element to the min of the current values and the values of another btQuadWord.

Parameters
otherThe other btQuadWord to compare with

Definition at line 223 of file btQuadWord.h.

References btSetMin(), and m_floats.

◆ setValue() [1/2]

SIMD_FORCE_INLINE void setValue ( const btScalar _x,
const btScalar _y,
const btScalar _z 
)

Set x,y,z and zero w.

Parameters
xValue of x
yValue of y
zValue of z

Definition at line 149 of file btQuadWord.h.

References m_floats.

◆ setValue() [2/2]

SIMD_FORCE_INLINE void setValue ( const btScalar _x,
const btScalar _y,
const btScalar _z,
const btScalar _w 
)

Set the values.

Parameters
xValue of x
yValue of y
zValue of z
wValue of w

Definition at line 170 of file btQuadWord.h.

References m_floats.

◆ setW()

Set the w value.

Definition at line 111 of file btQuadWord.h.

References m_floats.

◆ setX()

Set the x value.

Definition at line 105 of file btQuadWord.h.

References m_floats.

◆ setY()

Set the y value.

Definition at line 107 of file btQuadWord.h.

References m_floats.

◆ setZ()

Set the z value.

Definition at line 109 of file btQuadWord.h.

References m_floats.

◆ w()

SIMD_FORCE_INLINE const btScalar& w ( ) const

Return the w value.

Definition at line 119 of file btQuadWord.h.

References m_floats.

Referenced by blender::gpu::GLContext::activate(), add_feather_vertex_exec(), addVertex(), Image::allocate(), ANIM_center_frame(), btSoftBody::appendNote(), btSoftBody::applyClusters(), btSoftBody::applyRepulsionForce(), blender::compositor::area_diag(), areas_do_frame_follow(), bake_rasterize(), barycentric_coords_v2(), barycentric_inside_triangle_v2(), barycentric_weights(), barycentric_weights_v2(), barycentric_weights_v2_clamped(), barycentric_weights_v2_persp(), barycentric_weights_v2_quad(), BaryCoord(), GHOST_WindowWayland::beginFullScreen(), bicubic_interpolation(), BKE_defvert_extract_vgroup_to_polyweights(), BKE_defvert_extract_vgroup_to_vertweights(), BKE_gpencil_stroke_smooth_point(), BKE_gpencil_stroke_smooth_strength(), BKE_gpencil_stroke_smooth_thickness(), BKE_gpencil_stroke_smooth_uv(), BKE_image_stamp_buf(), BKE_image_update_gputexture(), BKE_image_update_gputexture_delayed(), BKE_lattice_deform_data_create(), BKE_lattice_deform_data_eval_co(), BKE_lattice_index_flip(), BKE_lattice_index_from_uvw(), BKE_lattice_resize(), BKE_mask_layer_evaluate_animation(), BKE_mask_point_add_uw(), BKE_mesh_remap_calc_edges_from_mesh(), BKE_mesh_remap_calc_loops_from_mesh(), BKE_mesh_remap_calc_polys_from_mesh(), BKE_object_minmax(), BKE_previewimg_to_imbuf(), BKE_shrinkwrap_compute_smooth_normal(), BKE_tracking_get_search_imbuf(), BKE_where_on_path(), BLF_buffer(), blf_glyph_draw(), BLF_thumb_preview(), BLI_voxel_sample_tricubic(), BLI_voxel_sample_trilinear(), BLI_voxel_sample_triquadratic(), blinn_specular(), blender::gpu::GLFrameBuffer::blit_to(), BM_data_interp_face_vert_edge(), bm_data_interp_from_elem(), bm_edge_collapse_loop_customdata(), BM_edgeloop_calc_center(), BM_face_calc_center_median_weighted(), BM_face_interp_from_face_ex(), BM_face_split_edgenet(), BM_face_uv_calc_center_median_weighted(), bm_grid_fill_array(), BM_loop_interp_from_face(), bm_loop_interp_from_grid_boundary_2(), bm_loop_interp_from_grid_boundary_4(), bm_loop_walk_add(), BM_vert_collapse_faces(), BM_vert_interp_from_face(), bm_vert_loop_groups_data_layer_merge_weights__single(), bmo_smooth_laplacian_vert_exec(), Hair::Curve::bounds_grow(), brush_add(), brush_painter_imbuf_partial_update(), brush_painter_imbuf_update(), brush_painter_mask_imbuf_partial_update(), brush_painter_mask_imbuf_update(), bsdf_principled_hair_sample(), btComputeGjkEpaPenetration(), btMprVec3Add(), btMprVec3Copy(), btMprVec3PointTriDist2(), btMprVec3Sub2(), btSolveDantzigLCP(), btSwapProblem(), btVec3Copy(), btVec3PointTriDist2(), Freestyle::GaussianPyramid::BuildPyramid(), btMinkowskiPenetrationDepthSolver::calcPenDepth(), btSubsimplexConvexCast::calcTimeOfImpact(), blender::nodes::node_shader_tex_musgrave_cc::MusgraveFunction::call(), blender::nodes::node_shader_tex_noise_cc::NoiseFunction::call(), blender::nodes::node_shader_tex_voronoi_cc::VoronoiMinowskiFunction::call(), blender::nodes::node_shader_tex_voronoi_cc::VoronoiMetricFunction::call(), blender::nodes::node_shader_tex_voronoi_cc::VoronoiEdgeFunction::call(), blender::nodes::node_shader_tex_white_noise_cc::WhiteNoiseFunction::call(), ccdVec3Add(), ccdVec3Sub(), ccl_try_align(), choose_pixel_format_legacy(), choose_winner(), clip_view_calculate_view_selection(), closest_on_tri_to_point_v3(), closestPtPointTriangle(), Freestyle::OGF::compute_curvature_tensor(), computePitch(), constrain_rgb(), coord_to_local_index(), device_vector< T >::copy_from_device(), copy_v4_fl4(), btSoftBodyHelpers::CreateEllipsoid(), blender::compositor::FlipOperation::determine_depending_area_of_interest(), device_memory::device_copy_from(), dist_tent_v3f3(), distribute_children_exec(), distribute_from_verts_exec(), do_smear_brush_task_cb_exec(), KDL::RotationVel::DoRotX(), KDL::RotationVel::DoRotY(), KDL::RotationVel::DoRotZ(), GHOST_WindowWayland::dpi(), draw_circle_in_quad(), draw_filled_lasso(), draw_rect_point(), draw_tri_point(), drawviewborder_triangle(), DRW_texture_create_1d(), DRW_texture_create_2d(), DRW_texture_create_2d_array(), DRW_texture_create_3d(), DRW_texture_create_cube(), DRW_texture_create_cube_array(), DRW_texture_ensure_2d(), DRW_texture_pool_query_2d(), dynamic_paint_create_uv_surface_direct_cb(), dynamic_paint_create_uv_surface_neighbor_cb(), dynamic_paint_find_island_border(), dynamic_paint_find_neighbor_pixel(), dynamicPaint_createUVSurface(), ED_gpencil_trace_bitmap_new(), ED_image_get_uv_aspect(), ED_imapaint_dirty_region(), ed_panel_draw(), ED_space_clip_get_aspect_dimension_aware(), ED_space_image_get_uv_aspect(), ED_vgroup_mirror(), ed_view3d_project__internal(), edge_len_calc(), EEVEE_motion_blur_draw(), SVMCompiler::encode_uchar4(), GHOST_WindowWayland::endFullScreen(), GJK< btConvexTemplate >::Evaluate(), gjkepa2_impl::GJK::Evaluate(), gjkepa2_impl::EPA::Evaluate(), EPA< btConvexTemplate >::Evaluate(), blender::compositor::DespeckleOperation::execute_pixel(), blender::compositor::KeyingScreenOperation::execute_pixel(), blender::compositor::SMAANeighborhoodBlendingOperation::execute_pixel(), blender::compositor::MovieDistortionOperation::execute_pixel_sampled(), gjkepa2_impl::EPA::expand(), EPA< btConvexTemplate >::expand(), blender::draw::extract_fdots_uv_iter_poly_bm(), blender::draw::extract_fdots_uv_iter_poly_mesh(), extractRotation(), fast_ierff(), filter_make_index(), float3_to_float4(), flush_pixel(), Freestyle::FrsImage::FrsImage(), blender::compositor::GlareFogGlowOperation::generate_glare(), btSoftBody::generateClusters(), blender::compositor::FlipOperation::get_area_of_interest(), get_ss_weights(), GHOST_WindowSDL::getClientBounds(), GHOST_WindowWayland::getClientBounds(), btGjkPairDetector::getClosestPointsNonVirtual(), GHOST_WindowWayland::getDPIHint(), Freestyle::GaussianFilter::getSmoothedPixel(), GHOST_WindowWayland::getState(), Freestyle::SteerableViewMap::getSVMNumber(), GHOST_SetRectangleCenter(), GHOST_WindowWayland::GHOST_WindowWayland(), gizmo2d_xform_invoke_prepare(), blender::gpu::GLContext::GLContext(), blender::gpu::GLFrameBuffer::GLFrameBuffer(), gpencil_primitive_to_square(), GPENCIL_render_init(), gpencil_vfx_blur(), gpencil_vfx_pixelize(), gpencil_vfx_rim(), gpencil_vfx_shadow(), gpencil_vfx_swirl(), gpencil_vfx_wave(), GPU_framebuffer_read_color(), GPU_framebuffer_read_depth(), GPU_frontbuffer_read_pixels(), GPU_offscreen_read_pixels(), GPU_shader_uniform_4f(), gpu_texture_create(), GPU_texture_create_1d(), GPU_texture_create_1d_array(), GPU_texture_create_2d(), GPU_texture_create_2d_array(), GPU_texture_create_3d(), GPU_texture_create_compressed_2d(), GPU_texture_create_cube(), GPU_texture_create_cube_array(), GPU_texture_create_error(), gpu_texture_create_tile_array(), GPU_texture_orig_size_set(), gpu_texture_update_from_ibuf(), gpu_texture_update_scaled(), gpu_texture_update_unscaled(), GPU_viewport_draw_to_screen_ex(), grad4(), btSparseSdf< CELLSIZE >::Hash(), histogram_draw_one(), libmv::HomogeneousToEuclidean(), libmv::Homography2DFromCorrespondencesLinear(), libmv::Homography3DFromCorrespondencesLinear(), ibuftoimage(), icon_copy_rect(), icon_draw_rect(), icon_draw_rect_input(), icon_draw_size(), icon_draw_texture(), icon_draw_texture_cached(), image_main_region_set_view2d(), image_update_gputexture_ex(), image_view_all(), imapaint_image_update(), imapaint_pick_uv(), imapaint_region_tiles(), imapaint_tri_weights(), IMB_allocFromBuffer(), IMB_allocFromBufferOwn(), imb_load_filepath_thumbnail_openexr(), imb_load_jp2_stream(), IMB_premultiply_rect(), IMB_premultiply_rect_float(), IMB_tiles_to_rect(), IMB_touch_gpu_texture(), IMB_unpremultiply_rect(), IMB_unpremultiply_rect_float(), IMB_update_gpu_texture_sub(), immAttr4f(), immUniform4f(), immVertex4f(), ColorBlock::init(), blender::gpu::Texture::init_1D(), blender::gpu::Texture::init_2D(), blender::gpu::Texture::init_3D(), init_brush_icons(), blender::gpu::Texture::init_cubemap(), init_event_icons(), blender::gpu::GLTexture::init_internal(), inSimplex(), interp_qt_qtqt(), interp_v2_v2v2_slerp(), interp_v3_v3v3_slerp(), interp_v3_v3v3v3(), interp_v3_v3v3v3v3(), interp_v4_v4v4v4(), interp_v4_v4v4v4v4(), interp_weights_poly_v2(), interp_weights_poly_v3(), interp_weights_quad_v3(), interp_weights_tri_v3(), interpolate_particle_value(), intersect_dm_quad_weights(), KDL::RotationAcc::Inverse(), KDL::RotationVel::Inverse(), is_over_resolution_limit(), GHOST_WindowWayland::isDialog(), isect_ray_tri_watertight_v3(), kernel_tex_image_interp_3d(), laplaciansmoothModifier_do(), latt_bp(), lattice_batch_cache_get_edges(), lattice_flip_exec(), lattice_flip_point_value(), lattice_render_edges_len_get(), lattice_render_verts_len_get(), lattice_select_more_less(), lattice_swap_point_pairs(), lattice_test_bitmap_uvw(), layerInterp_mcol(), lineart_main_load_geometries(), Freestyle::Canvas::loadMap(), local_index_to_coord(), make_child_duplis_faces_from_editmesh(), make_child_duplis_faces_from_mesh(), make_float4(), make_int4(), make_sep_waveform_view_from_ibuf_byte(), make_sep_waveform_view_from_ibuf_float(), make_uchar4(), make_uint4(), make_vectorscope_view_from_ibuf_byte(), make_vectorscope_view_from_ibuf_float(), make_waveform_view_from_ibuf_byte(), make_waveform_view_from_ibuf_float(), makelatticesprings(), maskrasterize_layer_z_depth_quad(), math_vec3_add(), math_vec3_add_strided(), mdisp_rot_face_to_crn(), MultiDevice::mem_copy_from(), mesh_calc_ngon_center(), mesh_get_weights(), mf_eval_phase_glass(), mf_eval_phase_glossy(), mf_G1(), mf_lambda(), mf_sample_height(), DirectDrawSurface::mipmap(), blender::noise::mix(), motion_triangle_shader_setup(), motion_triangle_smooth_normal(), movieclip_main_area_set_view2d(), mul_project_m4_v3(), mul_v2_project_m4_v3(), mul_v3_project_m4_v3(), mul_v3m3_dq(), newPerlin(), NODE_DEFINE(), blender::noise::noise_grad(), object_shape_key_mirror(), btMatrixX< T >::operator*(), operator*(), KDL::RotationAcc::operator*(), KDL::RotationVel::operator*(), KDL::RotationAcc::operator=(), KDL::RotationVel::operator=(), blender::robust_pred::orient3dadapt(), GHOST_WindowWayland::outputs(), GHOST_WindowWayland::outputs_changed_update_scale(), GHOST_WindowWayland::outputs_enter(), GHOST_WindowWayland::outputs_leave(), outside_lattice(), p_face_stretch(), paint_2d_ibuf_add_if(), paint_2d_lift_clone(), paint_2d_torus_split_region(), perlin_3d(), perlin_4d(), blender::noise::perlin_noise(), btSoftColliders::CollideVF_SS::Process(), btSoftColliders::CollideVF_DD::Process(), MD5Hash::process(), project_bucket_clip_face(), project_bucket_point_occluded(), project_face_pixel(), project_paint_face_init(), project_paint_occlude_ptv(), project_paint_occlude_ptv_clip(), project_paint_op(), project_paint_PickColor(), project_paint_PickFace(), project_paint_uvpixel_init(), project_paint_uvpixel_mask(), gjkepa2_impl::GJK::projectorigin(), GJK< btConvexTemplate >::projectorigin(), psys_get_child_size(), psys_get_child_time(), psys_get_particle_on_path(), psys_interpolate_face(), psys_interpolate_mcol(), psys_interpolate_uvs(), psys_origspace_to_w(), psys_thread_create_path(), psys_uv_to_w(), psys_w_to_origspace(), pygpu_framebuffer_read_color(), pygpu_framebuffer_read_depth(), quad_mix(), rasterize_half(), RE_bake_normal_world_to_tangent(), RE_engine_begin_result(), Freestyle::AppCanvas::readColorPixels(), Freestyle::AppCanvas::readDepthPixels(), rect_from_shape(), rect_to_uvspace_ortho(), rect_to_uvspace_persp(), BVH2::refit_node(), render_result_from_bake(), render_result_to_bake(), resolve_tri_uv_v3(), libmv::RotationFromEulerVector(), libmv::RotationRodrigues(), GHOST_WindowWayland::scale(), sclip_zoom_set(), screen_animation_region_tag_redraw(), screen_px_from_ortho(), screen_px_from_persp(), sdl_ghost_CreateCursor(), libmv::euclidean_resection::SelectControlPoints(), set_ccgdm_all_geometry(), set_rast_triangle(), GHOST_Rect::setCenter(), GHOST_WindowWayland::setClientHeight(), GHOST_WindowWayland::setClientSize(), GHOST_WindowWayland::setClientWidth(), GHOST_WindowWayland::setState(), GHOST_WindowWayland::setTitle(), setViewPortGL(), DDSHeader::setWidth(), GHOST_WindowWayland::setWindowCursorGrab(), shadow_ray_smooth_surface_offset(), shrink_picture_byte(), shrink_picture_float(), SIM_mass_spring_force_reference_frame(), sima_zoom_set(), singularValueDecomposition(), slide_point_modal(), str_ghash_tests(), subsurface_disk(), GHOST_WindowWayland::surface(), svm_node_tex_musgrave(), svm_node_tex_noise(), svm_node_tex_voronoi(), svm_node_tex_white_noise(), svm_unpack_node_uchar4(), ColorBlock::swizzle(), btEigen::system(), system_console_width(), target_project_tri_deviation(), template_common_search_menu(), template_ID(), template_id_def_new_but(), TEST(), libmv::TEST(), test_projected_vert_dist(), test_quat_to_mat_to_quat(), text_cursor_set_to_pos(), text_do_suggest_select(), texture_paint_image_from_view_exec(), transform_direction(), transform_inverse_impl(), transform_perspective(), transform_point(), transform_to_quat(), tri_fill_smooth(), triangle_point_normal(), CCL_NAMESPACE_BEGIN::TextureInterpolator< TexT, OutT >::tricubic_lookup(), ui_draw_but_HISTOGRAM(), ui_draw_but_IMAGE(), ui_icon_view_menu_cb(), ui_item_array(), ui_item_disabled(), ui_item_enum_expand_elem_exec(), ui_item_menu(), ui_item_position(), ui_item_rna_size(), ui_item_scale(), ui_layout_add_but(), ui_litem_layout_box(), ui_litem_layout_column_flow(), ui_litem_layout_grid_flow(), ui_litem_layout_row(), ui_litem_layout_split(), UI_pie_menu_begin(), ui_popup_context_menu_for_button(), ui_tooltip_create_with_data(), uiblock_layer_pass_buttons(), uiItemFullO_ptr_ex(), uiItemFullR(), uiItemL_(), uiItemPointerR_prop(), uiItemV(), blender::ed::sculpt_paint::paint::image::undo_region_tiles(), KDL::RotationVel::UnitX(), KDL::RotationVel::UnitY(), KDL::RotationVel::UnitZ(), btLCP::unpermute(), update_do_scale(), blender::compositor::DespeckleOperation::update_memory_buffer_partial(), blender::compositor::GaussianBlurReferenceOperation::update_memory_buffer_partial(), blender::compositor::KeyingScreenOperation::update_memory_buffer_partial(), blender::compositor::MovieDistortionOperation::update_memory_buffer_partial(), blender::compositor::SMAANeighborhoodBlendingOperation::update_memory_buffer_partial(), IK_QSphericalSegment::UpdateAngle(), IK_QSwingSegment::UpdateAngle(), uv_snap_to_pixel(), uv_snap_uvs_to_pixels(), Vector_slerp(), vectorscope_put_cross(), VecZDepthOrtho(), VecZDepthPersp(), vert_len_calc(), vicon_collection_color_draw(), vicon_colorset_draw(), vicon_gplayer_color_draw(), vicon_handletype_aligned_draw(), vicon_handletype_auto_clamp_draw(), vicon_handletype_auto_draw(), vicon_handletype_free_draw(), vicon_handletype_vector_draw(), vicon_keytype_breakdown_draw(), vicon_keytype_draw_wrapper(), vicon_keytype_extreme_draw(), vicon_keytype_jitter_draw(), vicon_keytype_keyframe_draw(), vicon_keytype_moving_hold_draw(), vicon_strip_color_draw(), vicon_strip_color_draw_library_data_indirect(), vicon_strip_color_draw_library_data_override_noneditable(), view3d_depths_rect_create(), view_all_exec(), BlenderSession::view_draw(), blender::noise::voronoi_distance_to_edge(), voronoi_distance_to_edge_1d(), blender::noise::voronoi_f1(), voronoi_f1_1d(), blender::noise::voronoi_f2(), voronoi_f2_1d(), blender::noise::voronoi_n_sphere_radius(), voronoi_n_sphere_radius_1d(), blender::noise::voronoi_smooth_f1(), voronoi_smooth_f1_1d(), weightflagNurb(), weightvg_update_vg(), wform_put_border(), wform_put_grid(), wform_put_gridrow(), wform_put_line(), wform_put_line_single(), widget_draw_preview(), widget_progressbar(), window_display_help(), blender::compositor::MemoryBuffer::wrap_pixel(), wrapped_lighting(), GHOST_Rect::wrapPoint(), xdg_toplevel_handle_close(), and GHOST_WindowWayland::~GHOST_WindowWayland().

◆ x()

SIMD_FORCE_INLINE const btScalar& x ( ) const

Return the x value.

Definition at line 113 of file btQuadWord.h.

References m_floats.

◆ y()

SIMD_FORCE_INLINE const btScalar& y ( ) const

Return the y value.

Definition at line 115 of file btQuadWord.h.

References m_floats.

◆ z()

SIMD_FORCE_INLINE const btScalar& z ( ) const

Return the z value.

Definition at line 117 of file btQuadWord.h.

References m_floats.

Variable Documentation

◆ btQuadWord

SIMD_FORCE_INLINE btQuadWord

The btQuadWord class is base class for btVector3 and btQuaternion. Some issues under PS3 Linux with IBM 2.1 SDK, gcc compiler prevent from using aligned quadword.

No initialization constructor.

Definition at line 30 of file btQuadWord.h.