The Vector Base class. More...
#include <Vector3D.h>
Public Types | |
typedef _Precision | num_type |
typedef float_traits< num_type > | traits_type |
Public Member Functions | |
Operator | |
_Precision & | operator[] (unsigned short usIndex) |
Returns a reference to a coordinate. usIndex must be in the range [0,2]. More... | |
const _Precision & | operator[] (unsigned short usIndex) const |
Returns a const reference to a coordinate. usIndex must be in the range [0,2]. More... | |
Vector3 | operator+ (const Vector3< _Precision > &rcVct) const |
Vector addition. More... | |
Vector3 | operator& (const Vector3< _Precision > &rcVct) const |
Vector3 | operator- (const Vector3< _Precision > &rcVct) const |
Vector subtraction. More... | |
Vector3 | operator- () const |
Negative vector. More... | |
Vector3 & | operator+= (const Vector3< _Precision > &rcVct) |
Vector summation. More... | |
Vector3 & | operator-= (const Vector3< _Precision > &rcVct) |
Vector subtraction. More... | |
Vector3 | operator* (_Precision fScale) const |
Vector scaling. More... | |
Vector3 | operator/ (_Precision fDiv) const |
Vector3 & | operator*= (_Precision fScale) |
Vector3 & | operator/= (_Precision fDiv) |
Vector3 & | operator= (const Vector3< _Precision > &v)=default |
Assignment. More... | |
Vector3 & | operator= (Vector3< _Precision > &&v)=default |
_Precision | operator* (const Vector3< _Precision > &rcVct) const |
Scalar product. More... | |
_Precision | Dot (const Vector3< _Precision > &rcVct) const |
Scalar product. More... | |
Vector3 | operator% (const Vector3< _Precision > &rcVct) const |
Cross product. More... | |
Vector3 | Cross (const Vector3< _Precision > &rcVct) const |
Cross product. More... | |
bool | operator!= (const Vector3< _Precision > &rcVct) const |
Comparing for inequality. More... | |
bool | operator== (const Vector3< _Precision > &rcVct) const |
Comparing for equality. More... | |
bool | IsOnLineSegment (const Vector3< _Precision > &startVct, const Vector3< _Precision > &endVct) const |
Check if Vector is on a line segment. More... | |
Modification | |
void | ScaleX (_Precision f) |
void | ScaleY (_Precision f) |
void | ScaleZ (_Precision f) |
void | Scale (_Precision fX, _Precision fY, _Precision fZ) |
void | MoveX (_Precision f) |
void | MoveY (_Precision f) |
void | MoveZ (_Precision f) |
void | Move (_Precision fX, _Precision fY, _Precision fZ) |
void | RotateX (_Precision f) |
void | RotateY (_Precision f) |
void | RotateZ (_Precision f) |
void | Set (_Precision fX, _Precision fY, _Precision fZ) |
Mathematics | |
_Precision | Length () const |
Length of the vector. More... | |
_Precision | Sqr () const |
Squared length of the vector. More... | |
Vector3 & | Normalize () |
Set length to 1. More... | |
bool | IsNull () const |
Checks whether this is the null vector. More... | |
_Precision | GetAngle (const Vector3 &rcVect) const |
Get angle between both vectors. The returned value lies in the interval [0,pi]. More... | |
void | TransformToCoordinateSystem (const Vector3 &rclBase, const Vector3 &rclDirX, const Vector3 &rclDirY) |
Transforms this point to the coordinate system defined by origin rclBase, vector vector rclDirX and vector vector rclDirY. More... | |
bool | IsEqual (const Vector3 &rclPnt, _Precision tol) const |
IsEqual. More... | |
Vector3 & | ProjectToPlane (const Vector3 &rclBase, const Vector3 &rclNorm) |
Projects this point onto the plane given by the base rclBase and the normal rclNorm. More... | |
void | ProjectToPlane (const Vector3 &rclBase, const Vector3 &rclNorm, Vector3 &rclProj) const |
Projects this point onto the plane given by the base rclBase and the normal rclNorm and stores the result in rclProj. More... | |
Vector3 & | ProjectToLine (const Vector3 &rclPoint, const Vector3 &rclLine) |
Projects this point onto the line given by the base rclPoint and the direction rclLine. More... | |
Vector3 | Perpendicular (const Vector3 &rclBase, const Vector3 &rclDir) const |
Get the perpendicular of this point to the line defined by rclBase and rclDir. More... | |
_Precision | DistanceToPlane (const Vector3 &rclBase, const Vector3 &rclNorm) const |
Computes the distance to the given plane. More... | |
_Precision | DistanceToLine (const Vector3 &rclBase, const Vector3 &rclDirect) const |
Computes the distance from this point to the line given by rclBase and rclDirect. More... | |
Vector3 | DistanceToLineSegment (const Vector3 &rclP1, const Vector3 &rclP2) const |
Computes the vector from this point to the point on the line segment with the shortest distance. More... | |
Static Public Member Functions | |
static num_type | epsilon () |
Public data members | |
_Precision | x |
x-coordinate More... | |
_Precision | y |
y-coordinate More... | |
_Precision | z |
z-coordinate More... | |
Vector3 (_Precision fx=0.0, _Precision fy=0.0, _Precision fz=0.0) | |
Construction. More... | |
Vector3 (const Vector3< _Precision > &v)=default | |
Vector3 (Vector3< _Precision > &&v)=default | |
~Vector3 ()=default | |
The Vector Base class.
typedef _Precision Base::Vector3< _Precision >::num_type |
typedef float_traits<num_type> Base::Vector3< _Precision >::traits_type |
|
explicit |
Construction.
|
default |
|
default |
|
default |
Vector3< _Precision > Vector3::Cross | ( | const Vector3< _Precision > & | rcVct | ) | const |
Cross product.
Referenced by Gui::PropertyEditor::RotationHelper::assignProperty(), MeshCore::MeshGeomEdge::ClosestPointsToLine(), TechDraw::DrawViewDimension::execute(), Sketcher::SketchObject::fillet(), MeshPart::MeshProjection::findIntersection(), PartDesign::Helix::generateHelixPath(), TechDrawGui::DrawGuiUtil::get3DDirAndRot(), TechDrawGui::DrawGuiUtil::getProjDirFromFace(), TechDraw::DrawProjGroupItem::getRotateAngle(), TechDraw::getViewAxis(), MeshCore::MeshGeomEdge::IntersectWithEdge(), MeshCore::MeshGeomEdge::IntersectWithLine(), MeshCore::MeshGeomEdge::IsCollinear(), MeshCore::MeshGeomEdge::IsParallel(), Part::Geom2dConic::isReversed(), Part::Geom2dArcOfConic::isReversed(), TechDraw::legacyViewAxis1(), Base::Rotation::makeRotationByAxes(), PartDesign::Helix::safePitch(), and TechDraw::DrawViewSection::sectionLineEnds().
_Precision Vector3::DistanceToLine | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclDirect | ||
) | const |
Computes the distance from this point to the line given by rclBase and rclDirect.
References Base::Vector3< _Precision >::Length().
Referenced by MeshCoreFit::CylinderFit::ComputeApproximationsLine(), MeshCore::CylinderFit::GetDistanceToCylinder(), MeshCoreFit::CylinderFit::GetDistanceToCylinder(), MeshCore::CylinderSurfaceFit::GetDistanceToSurface(), MeshCore::MeshGeomFacet::IsPointOf(), MeshCore::CylinderFit::ProjectToCylinder(), MeshCoreFit::CylinderFit::ProjectToCylinder(), and MeshCoreFit::CylinderFit::SetApproximations().
Vector3< _Precision > Vector3::DistanceToLineSegment | ( | const Vector3< _Precision > & | rclP1, |
const Vector3< _Precision > & | rclP2 | ||
) | const |
Computes the vector from this point to the point on the line segment with the shortest distance.
The line segment is defined by rclP1 and rclP2. Note: If the projection of this point is outside the segment then the shortest distance to rclP1 or rclP2 is computed.
References DraftVecUtils::dist(), and Base::DistanceP2().
Referenced by CDxfWrite::writeLinearDimBlock().
_Precision Vector3::DistanceToPlane | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclNorm | ||
) | const |
Computes the distance to the given plane.
Depending on the side this point is located the distance can also be negative. The distance is positive if the point is at the same side the plane normal points to, negative otherwise.
References Base::Vector3< _Precision >::Length().
Referenced by MeshCore::MeshProjection::bboxInsideRectangle(), MeshCore::MeshGeomFacet::DistancePlaneToPoint(), Mesh::SegmentByMesh::execute(), MeshCore::PlaneSurfaceFit::GetDistanceToSurface(), MeshCore::MeshAlgorithm::GetFacetsFromPlane(), and MeshCore::MeshGeomEdge::IntersectWithLine().
_Precision Vector3::Dot | ( | const Vector3< _Precision > & | rcVct | ) | const |
Scalar product.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by Gui::PropertyEditor::RotationHelper::assignProperty(), TechDraw::DrawViewDimension::execute(), Sketcher::SketchObject::fillet(), MeshPart::MeshProjection::findIntersection(), MeshCore::MeshFixCaps::Fixup(), TechDraw::DrawProjGroupItem::getViewAxis(), MeshCore::MeshGeomEdge::IntersectWithEdge(), MeshCore::MeshGeomEdge::IntersectWithPlane(), MeshCore::TriangulationVerifier::MustFlip(), MeshCore::TriangulationVerifierV2::MustFlip(), and MeshCore::CylinderSurfaceFit::TestTriangle().
|
static |
References draftutils.utils::epsilon().
_Precision Vector3::GetAngle | ( | const Vector3< _Precision > & | rcVect | ) | const |
Get angle between both vectors. The returned value lies in the interval [0,pi].
References draftutils.utils::epsilon(), and Base::Vector3< _Precision >::Length().
Referenced by Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleArrow(), TechDraw::DrawUtil::closestBasis(), MeshCore::MeshGeomEdge::ClosestPointsToLine(), MeshCore::MeshGeomFacet::Enlarge(), TechDrawGui::QGIViewDimension::findIsoDir(), PartDesignGui::fixSketchSupport(), MeshCore::MeshGeomFacet::Foraminate(), TechDraw::DrawViewDimension::getDimValue(), TechDraw::DrawProjGroupItem::getRotateAngle(), MeshCore::MeshGeomEdge::IntersectWithLine(), MeshCore::MeshGeomFacet::MaximumAngle(), MeshCore::MeshGeomFacet::MinimumAngle(), SketcherGui::DrawSketchHandlerFillet::releaseButton(), MeshCore::MeshTopoAlgorithm::ShouldSwapEdge(), MeshCore::MeshGeomFacet::SubSample(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), and CDxfWrite::writeLinearDimBlock().
bool Vector3::IsEqual | ( | const Vector3< _Precision > & | rclPnt, |
_Precision | tol | ||
) | const |
IsEqual.
rclPnt | |
tol |
References Base::Distance().
Referenced by TechDraw::BSpline::asCircle(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::DrawViewDimension::execute(), TechDrawGui::QGIViewDimension::findIsoExt(), TechDraw::getViewAxis(), TechDraw::legacyViewAxis1(), TechDrawGui::QGIFace::lineSetToFillItems(), and TechDraw::CenterLine::scaledGeometry().
bool Vector3::IsNull |
Checks whether this is the null vector.
Referenced by MeshCore::MeshGeomEdge::IntersectWithEdge(), MeshCore::MeshGeomEdge::IsCollinear(), and MeshCore::MeshGeomEdge::IsParallel().
bool Vector3::IsOnLineSegment | ( | const Vector3< _Precision > & | startVct, |
const Vector3< _Precision > & | endVct | ||
) | const |
Check if Vector is on a line segment.
_Precision Vector3::Length | ( | void | ) | const |
Length of the vector.
Referenced by CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainAngle::activated(), ArchStructure.CommandStructuralSystem::Activated(), Sketcher::SketchObject::addCopy(), CmdSketcherConstrainDistance::applyConstraint(), CmdSketcherConstrainAngle::applyConstraint(), TechDraw::CenterLine::calcEndPoints2Points(), TechDraw::DrawViewPart::checkXDirection(), Part::Extrusion::computeFinalParameters(), TechDraw::DrawViewDetail::detailExec(), Gui::LocationUi< Ui >::directionActivated(), Gui::LocationImpUi< Ui >::directionActivated(), Base::Vector3< _Precision >::DistanceToLine(), Base::Vector3< _Precision >::DistanceToPlane(), MeshCore::MeshEigensystem::Evaluate(), Mesh::SegmentByMesh::execute(), TechDraw::DrawViewDimension::execute(), Sketcher::SketchObject::extend(), Sketcher::SketchObject::fillet(), Base::Vector3< _Precision >::GetAngle(), MeshCore::QuadraticFit::GetCurvatureInfo(), MeshCore::SurfaceFit::GetCurvatureInfo(), TechDraw::DrawViewDimension::getDimValue(), MeshCore::SphereFit::GetDistanceToSphere(), MeshCoreFit::SphereFit::GetDistanceToSphere(), Reen::ParameterCorrection::GetGravityPoint(), ArchPanel.CommandPanel::getPoint(), Robot::Trajectory::getVelocity(), TechDraw::DrawViewPart::getXDirection(), TechDraw::DrawProjGroupItem::getXDirection(), TechDraw::DrawViewSection::getXDirection(), Base::BoundBox3< _Precision >::IsCutLine(), MeshCore::MeshAlgorithm::IsVertexVisible(), Base::Rotation::makeRotationByAxes(), Mesh::MeshObject::offsetSpecial2(), MeshPart::MeshAlgos::offsetSpecial2(), Fem::ConstraintFluidBoundary::onChanged(), Fem::ConstraintForce::onChanged(), Fem::ConstraintGear::onChanged(), TechDraw::DrawViewPart::onChanged(), SketcherGui::DrawSketchHandlerFillet::releaseButton(), PartDesign::Helix::safePitch(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Gui::LocationWidget::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), ArchPanel.CommandPanel::setLength(), Base::Rotation::setValue(), MeshCore::MeshTopoAlgorithm::SnapVertex(), MeshCore::MeshGeomFacet::SubSample(), ArchPanel.CommandPanel::update(), PartDesign::Groove::updateAxis(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), and FemGui::ViewProviderFemConstraintGear::updateData().
void Vector3::Move | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
void Vector3::MoveX | ( | _Precision | f | ) |
void Vector3::MoveY | ( | _Precision | f | ) |
void Vector3::MoveZ | ( | _Precision | f | ) |
Vector3< _Precision > & Vector3::Normalize |
Set length to 1.
Referenced by Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleArrow(), MeshCore::MeshTopoAlgorithm::AdjustEdgesToCurvatureDirection(), Sketcher::SketchAnalysis::analyseMissingPointOnPointCoincident(), MeshCore::MeshProjection::bboxInsideRectangle(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::CenterLine::calcEndPoints(), TechDraw::CenterLine::calcEndPoints2Lines(), TechDraw::CenterLine::calcEndPoints2Points(), TechDraw::CenterLine::calcEndPointsNoRef(), Gui::ManualAlignment::computeAlignment(), Fem::ConstraintGear::ConstraintGear(), TechDrawGui::QGIFace::dashedPPath(), TechDrawGui::QGIViewPart::drawSectionLine(), MeshCore::MeshGeomFacet::Enlarge(), Sketcher::SketchObject::extend(), MeshCoreFit::CylinderFit::findBestSolDirection(), Part::findFilletCenter(), MeshCore::MeshFixCaps::Fixup(), MeshCore::MeshFixDeformedFacets::Fixup(), MeshCore::MeshKernel::GetFacetNormals(), MeshCore::MeshAlgorithm::GetFacetsFromPlane(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), MeshCore::MeshKernel::GetNormal(), MeshCore::MeshRefPointToFacets::GetNormal(), MeshCore::MeshRefPointToPoints::GetNormal(), Mesh::MeshObject::getPointNormal(), Mesh::MeshObject::getPointNormals(), TechDraw::DrawProjGroupItem::getRotateAngle(), Base::Rotation::getValue(), TechDraw::getViewAxis(), MeshCore::MeshGeomFacet::IsDeformed(), TechDraw::legacyViewAxis1(), MeshPart::MeshAlgos::LoftOnCurve(), TechDrawGui::QGISectionLine::makeArrowsISO(), TechDrawGui::QGISectionLine::makeArrowsTrad(), TechDrawGui::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), MeshPart::CurveProjectorWithToolMesh::makeToolMesh(), Mesh::MeshObject::offsetSpecial(), MeshPart::MeshAlgos::offsetSpecial(), Mesh::MeshObject::offsetSpecial2(), MeshPart::MeshAlgos::offsetSpecial2(), SketcherGui::EditModeConstraintCoinManager::processConstraints(), MeshCore::MeshProjection::projectLineOnMesh(), Base::Matrix4D::rotLine(), TechDraw::DrawViewSection::sectionLineEnds(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), MeshCoreFit::CylinderFit::SetApproximations(), Base::CoordinateSystem::setAxes(), TechDrawGui::QGISectionLine::setDirection(), MeshCore::MeshGeomFacet::SetNormal(), Base::Rotation::setValue(), Base::CoordinateSystem::setXDirection(), Base::CoordinateSystem::setYDirection(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), MeshCore::MeshGeomFacet::SubSample(), Part::suggestFilletRadius(), Base::Matrix4D::toAxisAngle(), Base::Vector3< _Precision >::TransformToCoordinateSystem(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), SketcherGui::DrawSketchHandlerLineSet::updateTransitionData(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), CDxfWrite::writeLinearDimBlock(), and CDxfWrite::writeRadialDimBlock().
Comparing for inequality.
Vector3< _Precision > Vector3::operator% | ( | const Vector3< _Precision > & | rcVct | ) | const |
Cross product.
Vector3< _Precision > Vector3::operator* | ( | _Precision | fScale | ) | const |
Vector scaling.
_Precision Vector3::operator* | ( | const Vector3< _Precision > & | rcVct | ) | const |
Scalar product.
Vector3< _Precision > & Vector3::operator*= | ( | _Precision | fScale | ) |
Vector3< _Precision > Vector3::operator+ | ( | const Vector3< _Precision > & | rcVct | ) | const |
Vector addition.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator+= | ( | const Vector3< _Precision > & | rcVct | ) |
Vector summation.
Vector3< _Precision > Vector3::operator- | ( | void | ) | const |
Negative vector.
Vector3< _Precision > Vector3::operator- | ( | const Vector3< _Precision > & | rcVct | ) | const |
Vector subtraction.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator-= | ( | const Vector3< _Precision > & | rcVct | ) |
Vector subtraction.
Vector3< _Precision > Vector3::operator/ | ( | _Precision | fDiv | ) | const |
Vector3< _Precision > & Vector3::operator/= | ( | _Precision | fDiv | ) |
|
default |
Assignment.
|
default |
Comparing for equality.
_Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) |
Returns a reference to a coordinate. usIndex must be in the range [0,2].
const _Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) | const |
Returns a const reference to a coordinate. usIndex must be in the range [0,2].
Vector3< _Precision > Vector3::Perpendicular | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclDir | ||
) | const |
Get the perpendicular of this point to the line defined by rclBase and rclDir.
Note: Do not mix up this method with ProjectToLine.
Referenced by Sketcher::SketchObject::addSymmetric(), TechDraw::DrawViewDimension::execute(), MeshCore::MeshFixCaps::Fixup(), PartDesign::ProfileBased::getReversedAngle(), and Sketcher::SketchObject::split().
Vector3< _Precision > & Vector3::ProjectToLine | ( | const Vector3< _Precision > & | rclPoint, |
const Vector3< _Precision > & | rclLine | ||
) |
Projects this point onto the line given by the base rclPoint and the direction rclLine.
Projects a point rclPoint onto the line defined by the origin and the direction rclLine. The result is a vector from rclPoint to the point on the line. The length of this vector is the distance from rclPoint to the line. Note: The resulting vector does not depend on the current vector.
References Base::Vector3< _Precision >::Sqr().
Referenced by Part::createFilletGeometry(), MeshCore::MeshEigensystem::Evaluate(), Sketcher::SketchObject::fillet(), Part::findFilletCenter(), MeshCore::MeshProjection::isPointInsideDistance(), SketcherGui::EditModeConstraintCoinManager::processConstraints(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), and Part::suggestFilletRadius().
Vector3< _Precision > & Vector3::ProjectToPlane | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclNorm | ||
) |
Projects this point onto the plane given by the base rclBase and the normal rclNorm.
References Base::Vector3< _Precision >::Sqr().
Referenced by Base::BoundBox3< _Precision >::ClosestPoint(), Reen::ParameterCorrection::ProjectControlPointsOnPlane(), MeshCore::MeshGeomFacet::ProjectPointToPlane(), MeshCore::CylinderFit::ProjectToCylinder(), MeshCoreFit::CylinderFit::ProjectToCylinder(), and PartGui::ViewProviderMirror::setEdit().
void Vector3::ProjectToPlane | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclNorm, | ||
Vector3< _Precision > & | rclProj | ||
) | const |
Projects this point onto the plane given by the base rclBase and the normal rclNorm and stores the result in rclProj.
References Base::Vector3< _Precision >::Sqr().
void Vector3::RotateX | ( | _Precision | f | ) |
References Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
void Vector3::RotateY | ( | _Precision | f | ) |
References Base::Vector3< _Precision >::x, and Base::Vector3< _Precision >::z.
void Vector3::RotateZ | ( | _Precision | f | ) |
References Base::Vector3< _Precision >::x, and Base::Vector3< _Precision >::y.
Referenced by SketcherGui::EditModeConstraintCoinManager::processConstraints().
void Vector3::Scale | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
void Vector3::ScaleX | ( | _Precision | f | ) |
void Vector3::ScaleY | ( | _Precision | f | ) |
void Vector3::ScaleZ | ( | _Precision | f | ) |
void Vector3::Set | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
Referenced by StdCmdAlignment::activated(), Base::InventorBuilder::addBoundingBox(), Base::BoundBox3< _Precision >::CalcPlane(), MeshCore::MeshAlgorithm::CheckFacets(), MeshCore::CylinderSurfaceFit::CylinderSurfaceFit(), MeshCore::MeshGeomFacet::DistanceToPoint(), Part::Extrusion::fetchAxisLink(), Part::Revolution::fetchAxisLink(), MeshCoreFit::CylinderFit::findBestSolDirection(), Mesh::MeshObject::getEigenSystem(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Base::ViewProjMatrix::inverse(), Part::GeomCurve::normalAt(), MeshPart::MeshProjection::projectEdgeToEdge(), MeshCore::MeshOutput::Save3MFModel(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), MeshCore::MeshOutput::SaveSMF(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), MeshCore::SphereSurfaceFit::SphereSurfaceFit(), Fem::FemMesh::transformGeometry(), SketcherGui::DrawSketchHandlerLineSet::updateTransitionData(), and Fem::FemMesh::writeABAQUS().
_Precision Vector3::Sqr |
Squared length of the vector.
Referenced by MeshCore::MeshGeomFacet::AspectRatio(), Gui::PropertyEditor::RotationHelper::assignProperty(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), Base::Matrix4D::hasScale(), Base::Vector3< _Precision >::ProjectToLine(), Base::Vector3< _Precision >::ProjectToPlane(), MeshCore::MeshGeomFacet::Roundness(), Base::CoordinateSystem::setAxes(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), MeshCore::MeshGeomFacet::SetNormal(), Gui::LinkView::setTransform(), Part::GeomArcOfConic::setXAxisDir(), Base::CoordinateSystem::setXDirection(), and Base::CoordinateSystem::setYDirection().
void Vector3::TransformToCoordinateSystem | ( | const Vector3< _Precision > & | rclBase, |
const Vector3< _Precision > & | rclDirX, | ||
const Vector3< _Precision > & | rclDirY | ||
) |
Transforms this point to the coordinate system defined by origin rclBase, vector vector rclDirX and vector vector rclDirY.
References Base::Vector3< _Precision >::Normalize().
Referenced by MeshCore::PlaneFit::Dimension(), MeshCore::PlaneFit::GetLocalPoints(), MeshCore::SurfaceFit::PolynomFit(), and MeshCore::AbstractPolygonTriangulator::PostProcessing().
_Precision Base::Vector3< _Precision >::x |
x-coordinate
Referenced by PartGui::DlgRevolution::accept(), PartGui::TaskDlgAttacher::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), CmdSketcherConstrainLock::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainDistanceX::activated(), CmdSketcherConstrainPerpendicular::activated(), CmdSketcherConstrainAngle::activated(), Base::BoundBox3< _Precision >::Add(), Mod.PartDesign.Scripts.FilletArc.Vector::add(), Sketcher::Sketch::addArc(), Sketcher::Sketch::addArcOfEllipse(), Sketcher::Sketch::addArcOfHyperbola(), Sketcher::Sketch::addArcOfParabola(), Base::InventorBuilder::addBoundingBox(), Sketcher::Sketch::addBSpline(), Sketcher::SketchObject::addCopy(), Sketcher::Sketch::addEllipse(), PartGui::FaceColors::Private::addFacesToSelection(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Gui::SelectionSingleton::addSelection(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addSingleTriangle(), Sketcher::SketchObject::addSymmetric(), Base::Builder3D::addTransformation(), Base::InventorBuilder::addTransformation(), MeshCore::MeshTopoAlgorithm::AdjustEdgesToCurvatureDirection(), TechDraw::DrawUtil::angleWithX(), TechDraw::Generic::apparentInter(), CmdSketcherConstrainLock::applyConstraint(), CmdSketcherConstrainDistance::applyConstraint(), CmdSketcherConstrainDistanceX::applyConstraint(), CmdSketcherConstrainPerpendicular::applyConstraint(), CmdSketcherConstrainAngle::applyConstraint(), FemGui::ViewProviderFemMesh::applyDisplacementToNodes(), TechDraw::DrawProjGroupItem::autoPosition(), TechDrawGui::QGIViewBalloon::balloonLabelDragFinished(), Base::BoundBox3< _Precision >::BoundBox3(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::BSpline::BSpline(), TechDraw::CenterLine::calcEndPoints(), TechDraw::CenterLine::calcEndPoints2Lines(), TechDraw::CenterLine::calcEndPoints2Points(), TechDraw::CenterLine::calcEndPointsNoRef(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeXValue(), importSVG.svgHandler::characters(), MeshCore::MeshAlgorithm::CheckFacets(), Sketcher::SketchAnalysis::checkHorizontal(), MeshCore::MeshGrid::CheckPosition(), Sketcher::SketchAnalysis::checkVertical(), PathScripts.PathInspect.GCodeEditorDialog::cleanup(), TechDrawGui::TaskRichAnno::commonFeatureUpdate(), PartDesign::FeatureExtrude::computeDirection(), Part::Extrusion::computeFinalParameters(), MeshCore::MeshCurvature::ComputePerVertex(), TechDraw::CosmeticEdge::CosmeticEdge(), TechDrawGui::TaskRichAnno::createAnnoFeature(), Part::createFilletGeometry(), TechDrawGui::TaskLeaderLine::createLeaderFeature(), Import::ExportOCAF::createNode(), Mod.PartDesign.Scripts.FilletArc.Vector::cross(), cSimTool::cSimTool(), TechDrawGui::QGIFace::dashedPPath(), FemGui::TaskCreateNodeSet::DefineNodes(), MeshCore::MeshInfo::DetailedEdgeInfo(), TechDraw::DrawViewDetail::detailExec(), Base::CoordinateSystem::displacement(), TechDraw::DrawViewDimension::dist2Segs(), Base::Vector3< double >::DistanceToLine(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), PathScripts.PostUtils.GCodeEditorDialog::done(), Base::Vector3< _Precision >::Dot(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), TechDrawGui::QGIViewBalloon::drawBalloon(), SketcherGui::EditModeConstraintCoinManager::drawConstraintIcons(), TechDrawGui::QGIViewPart::drawSectionLine(), TechDraw::GeometryUtils::edgeFromGeneric(), PartDesign::Pad::execute(), PartDesign::Pocket::execute(), Drawing::ProjectionAlgos::execute(), Part::Mirroring::execute(), PartDesign::Hole::execute(), TechDraw::ProjectionAlgos::execute(), TechDraw::DrawViewDraft::execute(), Import::ImpExpDxfWrite::exportAngularDim(), Import::ImpExpDxfWrite::exportDiametricDim(), Import::ImpExpDxfWrite::exportLinearDim(), Import::ImpExpDxfWrite::exportRadialDim(), Import::ImpExpDxfWrite::exportText(), Sketcher::SketchObject::exposeInternalGeometry(), TechDrawGui::QGISectionLine::extensionEndsISO(), TechDrawGui::QGISectionLine::extensionEndsTrad(), Mesh::Facet::Facet(), Fem::FemPostDataAlongLineFilter::FemPostDataAlongLineFilter(), Sketcher::SketchObject::fillet(), Part::find2DLinesIntersection(), TechDraw::LineSet::findAtomStart(), MeshCoreFit::CylinderFit::findBestSolDirection(), Part::findFilletCenter(), MeshCore::CylinderFit::Fit(), PartDesignGui::fixSketchSupport(), VisualPathSegmentVisitor::g38(), PartDesign::Helix::generateHelixPath(), Part::GeomLine::GeomLine(), TechDrawGui::QGIViewPart::geomToPainterPath(), TechDrawGui::TaskDetail::getAnchorScene(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), TechDraw::DrawViewSection::getCSFromBase(), TechDrawGui::QGEPath::getDeltasFromLeader(), TechDraw::DrawViewDimension::getDimValue(), MeshCoreFit::CylinderFit::GetDistanceToCylinder(), MeshCoreFit::SphereFit::GetDistanceToSphere(), Mesh::MeshObject::getEigenSystem(), MeshCore::MeshKernel::GetGravityPoint(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), TechDrawGui::QGIWeldSymbol::getKinkPoint(), MeshCore::PlaneFit::GetLocalPoints(), Part::Feature::getLocation(), Part::FeatureReference::getLocation(), Base::BoundBox3< _Precision >::GetOctantFromVector(), MeshGui::PlaneFitParameter::getParameter(), MeshGui::CylinderFitParameter::getParameter(), TechDraw::LineSet::getPatternStartPoint(), Mesh::MeshObject::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::MeshObject::getPointNormals(), Mesh::MeshObject::getPoints(), TechDraw::DrawViewPart::getProjectionCS(), Base::Rotation::getRawValue(), PartDesignGui::ViewProviderDatum::getRelevantBoundBox(), TechDraw::DrawViewSection::getSectionCS(), Base::BoundBox3< _Precision >::GetSideFromRay(), TechDrawGui::QGIWeldSymbol::getTailPoint(), TechDrawGui::QGIWeldSymbol::getTileOrigin(), PartDesign::LinearPattern::getTransformations(), PartDesign::Mirrored::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), TechDraw::DrawGeomHatch::getTrimmedLinesSection(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::DrawProjGroupItem::getViewAxis(), TechDraw::getViewAxis(), MeshCore::MeshKernel::GetVolume(), Fem::FemMesh::getVolume(), Base::Matrix4D::Hat(), TechDraw::DrawUtil::Intersect2d(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), cSimTool::isInside(), TechDraw::DrawViewPart::isIso(), Sketcher::SketchObject::isPointOnCurve(), TechDraw::DrawWeldSymbol::isTailRightSide(), TechDraw::legacyViewAxis1(), Mod.PartDesign.Scripts.FilletArc.Vector::length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), PartGui::Location::Location(), MeshPart::MeshAlgos::LoftOnCurve(), TechDrawGui::QGISectionLine::makeArrowsISO(), TechDrawGui::QGISectionLine::makeArrowsTrad(), TechDraw::DrawGeomHatch::makeEdgeOverlay(), TechDrawGui::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), PartDesign::Feature::makePlnFromPlane(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), TechDrawGui::QGISectionLine::makeSymbolsISO(), TechDrawGui::QGISectionLine::makeSymbolsTrad(), SketcherGui::makeTangentToArcOfEllipseviaNewPoint(), SketcherGui::makeTangentToArcOfHyperbolaviaNewPoint(), SketcherGui::makeTangentToArcOfParabolaviaNewPoint(), SketcherGui::makeTangentToEllipseviaNewPoint(), Part::Geometry::mirror(), TechDraw::mirrorShapeVec(), DrawSketchHandlerBSplineInsertKnot::mouseMove(), SketcherGui::DrawSketchHandlerExtend::mouseMove(), SketcherGui::DrawSketchHandlerLineSet::mouseMove(), SketcherGui::DrawSketchHandlerTrimming::mouseMove(), Base::Matrix4D::move(), Sketcher::Sketch::movePoint(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), Gui::Dialog::Transform::on_applyButton_clicked(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::ViewProviderPath::onChanged(), PartGui::SectionCut::onCutXvalueChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), Base::Vector3< _Precision >::operator&(), Base::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator-(), MeshCore::MeshPoint::operator<(), PathScripts.PathDressupHoldingTags.Tag::originAt(), DrawingGui::orthoview::orthoview(), Base::Matrix4D::Outer(), MeshCore::PlaneSurfaceFit::Parameters(), MeshCore::CylinderSurfaceFit::Parameters(), MeshGui::SoFCMeshPickNode::pick(), Attacher::AttachEngine::placementFactory(), TechDraw::Vertex::point(), DraftGui.DraftToolBar::pointUi(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), SketcherGui::EditModeConstraintCoinManager::processConstraints(), Base::BoundBox3< _Precision >::ProjectBox(), Reen::ParameterCorrection::ProjectControlPointsOnPlane(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::CurveProjectorShape::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::DrawViewPart::projectPoint(), TechDraw::LandmarkDimension::projectPoint(), MeshCoreFit::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Points::E57Reader::read(), Attacher::AttachEngine::readLinks(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), SketcherGui::DrawSketchHandlerExtend::releaseButton(), DraftGui.DraftToolBar::reset_ui_values(), TechDraw::CosmeticVertex::Restore(), TechDraw::CenterLine::Restore(), TechDraw::Vertex::Restore(), TechDraw::Circle::Restore(), TechDraw::AOC::Restore(), TechDraw::Generic::Restore(), Part::Box::Restore(), Part::Geometry::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< _Precision >::RotateY(), Base::Vector3< _Precision >::RotateZ(), Base::Matrix4D::rotLine(), PartDesign::Helix::safePitch(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), Robot::Robot6Axis::Save(), Robot::Waypoint::Save(), TechDraw::CosmeticVertex::Save(), TechDraw::CenterLine::Save(), TechDraw::Vertex::Save(), TechDraw::Circle::Save(), TechDraw::AOC::Save(), App::PropertyPlacement::Save(), App::PropertyRotation::Save(), MeshCore::MeshOutput::Save3MFModel(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveAsymptote(), MeshCore::MeshOutput::SaveBinaryPLY(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveIDTF(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveNastran(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), Import::ExportOCAF::saveShape(), MeshCore::MeshOutput::SaveSMF(), MeshCore::MeshOutput::SaveVRML(), MeshCore::MeshOutput::SaveX3DContent(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), PartGui::SectionCut::SectionCut(), TechDraw::DrawViewSection::sectionExec(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Part::Part2DObject::seekTrimPoints(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), PartGui::DlgRevolution::setDirection(), Gui::LocationWidget::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Part::GeomLine::setLine(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), TechDraw::DrawViewBalloon::setOrigin(), App::PropertyVector::setPyObject(), Part::TopoShape::setShapePlacement(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskCosmeticLine::setUiEdit(), TechDrawGui::TaskDetail::setUiFromFeat(), TechDrawGui::TaskSectionView::setUiPrimary(), TechDrawGui::TaskCosmeticLine::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Gui::PropertyEditor::PropertyRotationItem::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Base::Rotation::setValue(), Gui::ManualAlignment::setViewingDirections(), Part::GeomArcOfConic::setXAxisDir(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNonManifolds::showDefects(), MeshGui::ViewProviderMeshNonManifoldPoints::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedPoints::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), Sketcher::SketchObject::split(), Mod.PartDesign.Scripts.FilletArc.Vector::sub(), Part::suggestFilletRadius(), FemGui::TaskPostDataAlongLine::TaskPostDataAlongLine(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyRotationItem::toolTip(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), Gui::PropertyEditor::PropertyRotationItem::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), TechDraw::CosmeticVertex::toString(), TechDraw::CenterLine::toString(), TechDraw::Circle::toString(), TechDraw::AOC::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), Base::Vector3< double >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), DraftGui.DraftToolBar::update_cartesian_coords(), DraftGui.DraftToolBar::update_spherical_coords(), PartDesign::Groove::updateAxis(), PartDesign::Helix::updateAxis(), PartDesign::Revolution::updateAxis(), TechDrawGui::TaskCosmeticLine::updateCosmeticLine(), FemGui::ViewProviderFemConstraintBearing::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), RobotGui::ViewProviderRobotObject::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), SketcherGui::DrawSketchHandlerLineSet::updateTransitionData(), DraftGui.DraftToolBar::validatePoint(), Gui::PropertyEditor::PropertyRotationItem::value(), Gui::PropertyEditor::PropertyPlacementItem::value(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), Path::PathSegmentWalker::walk(), automotive_design.right_angular_wedge::wr1(), Points::PlyWriter::write(), Points::PcdWriter::write(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), PartGui::DlgExtrusion::writeParametersToFeature(), CDxfWrite::writeRadialDimBlock(), and TechDraw::Vertex::x().
_Precision Base::Vector3< _Precision >::y |
y-coordinate
Referenced by PartGui::DlgRevolution::accept(), PartGui::TaskDlgAttacher::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), CmdSketcherConstrainLock::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainDistanceY::activated(), CmdSketcherConstrainPerpendicular::activated(), CmdSketcherConstrainAngle::activated(), Base::BoundBox3< _Precision >::Add(), Mod.PartDesign.Scripts.FilletArc.Vector::add(), Sketcher::Sketch::addArc(), Sketcher::Sketch::addArcOfEllipse(), Sketcher::Sketch::addArcOfHyperbola(), Sketcher::Sketch::addArcOfParabola(), Base::InventorBuilder::addBoundingBox(), Sketcher::Sketch::addBSpline(), Sketcher::SketchObject::addCopy(), Sketcher::Sketch::addEllipse(), PartGui::FaceColors::Private::addFacesToSelection(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Gui::SelectionSingleton::addSelection(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addSingleTriangle(), Sketcher::SketchObject::addSymmetric(), Base::Builder3D::addTransformation(), Base::InventorBuilder::addTransformation(), MeshCore::MeshTopoAlgorithm::AdjustEdgesToCurvatureDirection(), TechDraw::DrawLeaderLine::adjustLastSegment(), TechDraw::DrawUtil::angleWithX(), TechDraw::Generic::apparentInter(), CmdSketcherConstrainLock::applyConstraint(), CmdSketcherConstrainDistance::applyConstraint(), CmdSketcherConstrainDistanceY::applyConstraint(), CmdSketcherConstrainPerpendicular::applyConstraint(), CmdSketcherConstrainAngle::applyConstraint(), FemGui::ViewProviderFemMesh::applyDisplacementToNodes(), TechDraw::DrawProjGroupItem::autoPosition(), TechDrawGui::QGIViewBalloon::balloonLabelDragFinished(), Base::BoundBox3< _Precision >::BoundBox3(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::BSpline::BSpline(), TechDraw::CenterLine::calcEndPoints(), TechDraw::CenterLine::calcEndPoints2Lines(), TechDraw::CenterLine::calcEndPoints2Points(), TechDraw::CenterLine::calcEndPointsNoRef(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeYValue(), importSVG.svgHandler::characters(), MeshCore::MeshAlgorithm::CheckFacets(), Sketcher::SketchAnalysis::checkHorizontal(), MeshCore::MeshGrid::CheckPosition(), Sketcher::SketchAnalysis::checkVertical(), PathScripts.PathInspect.GCodeEditorDialog::cleanup(), TechDrawGui::TaskRichAnno::commonFeatureUpdate(), PartDesign::FeatureExtrude::computeDirection(), Part::Extrusion::computeFinalParameters(), MeshCore::MeshCurvature::ComputePerVertex(), TechDraw::CosmeticEdge::CosmeticEdge(), TechDrawGui::TaskRichAnno::createAnnoFeature(), Part::createFilletGeometry(), TechDrawGui::TaskLeaderLine::createLeaderFeature(), Import::ExportOCAF::createNode(), Mod.PartDesign.Scripts.FilletArc.Vector::cross(), cSimTool::cSimTool(), TechDrawGui::QGIFace::dashedPPath(), FemGui::TaskCreateNodeSet::DefineNodes(), MeshCore::MeshInfo::DetailedEdgeInfo(), TechDraw::DrawViewDetail::detailExec(), Base::CoordinateSystem::displacement(), TechDraw::DrawViewDimension::dist2Segs(), Base::Vector3< double >::DistanceToLine(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), PathScripts.PostUtils.GCodeEditorDialog::done(), Base::Vector3< _Precision >::Dot(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), TechDrawGui::QGIViewBalloon::drawBalloon(), SketcherGui::EditModeConstraintCoinManager::drawConstraintIcons(), TechDrawGui::QGIViewPart::drawSectionLine(), TechDraw::GeometryUtils::edgeFromGeneric(), TechDrawGui::execHoleCircle(), PartDesign::Pad::execute(), PartDesign::Pocket::execute(), Drawing::ProjectionAlgos::execute(), Part::Mirroring::execute(), PartDesign::Hole::execute(), TechDraw::ProjectionAlgos::execute(), TechDraw::DrawViewDraft::execute(), Import::ImpExpDxfWrite::exportAngularDim(), Import::ImpExpDxfWrite::exportDiametricDim(), Import::ImpExpDxfWrite::exportLinearDim(), Import::ImpExpDxfWrite::exportRadialDim(), Import::ImpExpDxfWrite::exportText(), Sketcher::SketchObject::exposeInternalGeometry(), TechDrawGui::QGISectionLine::extensionEndsISO(), TechDrawGui::QGISectionLine::extensionEndsTrad(), Mesh::Facet::Facet(), Fem::FemPostDataAlongLineFilter::FemPostDataAlongLineFilter(), Sketcher::SketchObject::fillet(), Part::find2DLinesIntersection(), TechDraw::LineSet::findAtomStart(), MeshCoreFit::CylinderFit::findBestSolDirection(), Part::findFilletCenter(), MeshCore::CylinderFit::Fit(), PartDesignGui::fixSketchSupport(), VisualPathSegmentVisitor::g38(), PartDesign::Helix::generateHelixPath(), Part::GeomLine::GeomLine(), TechDrawGui::QGIViewPart::geomToPainterPath(), TechDrawGui::TaskDetail::getAnchorScene(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), TechDraw::DrawViewSection::getCSFromBase(), TechDrawGui::QGEPath::getDeltasFromLeader(), TechDraw::DrawViewDimension::getDimValue(), MeshCoreFit::CylinderFit::GetDistanceToCylinder(), MeshCoreFit::SphereFit::GetDistanceToSphere(), Mesh::MeshObject::getEigenSystem(), MeshCore::MeshKernel::GetGravityPoint(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), TechDrawGui::QGIWeldSymbol::getKinkPoint(), MeshCore::PlaneFit::GetLocalPoints(), Part::Feature::getLocation(), Part::FeatureReference::getLocation(), Base::BoundBox3< _Precision >::GetOctantFromVector(), MeshGui::PlaneFitParameter::getParameter(), MeshGui::CylinderFitParameter::getParameter(), TechDraw::LineSet::getPatternStartPoint(), Mesh::MeshObject::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::MeshObject::getPointNormals(), Mesh::MeshObject::getPoints(), TechDraw::DrawViewPart::getProjectionCS(), Base::Rotation::getRawValue(), PartDesignGui::ViewProviderDatum::getRelevantBoundBox(), TechDraw::DrawViewSection::getSectionCS(), Base::BoundBox3< _Precision >::GetSideFromRay(), TechDrawGui::QGIWeldSymbol::getTailPoint(), TechDrawGui::QGIWeldSymbol::getTileOrigin(), PartDesign::LinearPattern::getTransformations(), PartDesign::Mirrored::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), TechDraw::DrawGeomHatch::getTrimmedLinesSection(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::DrawProjGroupItem::getViewAxis(), TechDraw::getViewAxis(), MeshCore::MeshKernel::GetVolume(), Fem::FemMesh::getVolume(), Base::Matrix4D::Hat(), TechDraw::DrawUtil::Intersect2d(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), cSimTool::isInside(), TechDraw::DrawViewPart::isIso(), Sketcher::SketchObject::isPointOnCurve(), TechDraw::legacyViewAxis1(), Mod.PartDesign.Scripts.FilletArc.Vector::length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), PartGui::Location::Location(), MeshPart::MeshAlgos::LoftOnCurve(), TechDrawGui::QGISectionLine::makeArrowsISO(), TechDrawGui::QGISectionLine::makeArrowsTrad(), TechDraw::DrawGeomHatch::makeEdgeOverlay(), TechDrawGui::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), PartDesign::Feature::makePlnFromPlane(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), TechDrawGui::QGISectionLine::makeSymbolsISO(), TechDrawGui::QGISectionLine::makeSymbolsTrad(), SketcherGui::makeTangentToArcOfEllipseviaNewPoint(), SketcherGui::makeTangentToArcOfHyperbolaviaNewPoint(), SketcherGui::makeTangentToArcOfParabolaviaNewPoint(), SketcherGui::makeTangentToEllipseviaNewPoint(), Part::Geometry::mirror(), TechDraw::mirrorShapeVec(), DrawSketchHandlerBSplineInsertKnot::mouseMove(), SketcherGui::DrawSketchHandlerExtend::mouseMove(), SketcherGui::DrawSketchHandlerLineSet::mouseMove(), SketcherGui::DrawSketchHandlerTrimming::mouseMove(), Base::Matrix4D::move(), Sketcher::Sketch::movePoint(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), Gui::Dialog::Transform::on_applyButton_clicked(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::ViewProviderPath::onChanged(), PartGui::SectionCut::onCutYvalueChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), Base::Vector3< _Precision >::operator&(), Base::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator-(), MeshCore::MeshPoint::operator<(), PathScripts.PathDressupHoldingTags.Tag::originAt(), DrawingGui::orthoview::orthoview(), Base::Matrix4D::Outer(), MeshCore::PlaneSurfaceFit::Parameters(), MeshCore::CylinderSurfaceFit::Parameters(), MeshGui::SoFCMeshPickNode::pick(), Attacher::AttachEngine::placementFactory(), TechDraw::Vertex::point(), DraftGui.DraftToolBar::pointUi(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), SketcherGui::EditModeConstraintCoinManager::processConstraints(), Base::BoundBox3< _Precision >::ProjectBox(), Reen::ParameterCorrection::ProjectControlPointsOnPlane(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::CurveProjectorShape::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::DrawViewPart::projectPoint(), TechDraw::LandmarkDimension::projectPoint(), MeshCoreFit::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Points::E57Reader::read(), Attacher::AttachEngine::readLinks(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), SketcherGui::DrawSketchHandlerExtend::releaseButton(), DraftGui.DraftToolBar::reset_ui_values(), TechDraw::CosmeticVertex::Restore(), TechDraw::CenterLine::Restore(), TechDraw::Vertex::Restore(), TechDraw::Circle::Restore(), TechDraw::AOC::Restore(), Part::Box::Restore(), Part::Geometry::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< _Precision >::RotateX(), Base::Vector3< _Precision >::RotateZ(), Base::Matrix4D::rotLine(), PartDesign::Helix::safePitch(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), Robot::Robot6Axis::Save(), Robot::Waypoint::Save(), TechDraw::CosmeticVertex::Save(), TechDraw::CenterLine::Save(), TechDraw::Vertex::Save(), TechDraw::Circle::Save(), TechDraw::AOC::Save(), App::PropertyPlacement::Save(), App::PropertyRotation::Save(), MeshCore::MeshOutput::Save3MFModel(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveAsymptote(), MeshCore::MeshOutput::SaveBinaryPLY(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveIDTF(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveNastran(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), Import::ExportOCAF::saveShape(), MeshCore::MeshOutput::SaveSMF(), MeshCore::MeshOutput::SaveVRML(), MeshCore::MeshOutput::SaveX3DContent(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), PartGui::SectionCut::SectionCut(), TechDraw::DrawViewSection::sectionExec(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Part::Part2DObject::seekTrimPoints(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), PartGui::DlgRevolution::setDirection(), Gui::LocationWidget::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Part::GeomLine::setLine(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), TechDraw::DrawViewBalloon::setOrigin(), App::PropertyVector::setPyObject(), Part::TopoShape::setShapePlacement(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskCosmeticLine::setUiEdit(), TechDrawGui::TaskDetail::setUiFromFeat(), TechDrawGui::TaskSectionView::setUiPrimary(), TechDrawGui::TaskCosmeticLine::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Gui::PropertyEditor::PropertyRotationItem::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Base::Rotation::setValue(), Gui::ManualAlignment::setViewingDirections(), Part::GeomArcOfConic::setXAxisDir(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNonManifolds::showDefects(), MeshGui::ViewProviderMeshNonManifoldPoints::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedPoints::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), Sketcher::SketchObject::split(), Mod.PartDesign.Scripts.FilletArc.Vector::sub(), Part::suggestFilletRadius(), FemGui::TaskPostDataAlongLine::TaskPostDataAlongLine(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyRotationItem::toolTip(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), Gui::PropertyEditor::PropertyRotationItem::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), TechDraw::CosmeticVertex::toString(), TechDraw::CenterLine::toString(), TechDraw::Circle::toString(), TechDraw::AOC::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), Base::Vector3< double >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), DraftGui.DraftToolBar::update_cartesian_coords(), DraftGui.DraftToolBar::update_spherical_coords(), PartDesign::Groove::updateAxis(), PartDesign::Helix::updateAxis(), PartDesign::Revolution::updateAxis(), TechDrawGui::TaskCosmeticLine::updateCosmeticLine(), FemGui::ViewProviderFemConstraintBearing::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), RobotGui::ViewProviderRobotObject::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), SketcherGui::DrawSketchHandlerLineSet::updateTransitionData(), DraftGui.DraftToolBar::validatePoint(), Gui::PropertyEditor::PropertyRotationItem::value(), Gui::PropertyEditor::PropertyPlacementItem::value(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), Path::PathSegmentWalker::walk(), Points::PlyWriter::write(), Points::PcdWriter::write(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), PartGui::DlgExtrusion::writeParametersToFeature(), CDxfWrite::writeRadialDimBlock(), and TechDraw::Vertex::y().
_Precision Base::Vector3< _Precision >::z |
z-coordinate
Referenced by PartGui::DlgRevolution::accept(), PartGui::TaskDlgAttacher::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), CmdSketcherConstrainAngle::activated(), Base::BoundBox3< _Precision >::Add(), Mod.PartDesign.Scripts.FilletArc.Vector::add(), Base::InventorBuilder::addBoundingBox(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Gui::SelectionSingleton::addSelection(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addSingleTriangle(), Base::Builder3D::addTransformation(), Base::InventorBuilder::addTransformation(), MeshCore::MeshTopoAlgorithm::AdjustEdgesToCurvatureDirection(), CmdSketcherConstrainAngle::applyConstraint(), FemGui::ViewProviderFemMesh::applyDisplacementToNodes(), automotive_design.revolved_area_solid::axis_line(), automotive_design.surface_of_revolution::axis_line(), automotive_design.revolved_face_solid::axis_line(), ifc4.ifcrevolvedareasolid::axisdirectioninxy(), ifc2x3.ifcsurfaceofrevolution::axisline(), ifc2x3.ifcrevolvedareasolid::axisline(), ifc4.ifcsurfaceofrevolution::axisline(), ifc4.ifcrevolvedareasolid::axisline(), PathScripts.PathDressupHoldingTags.Tag::bottom(), Base::BoundBox3< _Precision >::BoundBox3(), TechDraw::CenterLine::calcEndPoints2Points(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeZValue(), MeshCore::MeshGrid::CheckPosition(), PathScripts.PathDressupTag.TagSolid::cloneAt(), PartDesign::FeatureExtrude::computeDirection(), Part::Extrusion::computeFinalParameters(), MeshCore::MeshCurvature::ComputePerVertex(), TechDraw::CosmeticEdge::CosmeticEdge(), Import::ExportOCAF::createNode(), PathScripts.PathDressupHoldingTags.Tag::createSolidsAt(), Mod.PartDesign.Scripts.FilletArc.Vector::cross(), cSimTool::cSimTool(), MeshCore::MeshInfo::DetailedEdgeInfo(), TechDraw::DrawViewDetail::detailExec(), Base::CoordinateSystem::displacement(), Base::Vector3< double >::DistanceToLine(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), Base::Vector3< _Precision >::Dot(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), SketcherGui::EditModeConstraintCoinManager::drawConstraintIcons(), TechDraw::GeometryUtils::edgeFromGeneric(), PartDesign::Pad::execute(), PartDesign::Pocket::execute(), Drawing::ProjectionAlgos::execute(), Part::Mirroring::execute(), PartDesign::Hole::execute(), TechDraw::ProjectionAlgos::execute(), TechDraw::DrawViewDraft::execute(), Import::ImpExpDxfWrite::exportAngularDim(), Import::ImpExpDxfWrite::exportDiametricDim(), Import::ImpExpDxfWrite::exportLinearDim(), Import::ImpExpDxfWrite::exportRadialDim(), Import::ImpExpDxfWrite::exportText(), Mesh::Facet::Facet(), Fem::FemPostDataAlongLineFilter::FemPostDataAlongLineFilter(), Sketcher::SketchObject::fillet(), MeshCoreFit::CylinderFit::findBestSolDirection(), MeshCore::CylinderFit::Fit(), PartDesignGui::fixSketchSupport(), VisualPathSegmentVisitor::g38(), PartDesign::Helix::generateHelixPath(), Part::GeomLine::GeomLine(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), TechDraw::DrawViewSection::getCSFromBase(), Path::Toolpath::getCycleTime(), MeshCoreFit::CylinderFit::GetDistanceToCylinder(), MeshCoreFit::SphereFit::GetDistanceToSphere(), Mesh::MeshObject::getEigenSystem(), MeshCore::MeshKernel::GetGravityPoint(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), MeshCore::PlaneFit::GetLocalPoints(), Part::Feature::getLocation(), Part::FeatureReference::getLocation(), Base::BoundBox3< _Precision >::GetOctantFromVector(), MeshGui::PlaneFitParameter::getParameter(), MeshGui::CylinderFitParameter::getParameter(), Mesh::MeshObject::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::MeshObject::getPointNormals(), Mesh::MeshObject::getPoints(), TechDraw::DrawViewPart::getProjectionCS(), Base::Rotation::getRawValue(), PartDesignGui::ViewProviderDatum::getRelevantBoundBox(), TechDraw::DrawViewSection::getSectionCS(), Base::BoundBox3< _Precision >::GetSideFromRay(), PartDesign::LinearPattern::getTransformations(), PartDesign::Mirrored::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), TechDraw::DrawGeomHatch::getTrimmedLinesSection(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::DrawProjGroupItem::getViewAxis(), TechDraw::getViewAxis(), MeshCore::MeshKernel::GetVolume(), Fem::FemMesh::getVolume(), Base::Matrix4D::Hat(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), cSimTool::isInside(), TechDraw::DrawViewPart::isIso(), Part::Geom2dConic::isReversed(), Part::Geom2dArcOfConic::isReversed(), TechDraw::legacyViewAxis1(), Mod.PartDesign.Scripts.FilletArc.Vector::length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), PartGui::Location::Location(), MeshPart::MeshAlgos::LoftOnCurve(), PartDesign::Feature::makePlnFromPlane(), Base::Rotation::makeRotationByAxes(), Part::Geometry::mirror(), TechDraw::mirrorShapeVec(), Base::Matrix4D::move(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), Mesh::MeshObject::offsetSpecial(), MeshPart::MeshAlgos::offsetSpecial(), Gui::Dialog::Transform::on_applyButton_clicked(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::ViewProviderPath::onChanged(), PartGui::SectionCut::onCutZvalueChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), Base::Vector3< _Precision >::operator&(), Base::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator-(), MeshCore::MeshPoint::operator<(), DrawingGui::orthoview::orthoview(), Base::Matrix4D::Outer(), MeshCore::PlaneSurfaceFit::Parameters(), MeshCore::CylinderSurfaceFit::Parameters(), MeshGui::SoFCMeshPickNode::pick(), Attacher::AttachEngine::placementFactory(), DraftGui.DraftToolBar::pointUi(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), Reen::ParameterCorrection::ProjectControlPointsOnPlane(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::CurveProjectorShape::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::DrawViewPart::projectPoint(), TechDraw::LandmarkDimension::projectPoint(), MeshCore::SphereFit::ProjectToSphere(), MeshCoreFit::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Points::E57Reader::read(), Attacher::AttachEngine::readLinks(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), DraftGui.DraftToolBar::reset_ui_values(), TechDraw::CosmeticVertex::Restore(), TechDraw::CenterLine::Restore(), TechDraw::Vertex::Restore(), TechDraw::Circle::Restore(), TechDraw::AOC::Restore(), Part::Box::Restore(), Part::Geometry::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< _Precision >::RotateX(), Base::Vector3< _Precision >::RotateY(), Base::Matrix4D::rotLine(), PartDesign::Helix::safePitch(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), Robot::Robot6Axis::Save(), Robot::Waypoint::Save(), TechDraw::CosmeticVertex::Save(), TechDraw::CenterLine::Save(), TechDraw::Vertex::Save(), TechDraw::Circle::Save(), TechDraw::AOC::Save(), App::PropertyPlacement::Save(), App::PropertyRotation::Save(), MeshCore::MeshOutput::Save3MFModel(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveAsymptote(), MeshCore::MeshOutput::SaveBinaryPLY(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveIDTF(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveNastran(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), Import::ExportOCAF::saveShape(), MeshCore::MeshOutput::SaveSMF(), MeshCore::MeshOutput::SaveVRML(), MeshCore::MeshOutput::SaveX3DContent(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), PartGui::SectionCut::SectionCut(), TechDraw::DrawViewSection::sectionExec(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), PartGui::DlgRevolution::setDirection(), Gui::LocationWidget::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Part::GeomLine::setLine(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), App::PropertyVector::setPyObject(), Part::TopoShape::setShapePlacement(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskCosmeticLine::setUiEdit(), TechDrawGui::TaskSectionView::setUiPrimary(), TechDrawGui::TaskCosmeticLine::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Gui::PropertyEditor::PropertyRotationItem::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Base::Rotation::setValue(), Gui::ManualAlignment::setViewingDirections(), Part::GeomArcOfConic::setXAxisDir(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNonManifolds::showDefects(), MeshGui::ViewProviderMeshNonManifoldPoints::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedPoints::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), importSH3D.SH3DHandler::startElement(), Mod.PartDesign.Scripts.FilletArc.Vector::sub(), FemGui::TaskPostDataAlongLine::TaskPostDataAlongLine(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyRotationItem::toolTip(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PathScripts.PathDressupHoldingTags.Tag::top(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), Gui::PropertyEditor::PropertyRotationItem::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), TechDraw::CosmeticVertex::toString(), TechDraw::CenterLine::toString(), TechDraw::Circle::toString(), TechDraw::AOC::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), Base::Vector3< double >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), DraftGui.DraftToolBar::update_cartesian_coords(), DraftGui.DraftToolBar::update_spherical_coords(), PartDesign::Groove::updateAxis(), PartDesign::Helix::updateAxis(), PartDesign::Revolution::updateAxis(), TechDrawGui::TaskCosmeticLine::updateCosmeticLine(), FemGui::ViewProviderFemConstraintBearing::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), RobotGui::ViewProviderRobotObject::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), DraftGui.DraftToolBar::validatePoint(), Gui::PropertyEditor::PropertyRotationItem::value(), Gui::PropertyEditor::PropertyPlacementItem::value(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), Path::PathSegmentWalker::walk(), ifc2x3.ifcrevolvedareasolid::wr32(), Points::PlyWriter::write(), Points::PcdWriter::write(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), PartGui::DlgExtrusion::writeParametersToFeature(), and CDxfWrite::writeRadialDimBlock().