Blender
V3.3
|
Namespaces | |
tests | |
Classes | |
struct | isect_result |
Functions | |
template<typename T > | |
bool | is_zero (const T &a) |
template<typename T > | |
bool | is_any_zero (const T &a) |
template<typename T > | |
T | abs (const T &a) |
template<typename T > | |
T | min (const T &a, const T &b) |
template<typename T > | |
T | max (const T &a, const T &b) |
template<typename T > | |
void | max_inplace (T &a, const T &b) |
template<typename T > | |
void | min_inplace (T &a, const T &b) |
template<typename T > | |
T | clamp (const T &a, const T &min, const T &max) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | mod (const T &a, const T &b) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | safe_mod (const T &a, const T &b) |
template<typename T > | |
void | min_max (const T &value, T &min, T &max) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | safe_divide (const T &a, const T &b) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | floor (const T &a) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | ceil (const T &a) |
template<typename T > | |
T | distance (const T &a, const T &b) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | fract (const T &a) |
template<typename T , typename FactorT , BLI_ENABLE_IF((std::is_arithmetic_v< T >)) , BLI_ENABLE_IF((is_math_float_type< FactorT >)) > | |
T | interpolate (const T &a, const T &b, const FactorT &t) |
template<typename T > | |
T | midpoint (const T &a, const T &b) |
template<eAlpha Alpha> | |
ColorSceneLinear4f< Alpha > | interpolate (const ColorSceneLinear4f< Alpha > &a, const ColorSceneLinear4f< Alpha > &b, const float t) |
template<eAlpha Alpha> | |
ColorSceneLinearByteEncoded4b< Alpha > | interpolate (const ColorSceneLinearByteEncoded4b< Alpha > &a, const ColorSceneLinearByteEncoded4b< Alpha > &b, const float t) |
float3 | rotate_direction_around_axis (const float3 &direction, const float3 &axis, float angle) |
float3 | rotate_around_axis (const float3 &vector, const float3 ¢er, const float3 &axis, float angle) |
template<typename T > | |
uint64_t | vector_hash (const T &vec) |
template<typename T , int Size> | |
bool | is_zero (const vec_base< T, Size > &a) |
template<typename T , int Size> | |
bool | is_any_zero (const vec_base< T, Size > &a) |
template<typename T , int Size> | |
bool | almost_equal_relative (const vec_base< T, Size > &a, const vec_base< T, Size > &b, const T &epsilon_factor) |
template<typename T , int Size> | |
vec_base< T, Size > | abs (const vec_base< T, Size > &a) |
template<typename T , int Size> | |
vec_base< T, Size > | min (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size> | |
vec_base< T, Size > | max (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size> | |
vec_base< T, Size > | clamp (const vec_base< T, Size > &a, const vec_base< T, Size > &min, const vec_base< T, Size > &max) |
template<typename T , int Size> | |
vec_base< T, Size > | clamp (const vec_base< T, Size > &a, const T &min, const T &max) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | mod (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | mod (const vec_base< T, Size > &a, const T &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | safe_mod (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | safe_mod (const vec_base< T, Size > &a, const T &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_integral_type< T >)) > | |
vec_base< T, Size > | ceil_to_multiple (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_integral_type< T >)) > | |
vec_base< T, Size > | divide_ceil (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size> | |
void | min_max (const vec_base< T, Size > &vector, vec_base< T, Size > &min, vec_base< T, Size > &max) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | safe_divide (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | safe_divide (const vec_base< T, Size > &a, const T &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | floor (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | ceil (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | fract (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | dot (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size> | |
T | length_manhattan (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | length_squared (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | length (const vec_base< T, Size > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | distance_manhattan (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | distance_squared (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
T | distance (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | reflect (const vec_base< T, Size > &incident, const vec_base< T, Size > &normal) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | refract (const vec_base< T, Size > &incident, const vec_base< T, Size > &normal, const T &eta) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | project (const vec_base< T, Size > &p, const vec_base< T, Size > &v_proj) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | normalize_and_get_length (const vec_base< T, Size > &v, T &out_length) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | normalize (const vec_base< T, Size > &v) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, 3 > | cross (const vec_base< T, 3 > &a, const vec_base< T, 3 > &b) |
vec_base< float, 3 > | cross_high_precision (const vec_base< float, 3 > &a, const vec_base< float, 3 > &b) |
template<typename T , BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, 3 > | cross_poly (Span< vec_base< T, 3 >> poly) |
template<typename T , typename FactorT , int Size, BLI_ENABLE_IF((is_math_float_type< FactorT >)) > | |
vec_base< T, Size > | interpolate (const vec_base< T, Size > &a, const vec_base< T, Size > &b, const FactorT &t) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | midpoint (const vec_base< T, Size > &a, const vec_base< T, Size > &b) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
vec_base< T, Size > | faceforward (const vec_base< T, Size > &vector, const vec_base< T, Size > &incident, const vec_base< T, Size > &reference) |
template<typename T > | |
int | dominant_axis (const vec_base< T, 3 > &a) |
template<typename T , int Size, BLI_ENABLE_IF((is_math_float_type< T >)) > | |
isect_result< vec_base< T, Size > > | isect_seg_seg (const vec_base< T, Size > &v1, const vec_base< T, Size > &v2, const vec_base< T, Size > &v3, const vec_base< T, Size > &v4) |
template<> | |
isect_result< float2 > | isect_seg_seg (const float2 &v1, const float2 &v2, const float2 &v3, const float2 &v4) |
template<> | |
isect_result< double2 > | isect_seg_seg (const double2 &v1, const double2 &v2, const double2 &v3, const double2 &v4) |
Variables | |
template<typename T > | |
constexpr bool | is_math_float_type = std::is_floating_point_v<T> |
template<typename T > | |
constexpr bool | is_math_integral_type = std::is_integral_v<T> |
Definition at line 32 of file BLI_math_base.hh.
References Freestyle::a.
Referenced by actionzone_modal(), almost_equal_relative(), annotation_draw_apply_event(), blender::io::obj::append_frame_to_filename(), apply_stroke_envelope(), area_move_apply_do(), area_snap_calc_location(), BKE_fcurve_delete_key(), BKE_gpencil_layer_frame_get(), BKE_mask_spline_project_co(), BKE_paint_face_set_overlay_color_get(), BKE_sculpt_face_sets_ensure_from_base_mesh_visibility(), BKE_volume_grid_determinant_valid(), blend_color_difference_byte(), BLI_listbase_link_move(), blo_do_versions_280(), bm_loop_build(), bm_loop_path_build_step(), brush_scale_size_exec(), blender::bke::curves::poly::calculate_normals_z_up(), blender::nodes::node_shader_tex_checker_cc::NodeTexChecker::call(), check_single_face_set(), check_zone(), compare_ff_relative(), compare_floats(), compare_rgb_uchar(), btDeformableBodySolver::computeDescentStep(), Eigen::internal::constrained_conjugate_gradient(), continuousCollisionDetection(), blender::nodes::node_geo_mesh_primitive_ico_sphere_cc::create_ico_sphere_mesh(), blender::geometry::create_nurbs_to_bezier_handles(), distance(), do_draw_face_sets_brush_task_cb_ex(), dominant_axis(), draw_horizontal_scale_indicators(), DRW_displist_indexbuf_create_edges_adjacency_lines(), DRW_select_buffer_find_nearest_to_point(), ED_preview_draw(), ed_preview_draw_rect(), ED_region_generic_tools_region_snap_size(), ED_sculpt_face_sets_find_next_available_id(), blender::bke::curves::encode_surface_bary_coord(), establish_track_initialization_order(), blender::draw::extract_lines_adjacency_finish(), file_smoothscroll_invoke(), blender::ui::BuildOnlyVisibleButtonsHelper::fill_layout_before_visible(), find_nearest_seq(), flushTransSeq(), generateUnitOrthogonalVector(), geometry_extract_tag_face_set(), blender::nodes::node_fn_compare_cc::get_multi_function(), Freestyle::GaussianFilter::getSmoothedPixel(), gpencil_get_outline_points(), gpencil_layer_final_tint_and_alpha_get(), gpencil_render_offscreen(), GPU_pbvh_grid_buffers_update(), GPU_pbvh_mesh_buffers_update(), hsl_to_rgb(), image_buf_fill_checker_slice(), len_manhattan_v2_int(), blender::draw::lines_adjacency_triangle(), GHOST_Wintab::mapWintabToSysCoordinates(), mesh_join_offset_face_sets_ID(), blender::color::mix_difference(), modf_to_index(), mouse_select_knot(), moviecache_getitempriority(), blender::noise::musgrave_ridged_multi_fractal(), nla_draw_strip_curves(), pingpong(), GHOST_SystemWin32::processWheelEvent(), proximityTest(), Freestyle::AppView::rabs(), region_scale_modal(), region_visible_rect_calc(), remapTime(), screen_area_join_aligned(), screen_area_trim(), screen_geom_area_map_find_active_scredge(), sculpt_check_unique_face_set_for_edge_in_base_mesh(), sculpt_check_unique_face_set_in_base_mesh(), sculpt_expand_delete_face_set_id(), sculpt_face_set_delete_geometry(), sculpt_face_set_edit_modify_coordinates(), sculpt_face_set_edit_modify_face_sets(), sculpt_face_set_edit_modify_geometry(), sculpt_face_set_grow(), SCULPT_face_set_next_available_get(), sculpt_face_set_shrink(), SCULPT_face_set_visibility_set(), SCULPT_face_sets_visibility_all_set(), sculpt_mask_expand_modal(), SCULPT_vertex_face_set_get(), SCULPT_vertex_face_set_set(), SCULPT_visibility_sync_all_vertex_to_face_sets(), sculpt_visibility_sync_vertex_to_face_sets(), select_adjacent_cp(), select_nth_bezt(), select_nth_bp(), seq_frame_snap_update_best(), SEQ_time_find_next_prev_edit(), sequencer_thumbnail_closest_from_memory(), sequencer_thumbnail_closest_previous_frame_get(), set_constraint_nth_target(), set_edge_adjacency_lines_indices(), GHOST_DisplayManagerX11::setCurrentDisplaySetting(), setCustomPointsFromDirection(), setNearestAxis2d(), smoothmin(), snapNode(), svm_checker(), btModifiedGramSchmidt< TV >::test(), blender::bke::tests::test_vec_roll_to_mat3_orthogonal(), GHOST_Wintab::testCoordinates(), thumb_create_ex(), transform_snap_sequencer_calc(), blender::nodes::try_dispatch_float_math_fl3_to_fl3(), ui_but_drag_init(), ui_but_dragedit_update_mval(), ui_do_but_COLORBAND(), ui_do_but_NUM(), ui_do_but_SLI(), ui_do_button(), ui_numedit_but_NUM(), ui_pan_to_scroll(), UI_view2d_totRect_set_resize(), vert_pair_adjacent_in_orig_face(), blender::noise::voronoi_distance(), blender::noise::voronoi_distance_to_edge(), blender::noise::voronoi_n_sphere_radius(), wm_autosave_location(), WM_event_drag_test_with_delta(), and workbench_dof_setup_samples().
|
inline |
Definition at line 66 of file BLI_math_vector.hh.
References Freestyle::a, and result.
Referenced by length_manhattan().
|
inline |
Definition at line 53 of file BLI_math_vector.hh.
References Freestyle::a, abs(), usdtokens::b(), distance(), and blender::robust_pred::epsilon.
Referenced by blender::bke::curves::poly::calculate_tangents(), and blender::bke::curves::poly::direction_bisect().
|
inline |
Definition at line 90 of file BLI_math_base.hh.
References Freestyle::a, and ceil().
|
inline |
Definition at line 231 of file BLI_math_vector.hh.
References Freestyle::a, ceil(), and result.
|
inline |
Returns a if it is a multiple of b or the next multiple or b after a . In other words, it is equivalent to divide_ceil(a, b) * b
. It is undefined if a is negative or b is not strictly positive.
Definition at line 168 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), BLI_assert, and result.
Referenced by blender::tests::TEST().
Definition at line 57 of file BLI_math_base.hh.
References Freestyle::a, max(), and min().
Referenced by CBSSRDFClosure::alloc(), bake_offset_towards_center(), BKE_curveprofile_table_size(), bsdf_ashikhmin_shirley_setup(), bsdf_hair_reflection_setup(), bsdf_hair_transmission_setup(), bsdf_microfacet_multi_ggx_common_setup(), bsdf_microfacet_multi_ggx_glass_fresnel_setup(), bsdf_microfacet_multi_ggx_glass_setup(), BVHSpatialSplit::BVHSpatialSplit(), NURBSpline::calculate_basis_cache(), blender::bke::curves::nurbs::calculate_basis_cache(), Freestyle::CalligraphicShader::CalligraphicShader(), BoundBox2D::clamp(), blender::nodes::node_shader_map_range_cc::clamp_range(), ClampNode::constant_fold(), RGBRampNode::constant_fold(), blender::compositor::BlurNode::convert_to_operations(), create_mesh(), SceneParams::curve_subdivisions(), DRW_shgroup_curves_create_sub(), eevee_lightbake_render_probe_sample(), eevee_lightbake_render_world_sample(), EEVEE_lightbake_update_world_quick(), MapRangeNode::expand(), fast_exp2f(), fast_exp2f4(), fast_log2f(), fast_logb(), float_ramp_lookup(), blender::bke::float_to_int8(), blender::nodes::node_fn_slice_string_cc::fn_node_slice_string_build_multi_function(), ConstantFolder::fold_mix(), fractal_noise(), fractal_noise_1d(), fractal_noise_2d(), fractal_noise_3d(), fractal_noise_4d(), BVHObjectBinning::get_bin(), BlenderSync::get_session_params(), blender::nodes::node_shader_map_range_cc::gpu_shader_map_range(), hsl_to_rgb(), blender::bke::int_to_int8(), interpolate_hair_points(), kernel_curve_shadow_transparency_evaluate(), light_distribution_sample(), blender::geometry::limit_radius(), blender::nodes::node_geo_curve_trim_cc::lookup_control_point_position(), ConstantFolder::make_constant_clamp(), mf_ggx_transmission_albedo(), NODE_DEFINE(), blender::ed::space_node::node_link_dim_factor(), ObtainCacheParticleData(), quat_interpolate(), rect_light_sample(), rgb_ramp_lookup(), RVIsolateHighlights_float(), blender::geometry::ReverseUVSampler::sample(), blender::nodes::node_geo_curve_sample_cc::sample_indices_and_lengths(), sample_trimmed_logistic(), schlick_fresnel(), blender::bke::set_material_index(), blender::nodes::node_shader_map_range_cc::sh_node_map_range_build_multi_function(), blender::nodes::node_shader_mix_rgb_cc::sh_node_mix_rgb_build_multi_function(), shadow_ray_offset(), sky_texture_precompute_hosek(), smootherstep(), BVHSpatialSplit::split_curve_primitive(), BVHSpatialSplit::split_triangle_primitive(), subsurface_random_walk(), subsurface_random_walk_remap(), svm_image_texture_wrap_clamp(), svm_node_clamp(), svm_node_closure_bsdf(), svm_node_layer_weight(), svm_node_tex_musgrave(), svm_node_tex_voronoi(), svm_node_vector_map_range(), blender::tests::TEST(), blender::nodes::node_geo_curve_trim_cc::trim_bezier_spline(), ConstantFolder::try_bypass_or_make_constant(), IK_QSphericalSegment::UpdateAngle(), IK_QRevoluteSegment::UpdateAngle(), IK_QSwingSegment::UpdateAngle(), IK_QElbowSegment::UpdateAngle(), IK_QTranslateSegment::UpdateAngle(), blender::nodes::node_geo_image_texture_cc::ImageFieldsFunction::wrap_clamp(), and CCL_NAMESPACE_BEGIN::TextureInterpolator< TexT, OutT >::wrap_clamp().
|
inline |
Definition at line 108 of file BLI_math_vector.hh.
References Freestyle::a, max(), min(), and result.
Referenced by clamp().
|
inline |
Definition at line 96 of file BLI_math_vector.hh.
References Freestyle::a, clamp(), max(), min(), and result.
|
inline |
Definition at line 352 of file BLI_math_vector.hh.
References Freestyle::a, and usdtokens::b().
Referenced by __anyhit__kernel_optix_local_hit(), angle_signed_on_axis_normalized_v3v3_v3(), Hair::apply_transform(), PointCloud::apply_transform(), bevel_list_smooth(), BKE_gpencil_stroke_2d_flat(), BM_edge_is_convex(), BM_edgeloop_calc_normal_aligned(), BM_face_calc_area_uv(), bm_face_split_by_concave(), bm_mesh_calc_volume_face(), bsdf_hair_reflection_sample(), bsdf_hair_transmission_sample(), bsdf_principled_hair_eval(), bsdf_principled_hair_sample(), bt_edge_plane(), btPrimitiveTriangle::buildTriPlane(), btTriangleShapeEx::buildTriPlane(), calcNormal(), blender::bke::curves::poly::calculate_next_normal(), calculate_next_normal(), blender::ed::sculpt_paint::min_distance_edit::calculate_points_per_side(), camera_sample_panorama(), blender::compositor::check_corners(), SphereTriangleDetector::collide(), compute_face_normal(), Mesh::Triangle::compute_normal(), btRigidBody::computeImpulseDenominator(), continuousCollisionDetection(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), blender::nodes::node_geo_curve_primitive_circle_cc::create_point_circle_curve(), blender::nodes::node_geo_scale_elements_cc::create_single_axis_transform(), cross_poly_v2(), ED_view3d_depth_read_cached_normal(), edbm_dupli_extrude_cursor_invoke(), edge_edge_angle_less_than_180(), edges_angle_kind(), eevee_light_setup(), BicubicPatch::eval(), fillMultiBodyConstraint(), blender::float4x4::from_normalized_axis_data(), getJs(), getVelocityInLocalPointNoDelta(), getVelocityInLocalPointObsolete(), initialize2(), internalGetVelocityInLocalPointObsolete(), MyInternalTriangleIndexCallback::internalProcessTriangleIndex(), is_edge_convex_v3(), is_poly_convex_v2(), lineIntersectsTriangle(), make_orthonormals(), make_orthonormals_tangent(), make_transform_frame(), mean_value_half_tan_v3(), blender::ed::sculpt_paint::min_distance_edit::min_distance_edit_draw(), modifyMesh(), motion_triangle_shader_setup(), Mesh::SubdFace::normal(), btDeformableMultiBodyDynamicsWorld::performGeometricCollisions(), pointOutsideOfPlane(), primitive_tangent(), DebugDrawcallback::processTriangle(), btConnectivityProcessor::processTriangle(), btSoftBodyTriangleCallback::processTriangle(), rect_light_sample(), rotate_direction_around_axis(), rotate_direction_around_axis(), blender::bke::mesh_surface_sample::sample_surface_points_spherical(), setupContactConstraint(), setupFrictionConstraint(), setupMultiBodyContactConstraint(), slide_check_corners(), sortCachedPoints(), spherical_stereo_transform(), svm_node_normal_map(), svm_node_set_bump(), svm_node_tangent(), svm_node_vector_displacement(), svm_vector_math(), TEST(), transform_inverse_cross(), transform_inverse_impl(), transform_negative_scale(), triangle_area(), triangle_light_pdf(), triangle_light_sample(), triangle_normal(), triangle_point_normal(), and wireframe().
|
inline |
Definition at line 357 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), double(), and float().
Referenced by blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl3().
|
inline |
Definition at line 366 of file BLI_math_vector.hh.
Referenced by get_dupliface_transform_from_coords().
Definition at line 95 of file BLI_math_base.hh.
References Freestyle::a, abs(), and usdtokens::b().
Referenced by _softbody_calc_forces_slice_in_a_thread(), blender::length_parameterize::accumulate_lengths(), accumulate_lengths(), btGImpactCollisionAlgorithm::addContactPoint(), almost_equal_relative(), applyPushPull(), applyShrinkFatten(), BKE_curveprofile_insert(), brush_influence_calc(), brush_painter_2d_refresh_cache(), brush_painter_imbuf_new(), brush_smear_apply(), btComputeGjkEpaPenetration(), blender::bke::curves::bezier::calculate_aligned_handle(), blender::ed::sculpt_paint::min_distance_edit::calculate_points_per_side(), capsuleCapsuleDistance(), Freestyle::GridHelpers::closestPointOnPolygon(), Freestyle::GridHelpers::closestPointToSegment(), cloth_brush_simulation_falloff_get(), cloth_collision(), cloth_selfcollision(), SphereTriangleDetector::collide(), btConvexPlaneCollisionAlgorithm::collideSingleContact(), collision_response(), blender::ed::sculpt_paint::ScaleCurvesEffect::compute_poly_curve_length(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), blender::nodes::node_geo_curve_primitive_circle_cc::create_point_circle_curve(), createPredictiveContactsInternal(), curves_batch_cache_fill_segments_proc_pos(), Freestyle::GridHelpers::distancePointToPolygon(), do_cloth_brush_apply_forces_task_cb_ex(), draw_bone_envelope(), draw_horizontal_scale_indicators(), draw_vertical_scale_indicators(), drw_shgroup_bone_envelope_distance(), dynamic_paint_paint_single_point_cb_ex(), edge_pan_speed(), envelope_bone_weighting(), libmv::EuclideanScaleToUnity(), blender::compositor::DilateErodeThresholdOperation::execute_pixel(), blender::compositor::DilateDistanceOperation::execute_pixel(), blender::compositor::ErodeDistanceOperation::execute_pixel(), blender::compositor::BokehImageOperation::execute_pixel_sampled(), blender::compositor::DistanceRGBMatteOperation::execute_pixel_sampled(), blender::compositor::KeyingOperation::execute_pixel_sampled(), fill_crossdata_for_intersect(), find_nearest_plane_track(), btPolyhedralContactClipping::findSeparatingAxis(), btSoftBody::generateBendingConstraints(), blender::string_search::get_fuzzy_match_errors(), btGjkPairDetector::getClosestPointsNonVirtual(), btSphereBoxCollisionAlgorithm::getSphereDistance(), btGImpactCollisionAlgorithm::gimpacttrimeshpart_vs_plane_collision(), gpencil_brush_influence_calc(), gpencil_stroke_eraser_calc_influence(), blender::render::texturemargin::TextureMarginMap::grow_dijkstra(), hair_collision(), BCMatrix::in_range(), blender::compositor::DirectionalBlurOperation::init_execution(), InputCustomRatioFlip(), blender::Vector< T, InlineBufferCapacity, Allocator >::insert(), key_inside_circle(), blender::geometry::limit_radius(), merge_channels_metadata(), blender::ed::sculpt_paint::min_distance_edit::min_distance_edit_draw(), move_all_selected_points(), move_bezt_handle_or_vertex_by_displacement(), blender::ed::sculpt_paint::move_last_point_and_resample(), NODE_DEFINE(), blender::ed::space_node::node_under_mouse_tweak(), libmv::nViewDatasetConfigator::nViewDatasetConfigator(), paint_2d_stroke(), paint_brush_color_get(), paint_proj_stroke(), paint_proj_stroke_ps(), blender::ed::sculpt_paint::image::ops::paint::ProjectionPaintMode::paint_stroke(), blender::ed::sculpt_paint::image::ops::paint::ImagePaintMode::paint_stroke(), blender::ed::sculpt_paint::image::ops::paint::paint_stroke_update_step(), parse_channels(), blender::ed::space_node::pick_input_link_by_link_intersect(), btConvexPlaneCollisionAlgorithm::processCollision(), btTriangleRaycastCallback::processTriangle(), ray_optical_depth(), resolveSingleBilateral(), resolveSingleCollision(), blender::ed::sculpt_paint::sample_curves_3d_brush(), blender::ed::sculpt_paint::DensityAddOperationExecutor::sample_projected_with_symmetry(), blender::ed::sculpt_paint::DensityAddOperationExecutor::sample_spherical_with_symmetry(), sb_spring_force(), sculpt_boundary_index_add(), blender::ed::sculpt_paint::select_grow::select_grow_update(), select_major_distance(), blender::compositor::DilateErodeThresholdOperation::set_distance(), blender::compositor::DilateDistanceOperation::set_distance(), set_handle_position(), blender::compositor::KeyingNode::setup_dilate_erode(), blender::compositor::KeyingNode::setup_feather(), setupFrictionConstraint(), setupMultiBodyContactConstraint(), single_scattering(), svm_node_camera(), svm_vector_math(), tablet_tool_handle_distance(), TEST(), blender::length_parameterize::tests::test_uniform_lengths(), transdata_elem_push_pull(), transdata_elem_shrink_fatten(), blender::ed::sculpt_paint::transform_brush_radius(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl(), blender::compositor::BokehImageOperation::update_memory_buffer_partial(), blender::compositor::DistanceRGBMatteOperation::update_memory_buffer_partial(), blender::compositor::KeyingOperation::update_memory_buffer_partial(), blender::ed::sculpt_paint::select_grow::update_points_selection(), View(), view2d_major_step_x__time(), blender::noise::voronoi_distance(), voronoi_distance_2d(), voronoi_distance_3d(), voronoi_distance_4d(), voronoi_getNextSideCoord(), blender::noise::voronoi_n_sphere_radius(), voronoi_n_sphere_radius_2d(), voronoi_n_sphere_radius_3d(), voronoi_n_sphere_radius_4d(), walkEvent(), and wm_block_splash_image_roundcorners_add().
|
inline |
Definition at line 294 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and length().
|
inline |
Definition at line 282 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and length_manhattan().
|
inline |
Definition at line 288 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and length_squared().
Referenced by cast_ray_highpoly(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), do_fake_neighbor_search_task_cb(), do_nearest_vertex_get_task_cb(), blender::compositor::DilateDistanceOperation::execute_opencl(), blender::compositor::ErodeDistanceOperation::execute_opencl(), fill_crossdata_for_intersect(), blender::ed::sculpt_paint::SlideOperationExecutor::find_closest_ray_hit(), blender::ed::sculpt_paint::find_curves_brush_position(), blender::ed::sculpt_paint::SlideOperationExecutor::find_curves_to_slide(), blender::nodes::node_geo_transfer_attribute_cc::get_closest_mesh_corners(), mouse_to_closest_pattern_corner_distance_squared(), remove_non_constraint_edges_leave_valid_bmesh(), blender::bke::mesh_surface_sample::sample_surface_points_spherical(), tracking_marker_check_slide(), and tracking_plane_marker_check_slide().
|
inline |
Integer division that returns the ceiling, instead of flooring like normal C division. It is undefined if a is negative or b is not strictly positive.
Definition at line 184 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), BLI_assert, and result.
Referenced by blender::eevee::Film::init(), blender::eevee::Film::sync(), and blender::tests::TEST().
Definition at line 411 of file BLI_math_vector.hh.
References Freestyle::a, abs(), and usdtokens::b().
|
inline |
Definition at line 251 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), result, and T.
Referenced by btPerturbedContactResult::addContactPoint(), btDeformableMassSpringForce::addScaledDampingForceDifferential(), Hair::apply_transform(), PointCloud::apply_transform(), atmosphere_intersection(), attr_create_pointiness(), bake_offset_towards_center(), bezier_handle_calc_length_v3(), BKE_mesh_remap_calc_loops_from_mesh(), BKE_object_empty_image_data_is_visible_in_view3d(), blender_camera_focal_distance(), bm_vert_pair_best_face_get(), bm_vert_pair_share_best_splittable_face_cb(), BM_vert_pair_share_face_by_angle(), bsdf_ashikhmin_shirley_eval_reflect(), bsdf_ashikhmin_shirley_sample(), bsdf_ashikhmin_velvet_eval_reflect(), bsdf_ashikhmin_velvet_sample(), bsdf_diffuse_eval_reflect(), bsdf_diffuse_sample(), bsdf_diffuse_toon_eval_reflect(), bsdf_diffuse_toon_sample(), bsdf_eval(), bsdf_glossy_toon_eval_reflect(), bsdf_glossy_toon_sample(), bsdf_hair_reflection_eval_reflect(), bsdf_hair_reflection_sample(), bsdf_hair_transmission_eval_transmit(), bsdf_hair_transmission_sample(), bsdf_microfacet_beckmann_eval_reflect(), bsdf_microfacet_beckmann_eval_transmit(), bsdf_microfacet_beckmann_sample(), bsdf_microfacet_ggx_eval_reflect(), bsdf_microfacet_ggx_eval_transmit(), bsdf_microfacet_ggx_sample(), bsdf_microfacet_multi_ggx_eval_reflect(), bsdf_microfacet_multi_ggx_glass_eval_reflect(), bsdf_microfacet_multi_ggx_glass_eval_transmit(), bsdf_microfacet_multi_ggx_glass_sample(), bsdf_microfacet_multi_ggx_sample(), bsdf_oren_nayar_eval_reflect(), bsdf_oren_nayar_get_intensity(), bsdf_oren_nayar_sample(), bsdf_principled_diffuse_compute_brdf(), bsdf_principled_diffuse_eval_reflect(), bsdf_principled_diffuse_retro_reflection_sample_weight(), bsdf_principled_diffuse_sample(), bsdf_principled_hair_eval(), bsdf_principled_hair_sample(), bsdf_principled_sheen_eval_reflect(), bsdf_principled_sheen_sample(), bsdf_reflection_sample(), bsdf_sample(), bsdf_translucent_eval_transmit(), bsdf_translucent_sample(), btDiscoverPortal(), btDoSimplex2(), btDoSimplex3(), btExpandPortal(), btMprVec3Dot(), btNearestPointInLineSegment(), btVec3Dot(), btPrimitiveTriangle::buildTriPlane(), btTriangleShapeEx::buildTriPlane(), bump_shadowing_term(), calc_edge_mat(), calculate_avg_principled_sheen_brdf(), calculate_principled_sheen_brdf(), camera_distance(), closestPtPointTetrahedron(), collision_response(), compatible_faceforward(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), btMultiBodyFixedConstraint::createConstraintRows(), btMultiBodySliderConstraint::createConstraintRows(), deflect_emitter_iter(), differential_transfer(), direction_to_fisheye_lens_polynomial(), dynamic_paint_paint_mesh_cell_point_cb_ex(), emissive_pdf(), ensure_valid_reflection(), btSoftBodyHelpers::extrapolateBarycentricWeights(), faceforward(), FindIncidentEdge(), fisheye_lens_polynomial_to_direction(), fresnel_dielectric(), frontface(), get_limit_motor_info2(), blender::nodes::node_fn_compare_cc::get_multi_function(), blender::nodes::node_geo_input_mesh_face_is_planar_cc::PlanarFieldInput::get_varray_for_context(), blender::nodes::node_geo_input_mesh_edge_angle_cc::SignedAngleFieldInput::get_varray_for_context(), btSoftBodyHelpers::getBarycentricWeights(), getBernsteinCoeff(), btGjkPairDetector::getClosestPointsNonVirtual(), in_line< double >(), LocalSupportVertexCallback::internalProcessTriangleIndex(), interpolate_fresnel_color(), is_quad_flip_v3_first_third_fast_with_normal(), isect_line_plane_v3(), isect_ray_plane_v3(), kernel_embree_filter_func_backface_cull(), kernel_embree_filter_occluded_func_backface_cull(), lamp_light_pdf(), length_squared(), light_sample(), light_sample_from_distant_ray(), light_spread_attenuation(), light_spread_clamp_area_light(), lights_intersect(), line_plane_factor_v3(), line_point_factor_v2_ex(), line_point_factor_v3_ex(), ShaderManager::linear_rgb_to_gray(), linear_rgb_to_gray(), make_transform_frame(), Matrix_imatmul(), Matrix_matmul(), mean_value_half_tan_v2_db(), mean_value_half_tan_v3(), mf_eval_phase_glass(), mf_glass_pdf(), mf_lambda(), mf_sample_phase_glass(), mf_sample_phase_glossy(), mirrorball_to_direction(), operator*(), pdf_uniform_cone(), pointOutsideOfPlane(), portalCanEncapsuleOrigin(), portalEncapsulesOrigin(), SupportVertexCallback::processTriangle(), project(), project(), quat_interpolate(), ray_aligned_disk_intersect(), ray_disk_intersect(), ray_point_factor_v3_ex(), ray_quad_intersect(), ray_sphere_intersect(), ray_triangle_intersect(), rec709_to_rgb(), ShaderManager::rec709_to_scene_linear(), rect_light_sample(), reflect(), refract(), rotate_direction_around_axis(), rotate_direction_around_axis(), blender::ed::sculpt_paint::AddOperationExecutor::sample_spherical(), blender::bke::mesh_surface_sample::sample_surface_points_projected(), SEQ_sequence_base_unique_name_recursive(), setupFrictionConstraint(), setupMultiBodyContactConstraint(), shader_bsdf_is_transmission(), shader_setup_from_ray(), shader_setup_from_sample(), shadow_ray_offset(), shadow_ray_smooth_surface_offset(), btConvexHullInternal::shrink(), single_scattering(), solveConstraintObsolete(), btTranslationalLimitMotor::solveLinearAxis(), spot_light_attenuation(), subsurface_disk(), subsurface_random_walk(), surface_intersection(), svm_node_closure_bsdf(), svm_node_fresnel(), svm_node_layer_weight(), svm_node_normal(), svm_node_set_bump(), svm_node_tex_coord(), svm_node_tex_coord_bump_dx(), svm_node_tex_coord_bump_dy(), svm_vector_math(), btModifiedGramSchmidt< TV >::test(), timesTranspose(), transform_compose(), transform_decompose(), transform_direction_transposed(), transform_inverse_dot(), transform_motion_decompose(), transform_negative_scale(), transform_perspective(), triangle_light_pdf(), triangle_light_pdf_area(), triangle_light_sample(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl(), volume_henyey_greenstein_eval_phase(), blender::noise::voronoi_distance_to_edge(), voronoi_distance_to_edge_2d(), voronoi_distance_to_edge_3d(), voronoi_distance_to_edge_4d(), wireframe(), Camera::world_to_raster_size(), and xyz_to_rgb().
|
inline |
Definition at line 404 of file BLI_math_vector.hh.
|
inline |
Definition at line 85 of file BLI_math_base.hh.
References Freestyle::a.
Referenced by applyLength(), bicubic_interpolation(), bilinear_interpolation(), bilinear_interpolation_color_wrap(), BKE_gpencil_stroke_stretch(), BKE_lattice_deform_data_eval_co(), BKE_ptcache_read(), BLI_cellNoiseU(), BLI_noise_cell_v3(), BLI_noise_voronoi(), boxsampleclip(), blender::nodes::node_shader_map_range_cc::build_vector_stepped(), colorfn(), Freestyle::GaussianFilter::computeMaskSize(), Freestyle::Grid::configure(), cp_key(), deformStroke(), blender::compositor::RotateOperation::determine_depending_area_of_interest(), displayed_channel_range_get(), do_2d_mapping(), blender::bke::pbvh::pixels::do_encode_pixels(), do_key(), dof_dilate_tiles_pass_draw(), draw_seq_fcurve_overlay(), blender::compositor::BilateralBlurOperation::execute_pixel(), blender::compositor::MathFloorOperation::execute_pixel_sampled(), blender::compositor::MathFractOperation::execute_pixel_sampled(), blender::compositor::MathTruncOperation::execute_pixel_sampled(), blender::compositor::PosterizeOperation::execute_pixel_sampled(), blender::compositor::PreviewOperation::execute_region(), fcm_cycles_time(), blender::nodes::node_fn_random_value_cc::fn_node_random_value_build_multi_function(), fract(), fract(), fractal_noise(), blender::compositor::RotateOperation::get_area_rotation_bounds(), BCMatrix::get_matrix(), blender::nodes::node_fn_float_to_int_cc::get_multi_function(), gpencil_frame_snap_nearest(), gridRaycast(), hsv_to_rgb(), imagewrap(), imagewraposa(), init_mv_jit(), Freestyle::Grid::initInfiniteRay(), Freestyle::Grid::initRay(), integer_digits_d(), integer_digits_f(), BezierSpline::interpolation_data_from_index_factor(), Spline::lookup_data_from_index_factor(), blender::imbuf::transform::WrapRepeatUV::modify_u(), blender::imbuf::transform::WrapRepeatUV::modify_v(), nearest_interpolation_color_wrap(), newPerlin(), old_mdisps_bilinear(), KDL::Jacobian::operator()(), orgBlenderNoise(), outliner_back(), blender::noise::perlin_fractal_template(), blender::gpu::FrameBuffer::recursive_downsample(), libmv::RegionIsInBounds(), Freestyle::Stroke::Resample(), sample_fcurve(), setServoTarget(), Freestyle::StrokeShaders::BezierCurveShader::shade(), snap(), snap_mask_layer_nearest(), snapFrameTransform(), soft_range_round_down(), speed_effect_interpolation_ratio_get(), surfaceGenerateGrid(), svm_vector_math(), table_sample(), textview_draw_string(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl3(), blender::nodes::try_dispatch_float_math_fl3_to_fl3(), ui_but_hide_fraction(), ui_but_string_set(), ui_draw_aligned_panel(), UI_fontstyle_draw_ex(), UI_GetColorPtrBlendShade3ubv(), uilist_prepare(), unit_dual_convert(), iTaSC::Scene::update(), blender::compositor::MathFloorOperation::update_memory_buffer_partial(), blender::compositor::MathFractOperation::update_memory_buffer_partial(), blender::compositor::MathTruncOperation::update_memory_buffer_partial(), blender::compositor::BilateralBlurOperation::update_memory_buffer_partial(), blender::compositor::PosterizeOperation::update_memory_buffer_partial(), valuefn(), blender::noise::voronoi_distance_to_edge(), voronoi_distance_to_edge_2d(), voronoi_distance_to_edge_3d(), voronoi_distance_to_edge_4d(), blender::noise::voronoi_f1(), voronoi_f1_2d(), voronoi_f1_3d(), voronoi_f1_4d(), blender::noise::voronoi_f2(), voronoi_f2_2d(), voronoi_f2_3d(), voronoi_f2_4d(), blender::noise::voronoi_n_sphere_radius(), voronoi_n_sphere_radius_2d(), voronoi_n_sphere_radius_3d(), voronoi_n_sphere_radius_4d(), blender::noise::voronoi_smooth_f1(), voronoi_smooth_f1_2d(), voronoi_smooth_f1_3d(), voronoi_smooth_f1_4d(), WM_gesture_circle_modal(), wrap(), writeGrainSizes(), blender::compositor::zbuf_add_to_span(), zbuf_add_to_span(), blender::compositor::zbuf_fill_in_rgba(), and zspan_scanconvert().
|
inline |
Definition at line 221 of file BLI_math_vector.hh.
References Freestyle::a, and result.
Referenced by fract().
|
inline |
Definition at line 100 of file BLI_math_base.hh.
References Freestyle::a, and floor().
|
inline |
Definition at line 241 of file BLI_math_vector.hh.
References Freestyle::a, floor(), and result.
|
inline |
Definition at line 19 of file BLI_math_color.hh.
References Freestyle::a, usdtokens::b(), interpolate(), and t.
|
inline |
Definition at line 30 of file BLI_math_color.hh.
References Freestyle::a, usdtokens::b(), interpolate(), and t.
|
inline |
Definition at line 109 of file BLI_math_base.hh.
References Freestyle::a, usdtokens::b(), result, and t.
Referenced by blender::bke::curves::bezier::calculate_vector_handle(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), blender::geometry::create_nurbs_to_bezier_positions(), blender::nodes::node_geo_curve_primitive_circle_cc::create_point_circle_curve(), blender::nodes::node_geo_curve_primitive_quadratic_bezier_cc::create_quadratic_bezier_curve(), blender::geometry::initialize_straight_curve_positions(), blender::bke::curves::bezier::insert(), interpolate(), blender::bke::mesh_normals_varray(), blender::attribute_math::mix2(), blender::tests::TEST(), and blender::noise::voronoi_smooth_f1().
|
inline |
Definition at line 390 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and t.
Definition at line 27 of file BLI_math_base.hh.
References Freestyle::a, and is_zero().
|
inline |
Definition at line 42 of file BLI_math_vector.hh.
References Freestyle::a, and T.
Definition at line 22 of file BLI_math_base.hh.
References Freestyle::a, and T.
Referenced by bsdf_eval_is_zero(), bsdf_microfacet_multi_ggx_fresnel_setup(), bsdf_microfacet_multi_ggx_setup(), blender::bke::curves::poly::calculate_next_normal(), calculate_next_normal(), blender::ed::sculpt_paint::min_distance_edit::calculate_points_per_side(), blender::bke::curves::poly::calculate_tangents(), camera_sample_panorama(), blender::nodes::node_geo_scale_elements_cc::create_single_axis_transform(), direction_bisect(), direction_to_equirectangular_range(), blender::bke::float2_to_bool(), blender::bke::float3_to_bool(), integrate_distant_lights(), integrate_light(), is_any_zero(), blender::ed::sculpt_paint::min_distance_edit::min_distance_edit_draw(), motion_triangle_smooth_normal(), project(), shader_bsdf_ao(), shader_bsdf_average_normal(), svm_node_normal_map(), svm_node_set_bump(), transform_motion_decompose(), transform_orientations_create_from_axis(), blender::nodes::translate_mesh(), triangle_smooth_normal(), and triangle_smooth_normal_unnormalized().
Definition at line 32 of file BLI_math_vector.hh.
References Freestyle::a, and T.
isect_result<double2> blender::math::isect_seg_seg | ( | const double2 & | v1, |
const double2 & | v2, | ||
const double2 & | v3, | ||
const double2 & | v4 | ||
) |
Definition at line 46 of file math_vec.cc.
References blender::math::isect_result< T >::kind, blender::math::isect_result< T >::lambda, v1, and v2.
isect_result<float2> blender::math::isect_seg_seg | ( | const float2 & | v1, |
const float2 & | v2, | ||
const float2 & | v3, | ||
const float2 & | v4 | ||
) |
Definition at line 16 of file math_vec.cc.
References blender::math::isect_result< T >::kind, blender::math::isect_result< T >::lambda, v1, and v2.
isect_result<vec_base<T, Size> > blender::math::isect_seg_seg | ( | const vec_base< T, Size > & | v1, |
const vec_base< T, Size > & | v2, | ||
const vec_base< T, Size > & | v3, | ||
const vec_base< T, Size > & | v4 | ||
) |
Referenced by fill_crossdata_for_intersect().
|
inline |
Definition at line 276 of file BLI_math_vector.hh.
References Freestyle::a, length_squared(), and sqrt().
Referenced by blender::length_parameterize::accumulate_lengths(), accumulate_lengths(), blender::nodes::node_geo_curve_spline_parameter_cc::accumulated_lengths_curve_domain(), blender::geometry::add_curves_on_mesh(), iTaSC::Cache::addCacheItem(), iTaSC::Cache::addCacheVectorIfDifferent(), blender::gpu::MTLBufferPool::allocate_aligned_with_data(), annotation_stroke_arrow_calc_points_segment(), btSoftBody::appendLink(), apply_lengths_iter(), arrayModifier_doArray(), base_callback(), bevel_build_cutoff(), BKE_icon_geom_invert_lightness(), BKE_id_attributes_length(), BKE_nurb_calc_length(), BKE_pchan_bbone_handles_compute(), BKE_pchan_bbone_spline_compute(), BLI_edgehash_popkey(), BLI_mmap_open(), BLI_mmap_read(), BLI_str_utf8_invalid_byte(), BLI_str_utf8_invalid_strip(), blo_do_versions_pre250(), bm_edge_info_average_length_with_fallback(), BM_vert_calc_median_tagged_edge_length(), bmo_inset_region_exec(), boid_body(), bone_align_to_bone(), BPy_IDArray_getbuffer(), bpy_prop_string_get_fn(), bpy_prop_string_length_fn(), brush_puff(), btAdjustInternalEdgeContacts(), btComputeGjkEpaPenetration(), btContinuousConvexCollision::calcTimeOfImpact(), blender::bke::curves::bezier::calculate_aligned_handle(), blender::bke::curves::bezier::calculate_point_handles(), calculate_point_length(), blender::ed::sculpt_paint::min_distance_edit::calculate_points_per_side(), blender::nodes::node_shader_tex_gradient_cc::GradientFunction::call(), compile_fallback_shader(), compile_shader_program(), BVHUnaligned::compute_aligned_space(), blender::ed::sculpt_paint::ScaleCurvesEffect::compute_poly_curve_length(), IK_QPositionTask::ComputeJacobian(), convert_tree(), blender::nodes::node_geo_curve_primitive_line_cc::create_direction_line_curve(), blender::nodes::node_geo_curve_sample_cc::curve_accumulated_lengths(), debugDrawConstraint(), btSoftBody::defaultCollisionHandler(), dfdx_spring(), distance(), distribute_simple_children(), do_kink(), do_path_effectors(), draw_axes(), draw_bone_update_disp_matrix_bbone(), drawArrow(), drw_shgroup_uniform(), drw_shgroup_uniform_create_ex(), ED_armature_ebone_add_primitive(), ED_buttons_tabs_list(), ED_gpencil_trace_data_to_strokes(), ED_node_tree_path_length(), ED_select_similar_compare_float_tree(), edge_wind_vertex(), BezierSpline::ensure_auto_handles(), execute_posetree(), execute_scene(), export_hair_curves(), extrapolate_points_by_length(), fb(), fbderiv(), fbstar(), fbstar_jacobi(), iTaSC::Armature::finalize(), flip_names(), blender::gpu::MTLBufferRange::flush(), blender::gpu::MTLBuffer::flush_range(), blender::ed::sculpt_paint::CurvesEffectOperationExecutor::gather_influences_spherical(), get_limit_motor_info2(), blender::nodes::node_fn_compare_cc::get_multi_function(), get_vertex_count(), getAngularMotionDisc(), getBoundingSphere(), btGjkPairDetector::getClosestPointsNonVirtual(), Freestyle::ViewEdge::getLength2D(), blender::gpu::GLDrawList::GLDrawList(), gpencil_modify_stroke(), gpencil_stroke_editcurve_generate_edgecases(), gpencil_stroke_sample_exec(), GPU_indexbuf_create_subrange(), GPU_indexbuf_create_subrange_in_place(), hair_create_input_mesh(), handle_app1(), GHOST_SystemCocoa::handleKeyEvent(), IK_SetTransform(), blender::gpu::IndexBuf::init_subrange(), initialize2(), InputCustomRatioFlip(), Interface1D_length_2d_get(), blender::geometry::interpolate_position_without_interpolation(), iterate_lengths_iter(), lineart_sort_adjacent_items(), BlenderSmokeLoader::load_pixels(), BlenderPointDensityLoader::load_pixels(), nlaevalchan_blend_value(), nlaevalchan_blend_value_get_inverted_lower_evalchan(), nlaevalchan_blend_value_get_inverted_upper_evalchan(), nlaevalchan_combine_value(), nlaevalchan_combine_value_get_inverted_lower_evalchan(), nlaevalchan_combine_value_get_inverted_upper_evalchan(), nlaevalchan_detect_mix_mode(), nlaevalchan_get_default_values(), nlaevalchan_snapshot_new(), nlaevalchan_verify_key(), nlastrip_get_frame_transition(), blender::nodes::node_geo_curve_length_cc::node_geo_exec(), blender::nodes::node_geo_curve_resample_cc::node_geo_exec(), blender::nodes::node_geo_mesh_primitive_line_cc::node_geo_exec(), blender::nodes::node_geo_curve_sample_cc::node_update(), Normalize(), osx_user_locale(), paint_line_strokes_spacing(), paint_space_stroke(), paint_space_stroke_spacing_variable(), plane_to_point_vector_v3_normalized(), btSoftColliders::CollideVF_SS::Process(), btConnectivityProcessor::processTriangle(), gjkepa2_impl::GJK::projectorigin(), GJK< btConvexTemplate >::projectorigin(), prop_subscript_ass_array_slice(), prop_subscript_ass_array_slice__as_seq_fast(), prop_subscript_ass_array_slice__bool_recursive(), prop_subscript_ass_array_slice__float_recursive(), prop_subscript_ass_array_slice__int_recursive(), psys_get_particle_on_path(), psys_hair_use_simulation(), PyC_AsArray(), PyC_AsArray_FAST(), PyC_AsArray_Multi_FAST_impl(), pygpu_shader_uniform_bool(), pygpu_shader_uniform_float(), pygpu_shader_uniform_int(), pygpu_shader_uniform_vector_float(), pygpu_shader_uniform_vector_int(), pyrna_prop_array_subscript_slice(), Quaternion_rotate(), ReadData(), btSoftBody::resetLinkRestLengths(), rna_array_lookup_int(), RNA_def_float_matrix(), RNA_def_property_array(), RNA_def_property_collection_funcs(), RNA_def_property_multi_array(), RNA_def_property_string_funcs(), rna_ensure_property_multi_array_length(), rna_iterator_array_begin(), RNA_parameter_dynamic_length_set(), RNA_parameter_dynamic_length_set_data(), RNA_property_array_dimension(), RNA_property_as_string(), rna_property_boolean_get_default_array_values(), RNA_property_collection_length(), RNA_property_float_get_default_array(), rna_property_float_get_default_array_values(), RNA_property_int_get_default_array(), rna_property_int_get_default_array_values(), RNA_property_string_get_alloc(), RNA_property_string_get_default_alloc(), scale_point_to_length(), scale_points_to_length(), set_device_override_func(), setting_get_rna_values(), IK_QSegment::SetTransform(), btGjkEpaSolver2::SignedDistance(), SIM_mass_spring_force_edge_wind(), SIM_mass_spring_force_spring_bending(), SIM_mass_spring_force_spring_goal(), SIM_mass_spring_force_spring_linear(), similar_edge_select_exec(), spring_grad_dir(), spring_length(), blender::io::gpencil::GpencilIO::stroke_point_radius_get(), blender::gpu::supports_barycentric_whitelist(), time_human_readable_to_seconds(), CurveEval::total_length(), blender::nodes::try_dispatch_float_math_fl3_to_fl(), txt_extended_ascii_as_utf8(), txt_sel_to_buf(), ui_but_get_pasted_text_from_clipboard(), unit_as_string_main(), blender::gpu::MTLTexture::update_sub(), and WriteData().
|
inline |
Definition at line 260 of file BLI_math_vector.hh.
References Freestyle::a, abs(), result, and T.
Referenced by distance_manhattan().
|
inline |
Definition at line 270 of file BLI_math_vector.hh.
References Freestyle::a, and dot().
Referenced by distance_squared(), length(), normalize_and_get_length(), and blender::nodes::use_translate().
Definition at line 42 of file BLI_math_base.hh.
References Freestyle::a, and usdtokens::b().
Referenced by BKE_editmesh_cache_calc_minmax(), BKE_pointcloud_minmax(), blender::bke::CurvesGeometry::bounds_min_max(), clamp(), max_inplace(), min_max(), and blender::geometry::ReverseUVSampler::ReverseUVSampler().
|
inline |
Definition at line 86 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and result.
Definition at line 47 of file BLI_math_base.hh.
References Freestyle::a, usdtokens::b(), and max().
Referenced by UniqueName_Value::mark_used(), blender::io::obj::Geometry::track_vertex_index(), UniqueName_Value::use_if_unused(), and UniqueName_Value::use_smallest_unused().
Definition at line 118 of file BLI_math_base.hh.
References Freestyle::a, usdtokens::b(), result, and T.
Referenced by blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), generate_bounding_box_mesh(), gpencil_add_arc_points(), gpencil_primitive_arc(), gpencil_primitive_rotate_line(), object_origin_set_exec(), solve_least_squares(), and blender::tests::TEST().
|
inline |
Definition at line 398 of file BLI_math_vector.hh.
References Freestyle::a, and usdtokens::b().
Definition at line 37 of file BLI_math_base.hh.
References Freestyle::a, and usdtokens::b().
Referenced by BKE_editmesh_cache_calc_minmax(), BKE_pointcloud_minmax(), blender::bke::CurvesGeometry::bounds_min_max(), clamp(), min_inplace(), min_max(), blender::geometry::ReverseUVSampler::ReverseUVSampler(), and blender::tests::TEST().
|
inline |
Definition at line 76 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and result.
Definition at line 52 of file BLI_math_base.hh.
References Freestyle::a, usdtokens::b(), and min().
Referenced by blender::io::obj::Geometry::track_vertex_index().
Definition at line 73 of file BLI_math_base.hh.
|
inline |
Definition at line 196 of file BLI_math_vector.hh.
|
inline |
Definition at line 62 of file BLI_math_base.hh.
References Freestyle::a, and usdtokens::b().
|
inline |
Definition at line 129 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), BLI_assert, and result.
|
inline |
Definition at line 118 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), BLI_assert, and result.
|
inline |
Definition at line 345 of file BLI_math_vector.hh.
References len, normalize_and_get_length(), T, and v.
Referenced by __anyhit__kernel_optix_local_hit(), Mesh::add_face_normals(), add_node(), Mesh::add_vertex_normals(), Mesh::apply_transform(), attr_create_pointiness(), bake_offset_towards_center(), blender_camera_focal_distance(), bsdf_ashikhmin_shirley_eval_reflect(), bsdf_ashikhmin_velvet_eval_reflect(), bsdf_ashikhmin_velvet_sample(), bsdf_hair_reflection_eval_reflect(), bsdf_hair_reflection_sample(), bsdf_hair_transmission_eval_transmit(), bsdf_hair_transmission_sample(), bsdf_microfacet_beckmann_eval_reflect(), bsdf_microfacet_beckmann_eval_transmit(), bsdf_microfacet_ggx_eval_reflect(), bsdf_microfacet_ggx_eval_transmit(), bsdf_principled_sheen_eval_reflect(), bsdf_principled_sheen_sample(), blender::bke::curves::bezier::calculate_aligned_handle(), blender::geometry::calculate_directions(), blender::bke::curves::poly::calculate_next_normal(), calculate_next_normal(), blender::bke::curves::poly::calculate_normals_minimum(), calculate_normals_minimum(), blender::bke::curves::poly::calculate_normals_z_up(), calculate_normals_z_up(), blender::ed::sculpt_paint::min_distance_edit::calculate_points_per_side(), blender::bke::curves::poly::calculate_tangents(), calculate_tangents(), blender::nodes::node_geo_curve_sample_cc::SampleCurveFunction::call(), camera_direction_from_point(), camera_sample_orthographic(), camera_sample_panorama(), camera_sample_perspective(), camera_world_to_ndc(), blender::nodes::node_geo_curve_primitive_arc_cc::colinear_f3_f3_f3(), blender::nodes::node_geo_curve_primitive_circle_cc::colinear_f3_f3_f3(), blender::geometry::compute_surface_point_normal(), blender::nodes::node_geo_curve_primitive_arc_cc::create_arc_curve_from_points(), blender::nodes::node_geo_curve_primitive_line_cc::create_direction_line_curve(), blender::nodes::node_geo_curve_primitive_circle_cc::create_point_circle_curve(), blender::nodes::node_geo_scale_elements_cc::create_single_axis_transform(), direction_bisect(), blender::bke::curves::poly::direction_bisect(), GeometryManager::displace(), distant_light_sample(), ensure_valid_reflection(), LinearQuadPatch::eval(), BicubicPatch::eval(), blender::ed::sculpt_paint::SlideOperationExecutor::find_curves_to_slide(), get_dupliface_transform_from_coords(), blender::nodes::node_geo_input_mesh_edge_angle_cc::SignedAngleFieldInput::get_varray_for_context(), integrate_surface_bsdf_bssrdf_bounce(), integrator_init_from_bake(), blender::geometry::interpolate_position_with_interpolation(), blender::geometry::interpolate_position_without_interpolation(), kernel_embree_filter_occluded_func(), light_sample(), light_sample_from_intersection(), lights_intersect(), make_orthonormals(), make_orthonormals_tangent(), make_transform_frame(), blender::bke::mesh_normals_varray(), mf_eval(), mf_eval_phase_glass(), mf_eval_phase_glossy(), mf_ggx_aniso_pdf(), mf_ggx_pdf(), mf_sample_phase_glass(), mf_sample_vndf(), microfacet_sample_stretched(), blender::ed::sculpt_paint::min_distance_edit::min_distance_edit_draw(), blender::ed::sculpt_paint::min_distance_edit::min_distance_edit_invoke(), motion_triangle_shader_setup(), blender::nodes::node_geo_mesh_primitive_line_cc::node_geo_exec(), object_inverse_normal_transform(), object_normal_transform(), object_volume_density(), orthogonalize_m3_stable(), orthogonalize_m4_stable(), orthogonalize_stable(), primitive_motion_vector(), blender::ed::curves::primitive_random_sphere(), primitive_tangent(), quat_interpolate(), blender::nodes::node_geo_raycast_cc::raycast_to_mesh(), blender::ed::sculpt_paint::sample_curves_3d_brush(), blender::ed::sculpt_paint::sample_curves_surface_3d_brush(), blender::ed::sculpt_paint::AddOperationExecutor::sample_in_center(), blender::ed::sculpt_paint::AddOperationExecutor::sample_spherical_with_symmetry(), blender::bke::mesh_surface_sample::sample_surface_points_projected(), blender::bke::mesh_surface_sample::sample_surface_points_spherical(), set_handle_position(), shader_bsdf_ao(), shader_bsdf_average_normal(), sphere_light_sample(), spherical_stereo_transform(), subsurface_disk(), svm_node_camera(), svm_node_closure_bsdf(), svm_node_ies(), svm_node_normal(), svm_node_set_bump(), svm_node_tangent(), svm_node_vector_displacement(), svm_node_vector_transform(), svm_vector_math(), HdCyclesLight::Sync(), blender::bke::tests::test_vec_roll_to_mat3_normalized(), transform_clear_scale(), transform_rotate(), triangle_normal(), triangle_point_normal(), blender::nodes::try_dispatch_float_math_fl3_fl3_fl_to_fl3(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl3(), blender::nodes::try_dispatch_float_math_fl3_to_fl3(), blender::noise::voronoi_distance_to_edge(), voronoi_distance_to_edge_2d(), voronoi_distance_to_edge_3d(), voronoi_distance_to_edge_4d(), and Camera::world_to_raster_size().
|
inline |
Definition at line 330 of file BLI_math_vector.hh.
References length_squared(), sqrt(), T, threshold, and v.
Referenced by normalize().
|
inline |
Definition at line 321 of file BLI_math_vector.hh.
References dot(), is_zero(), and UNLIKELY.
Referenced by svm_vector_math(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl3(), and btWheelInfo::updateWheel().
|
inline |
Definition at line 300 of file BLI_math_vector.hh.
References BLI_ASSERT_UNIT, dot(), and normal.
|
inline |
Definition at line 308 of file BLI_math_vector.hh.
float3 blender::math::rotate_around_axis | ( | const float3 & | vector, |
const float3 & | center, | ||
const float3 & | axis, | ||
float | angle | ||
) |
Rotate any arbitrary vector around the center position, with a unit-length axis and the specified angle.
Definition at line 26 of file math_rotation.cc.
References angle(), axis_angle_normalized_to_mat3(), center, mul_m3_v3(), and result.
float3 blender::math::rotate_direction_around_axis | ( | const float3 & | direction, |
const float3 & | axis, | ||
float | angle | ||
) |
Rotate the unit-length direction around the unit-length axis by the angle.
Definition at line 14 of file math_rotation.cc.
References angle(), BLI_ASSERT_UNIT_V3, KDL::cos(), cross(), KDL::diff(), dot(), and KDL::sin().
Referenced by blender::bke::curves::poly::calculate_next_normal(), calculate_next_normal(), blender::bke::curves::poly::calculate_normals_minimum(), calculate_normals_minimum(), blender::bke::rotate_directions_around_axes(), and blender::math::tests::TEST().
|
inline |
Definition at line 80 of file BLI_math_base.hh.
References Freestyle::a, usdtokens::b(), and T.
Referenced by bsdf_eval_pass_diffuse_weight(), bsdf_eval_pass_glossy_weight(), blender::nodes::node_shader_map_range_cc::build_float_linear(), blender::nodes::node_shader_map_range_cc::build_float_stepped(), blender::nodes::node_shader_map_range_cc::build_vector_linear(), blender::nodes::node_shader_map_range_cc::build_vector_stepped(), bump_shadowing_term(), blender::nodes::node_shader_tex_voronoi_cc::VoronoiMinowskiFunction::call(), blender::nodes::node_shader_tex_voronoi_cc::VoronoiMetricFunction::call(), DRW_shgroup_curves_create_sub(), hair_attenuation(), kernel_accum_light(), blender::ed::sculpt_paint::move_last_point_and_resample(), blender::length_parameterize::sample_at_length(), blender::nodes::node_shader_map_range_cc::sh_node_map_range_build_multi_function(), smootherstep(), svm_mapping(), svm_math(), svm_node_tex_voronoi(), svm_node_vector_map_range(), svm_vector_math(), transform_decompose(), trimmed_logistic(), blender::nodes::try_dispatch_float_math_fl3_fl3_to_fl3(), blender::nodes::try_dispatch_float_math_fl_fl_to_fl(), and vfont_to_curve().
|
inline |
Definition at line 215 of file BLI_math_vector.hh.
References Freestyle::a, and usdtokens::b().
|
inline |
Definition at line 205 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and result.
|
inline |
Definition at line 68 of file BLI_math_base.hh.
References Freestyle::a, and usdtokens::b().
|
inline |
Definition at line 150 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and result.
|
inline |
Definition at line 140 of file BLI_math_vector.hh.
References Freestyle::a, usdtokens::b(), and result.
Definition at line 45 of file BLI_math_vec_types.hh.
References BLI_STATIC_ASSERT, and result.
|
inlineconstexpr |
Definition at line 19 of file BLI_math_base.hh.
|
inlineconstexpr |
Definition at line 20 of file BLI_math_base.hh.