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- (void) 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 > &rcVct) |
Assignment. More... | |
_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 (void) const |
Length of the vector. More... | |
_Precision | Sqr (void) const |
Squared length of the vector. More... | |
Vector3 & | Normalize (void) |
Set length to 1. 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 > &rcVct) | |
Construction. More... | |
Detailed Description
template<class _Precision>
class Base::Vector3< _Precision >
The Vector Base class.
Member Typedef Documentation
◆ num_type
typedef _Precision Base::Vector3< _Precision >::num_type |
◆ traits_type
typedef float_traits<num_type> Base::Vector3< _Precision >::traits_type |
Constructor & Destructor Documentation
◆ Vector3() [1/2]
|
explicit |
Construction.
◆ Vector3() [2/2]
Vector3::Vector3 | ( | const Vector3< _Precision > & | rcVct | ) |
Construction.
Member Function Documentation
◆ Cross()
Vector3< _Precision > Vector3::Cross | ( | const Vector3< _Precision > & | rcVct | ) | const |
Cross product.
Referenced by MeshCore::MeshGeomEdge::ClosestPointsToLine(), Sketcher::SketchObject::fillet(), MeshPart::MeshProjection::findIntersection(), TechDrawGui::DrawGuiUtil::get3DDirAndRot(), TechDrawGui::DrawGuiUtil::getProjDirFromFace(), TechDraw::DrawProjGroupItem::getRotateAngle(), TechDraw::getViewAxis(), MeshCore::MeshGeomEdge::IntersectWithLine(), Part::Geom2dConic::isReversed(), Part::Geom2dArcOfConic::isReversed(), TechDraw::legacyViewAxis1(), Base::Rotation::makeRotationByAxes(), and TechDraw::DrawViewSection::sectionLineEnds().
◆ DistanceToLine()
_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.
Referenced by MeshCoreFit::CylinderFit::ComputeApproximationsLine(), Base::VectorPy::distanceToLine(), MeshCoreFit::CylinderFit::GetDistanceToCylinder(), MeshCore::CylinderFit::GetDistanceToCylinder(), MeshCore::CylinderSurfaceFit::GetDistanceToSurface(), MeshCore::MeshGeomFacet::IsPointOf(), MeshCoreFit::CylinderFit::ProjectToCylinder(), MeshCore::CylinderFit::ProjectToCylinder(), MeshCoreFit::CylinderFit::SetApproximations(), and MeshCore::MeshTopoAlgorithm::SplitFacet().
◆ DistanceToLineSegment()
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.
Referenced by Base::VectorPy::distanceToLineSegment(), and CDxfWrite::writeLinearDimBlock().
◆ DistanceToPlane()
_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.
Referenced by MeshCore::MeshProjection::bboxInsideRectangle(), Base::VectorPy::distanceToPlane(), Mesh::SegmentByMesh::execute(), MeshCore::PlaneSurfaceFit::GetDistanceToSurface(), MeshCore::MeshAlgorithm::GetFacetsFromPlane(), MeshCore::MeshGeomEdge::IntersectWithLine(), and MeshCore::MeshPoint::operator==().
◆ Dot()
_Precision Vector3::Dot | ( | const Vector3< _Precision > & | rcVct | ) | const |
Scalar product.
Referenced by Sketcher::SketchObject::fillet(), MeshPart::MeshProjection::findIntersection(), MeshCore::MeshFixCaps::Fixup(), TechDraw::DrawProjGroupItem::getViewAxis(), MeshCore::MeshGeomEdge::IntersectWithPlane(), MeshCore::TriangulationVerifier::MustFlip(), MeshCore::TriangulationVerifierV2::MustFlip(), and MeshCore::CylinderSurfaceFit::TestTriangle().
◆ epsilon()
|
static |
Referenced by MeshCore::MeshAlgorithm::GetFacetsFromToolMesh(), and MeshCore::MeshAlgorithm::Surround().
◆ GetAngle()
_Precision Vector3::GetAngle | ( | const Vector3< _Precision > & | rcVect | ) | const |
Get angle between both vectors. The returned value lies in the interval [0,pi].
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(), Base::VectorPy::getAngle(), TechDraw::DrawViewDimension::getDimValue(), TechDraw::DrawProjGroupItem::getRotateAngle(), MeshCore::MeshGeomEdge::IntersectWithLine(), MeshCore::MeshGeomFacet::MaximumAngle(), MeshCore::MeshGeomFacet::MinimumAngle(), DrawSketchHandlerFillet::releaseButton(), MeshCore::MeshTopoAlgorithm::ShouldSwapEdge(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), and CDxfWrite::writeLinearDimBlock().
◆ IsEqual()
bool Vector3::IsEqual | ( | const Vector3< _Precision > & | rclPnt, |
_Precision | tol | ||
) | const |
IsEqual.
- Parameters
-
rclPnt tol
- Returns
- true or false If the distance to point rclPnt is within the tolerance tol both points are considered equal.
Referenced by TechDraw::BSpline::asCircle(), TechDraw::DrawUtil::boxIntersect2d(), TechDrawGui::QGIViewDimension::findIsoExt(), TechDraw::getViewAxis(), TechDraw::legacyViewAxis1(), TechDrawGui::QGIFace::lineSetToFillItems(), and TechDraw::CenterLine::scaledGeometry().
◆ IsOnLineSegment()
bool Vector3::IsOnLineSegment | ( | const Vector3< _Precision > & | startVct, |
const Vector3< _Precision > & | endVct | ||
) | const |
Check if Vector is on a line segment.
◆ Length()
_Precision Vector3::Length | ( | void | ) | const |
Length of the vector.
Referenced by CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainAngle::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< float >::DistanceToPlane(), MeshCore::MeshEigensystem::Evaluate(), Mesh::SegmentByMesh::execute(), Sketcher::SketchObject::extend(), Sketcher::SketchObject::fillet(), MeshCore::QuadraticFit::GetCurvatureInfo(), MeshCore::SurfaceFit::GetCurvatureInfo(), TechDraw::DrawViewDimension::getDimValue(), MeshCoreFit::SphereFit::GetDistanceToSphere(), MeshCore::SphereFit::GetDistanceToSphere(), Reen::ParameterCorrection::GetGravityPoint(), Base::VectorPy::getLength(), Robot::Trajectory::getVelocity(), TechDraw::DrawProjGroupItem::getXDirection(), TechDraw::DrawViewSection::getXDirection(), TechDraw::DrawViewPart::getXDirection(), MeshCore::MeshAlgorithm::IsVertexVisible(), Base::Rotation::makeRotationByAxes(), Base::VectorPy::normalize(), MeshPart::MeshAlgos::offsetSpecial2(), Mesh::MeshObject::offsetSpecial2(), Fem::ConstraintForce::onChanged(), Fem::ConstraintGear::onChanged(), Fem::ConstraintFluidBoundary::onChanged(), Part::ParabolaPy::PyInit(), DrawSketchHandlerFillet::releaseButton(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Gui::LocationWidget::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), Base::VectorPy::setLength(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), Base::Rotation::setValue(), Part::GeomArcOfConic::setXAxisDir(), MeshCore::MeshTopoAlgorithm::SnapVertex(), MeshCore::MeshGeomFacet::SubSample(), PartDesign::Groove::updateAxis(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), and FemGui::ViewProviderFemPostPlaneFunction::updateData().
◆ Move()
void Vector3::Move | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
◆ MoveX()
void Vector3::MoveX | ( | _Precision | f | ) |
◆ MoveY()
void Vector3::MoveY | ( | _Precision | f | ) |
◆ MoveZ()
void Vector3::MoveZ | ( | _Precision | f | ) |
◆ Normalize()
Vector3< _Precision > & Vector3::Normalize | ( | void | ) |
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(), Gui::ManualAlignment::computeAlignment(), Fem::ConstraintGear::ConstraintGear(), TechDrawGui::QGIFace::dashedPPath(), MeshCore::MeshGeomFacet::DistancePlaneToPoint(), SketcherGui::ViewProviderSketch::draw(), 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::MeshRefPointToFacets::GetNormal(), MeshCore::MeshKernel::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::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), MeshPart::CurveProjectorWithToolMesh::makeToolMesh(), Base::VectorPy::normalize(), MeshPart::MeshAlgos::offsetSpecial(), Mesh::MeshObject::offsetSpecial(), MeshPart::MeshAlgos::offsetSpecial2(), Mesh::MeshObject::offsetSpecial2(), MeshCore::MeshProjection::projectLineOnMesh(), Base::Matrix4D::rotLine(), TechDraw::DrawViewSection::sectionLineEnds(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), MeshCoreFit::CylinderFit::SetApproximations(), Base::CoordinateSystem::setAxes(), TechDrawGui::QGISectionLine::setDirection(), 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< float >::TransformToCoordinateSystem(), DrawSketchHandlerLineSet::updateTransitionData(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), CDxfWrite::writeLinearDimBlock(), and CDxfWrite::writeRadialDimBlock().
◆ operator!=()
Comparing for inequality.
◆ operator%()
Vector3< _Precision > Vector3::operator% | ( | const Vector3< _Precision > & | rcVct | ) | const |
Cross product.
◆ operator&()
Vector3< _Precision > Vector3::operator& | ( | const Vector3< _Precision > & | rcVct | ) | const |
◆ operator*() [1/2]
Vector3< _Precision > Vector3::operator* | ( | _Precision | fScale | ) | const |
Vector scaling.
◆ operator*() [2/2]
_Precision Vector3::operator* | ( | const Vector3< _Precision > & | rcVct | ) | const |
Scalar product.
◆ operator*=()
Vector3< _Precision > & Vector3::operator*= | ( | _Precision | fScale | ) |
◆ operator+()
Vector3< _Precision > Vector3::operator+ | ( | const Vector3< _Precision > & | rcVct | ) | const |
Vector addition.
◆ operator+=()
Vector3< _Precision > & Vector3::operator+= | ( | const Vector3< _Precision > & | rcVct | ) |
Vector summation.
◆ operator-() [1/2]
Vector3< _Precision > Vector3::operator- | ( | const Vector3< _Precision > & | rcVct | ) | const |
Vector subtraction.
◆ operator-() [2/2]
Vector3< _Precision > Vector3::operator- | ( | void | ) | const |
Negative vector.
◆ operator-=()
Vector3< _Precision > & Vector3::operator-= | ( | const Vector3< _Precision > & | rcVct | ) |
Vector subtraction.
◆ operator/()
Vector3< _Precision > Vector3::operator/ | ( | _Precision | fDiv | ) | const |
◆ operator/=()
Vector3< _Precision > & Vector3::operator/= | ( | _Precision | fDiv | ) |
◆ operator=()
Vector3< _Precision > & Vector3::operator= | ( | const Vector3< _Precision > & | rcVct | ) |
Assignment.
◆ operator==()
Comparing for equality.
◆ operator[]() [1/2]
_Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) |
Returns a reference to a coordinate. usIndex must be in the range [0,2].
◆ operator[]() [2/2]
const _Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) | const |
Returns a const reference to a coordinate. usIndex must be in the range [0,2].
◆ Perpendicular()
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(), MeshCore::MeshFixCaps::Fixup(), and PartDesign::ProfileBased::getReversedAngle().
◆ ProjectToLine()
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.
Referenced by Part::createFilletGeometry(), SketcherGui::ViewProviderSketch::draw(), MeshCore::MeshEigensystem::Evaluate(), Sketcher::SketchObject::fillet(), Part::findFilletCenter(), MeshCore::MeshProjection::isPointInsideDistance(), SketcherGui::ViewProviderSketch::moveConstraint(), Base::VectorPy::projectToLine(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), and Part::suggestFilletRadius().
◆ ProjectToPlane() [1/2]
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.
Referenced by Reen::ParameterCorrection::ProjectControlPointsOnPlane(), MeshCore::MeshGeomFacet::ProjectPointToPlane(), MeshCoreFit::CylinderFit::ProjectToCylinder(), MeshCore::CylinderFit::ProjectToCylinder(), Base::VectorPy::projectToPlane(), and PartGui::ViewProviderMirror::setEdit().
◆ ProjectToPlane() [2/2]
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.
◆ RotateX()
void Vector3::RotateX | ( | _Precision | f | ) |
◆ RotateY()
void Vector3::RotateY | ( | _Precision | f | ) |
◆ RotateZ()
void Vector3::RotateZ | ( | _Precision | f | ) |
◆ Scale()
void Vector3::Scale | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
◆ ScaleX()
void Vector3::ScaleX | ( | _Precision | f | ) |
◆ ScaleY()
void Vector3::ScaleY | ( | _Precision | f | ) |
◆ ScaleZ()
void Vector3::ScaleZ | ( | _Precision | f | ) |
◆ Set()
void Vector3::Set | ( | _Precision | fX, |
_Precision | fY, | ||
_Precision | fZ | ||
) |
Referenced by StdCmdAlignment::activated(), Base::InventorBuilder::addBoundingBox(), MeshCore::MeshAlgorithm::CheckFacets(), MeshPart::Mesher::createMesh(), MeshCore::CylinderSurfaceFit::CylinderSurfaceFit(), MeshCore::MeshGeomFacet::DistanceToPoint(), Part::Revolution::fetchAxisLink(), Part::Extrusion::fetchAxisLink(), MeshCoreFit::CylinderFit::findBestSolDirection(), Mesh::MeshObject::getEigenSystem(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Base::ViewProjMatrix::inverse(), Part::GeomCurve::normalAt(), MeshPart::MeshProjection::projectEdgeToEdge(), Base::VectorPy::PyInit(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), MeshCore::MeshOutput::SaveSMF(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshCore::PlaneFitSmoothing::Smooth(), MeshCore::PlaneFitSmoothing::SmoothPoints(), MeshCore::SphereSurfaceFit::SphereSurfaceFit(), Fem::FemMesh::transformGeometry(), DrawSketchHandlerLineSet::updateTransitionData(), and Fem::FemMesh::writeABAQUS().
◆ Sqr()
_Precision Vector3::Sqr | ( | void | ) | const |
Squared length of the vector.
Referenced by MeshCore::MeshGeomFacet::AspectRatio(), MeshCore::MeshGeomFacet::DistancePlaneToPoint(), MeshCore::CylinderFit::GetInitialAxisFromNormals(), Base::Matrix4D::hasScale(), MeshCore::MeshGeomFacet::Roundness(), Base::CoordinateSystem::setAxes(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), Gui::LinkView::setTransform(), Part::GeomArcOfConic::setXAxisDir(), Base::CoordinateSystem::setXDirection(), and Base::CoordinateSystem::setYDirection().
◆ TransformToCoordinateSystem()
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.
- Note
- rclDirX must be perpendicular to rclDirY, i.e. rclDirX * rclDirY = 0..
Referenced by MeshCore::PlaneFit::Dimension(), SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), MeshCore::PlaneFit::GetLocalPoints(), MeshCore::SurfaceFit::PolynomFit(), and MeshCore::AbstractPolygonTriangulator::PostProcessing().
Member Data Documentation
◆ x
_Precision Base::Vector3< _Precision >::x |
x-coordinate
Referenced by PartGui::DlgRevolution::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), PartGui::TaskDlgAttacher::accept(), DrawSketchHandlerCopy::activated(), CmdSketcherConstrainLock::activated(), DrawSketchHandlerRectangularArray::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainDistanceX::activated(), CmdSketcherConstrainPerpendicular::activated(), CmdSketcherConstrainAngle::activated(), 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::Sketch::addEllipse(), PartGui::FaceColors::Private::addFacesToSelection(), Mesh::MeshPy::addFacet(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Points::PointsPy::addPoints(), 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(), Part::BSplineSurfacePy::approximate(), TechDraw::DrawProjGroupItem::autoPosition(), TechDrawGui::QGIViewBalloon::balloonLabelDragged(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::BSpline::BSpline(), Part::BSplineCurvePy::buildFromPoles(), Part::BSplineCurvePy::buildFromPolesMultsKnots(), Part::BSplineSurfacePy::buildFromPolesMultsKnots(), TechDraw::CenterLine::calcEndPoints(), TechDraw::CenterLine::calcEndPoints2Lines(), TechDraw::CenterLine::calcEndPoints2Points(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeAngleValue(), DraftGui.DraftToolBar::changeXValue(), importSVG.svgHandler::characters(), MeshCore::MeshAlgorithm::CheckFacets(), Sketcher::SketchAnalysis::checkHorizontal(), MeshCore::MeshGrid::CheckPosition(), DraftGui.DraftToolBar::checkSpecialChars(), Sketcher::SketchAnalysis::checkVertical(), PathScripts.PathInspect.GCodeEditorDialog::cleanup(), TechDrawGui::TaskRichAnno::commonFeatureUpdate(), 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(), SketcherGui::ViewProviderSketch::detectPreselectionConstr(), Base::CoordinateSystem::displacement(), TechDraw::DrawViewDimension::dist2Segs(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), SketcherGui::ViewProviderSketch::doBoxSelection(), PathScripts.PostUtils.GCodeEditorDialog::done(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), SketcherGui::ViewProviderSketch::draw(), TechDrawGui::QGIViewBalloon::draw(), SketcherGui::ViewProviderSketch::drawConstraintIcons(), TechDrawGui::QGIViewPart::drawSectionLine(), TechDraw::GeometryUtils::edgeFromGeneric(), Drawing::ProjectionAlgos::execute(), PartDesign::Hole::execute(), Part::Mirroring::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::execute(), TechDraw::DrawViewDimension::execute(), Import::ImpExpDxfWrite::exportAngularDim(), Import::ImpExpDxfWrite::exportDiametricDim(), Import::ImpExpDxfWrite::exportLinearDim(), Import::ImpExpDxfWrite::exportRadialDim(), Import::ImpExpDxfWrite::exportText(), Sketcher::SketchObject::exposeInternalGeometry(), 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(), Part::GeomLine::GeomLine(), TechDrawGui::QGIViewPart::geomToPainterPath(), TechDrawGui::TaskDetail::getAnchorScene(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), Part::BSplineCurvePy::getCardinalSplineTangents(), SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), 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(), 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(), TechDrawGui::QGIWeldSymbol::getTailPoint(), TechDrawGui::QGIWeldSymbol::getTileOrigin(), PartDesign::Mirrored::getTransformations(), PartDesign::LinearPattern::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::getViewAxis(), TechDraw::DrawProjGroupItem::getViewAxis(), Fem::FemMesh::getVolume(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::getx(), Base::Matrix4D::Hat(), Part::BSplineCurvePy::interpolate(), Part::BSplineSurfacePy::interpolate(), Mesh::FacetPy::intersect(), TechDraw::DrawUtil::Intersect2d(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), cSimTool::isInside(), Part::TopoShapePy::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(), TechDraw::DrawGeomHatch::makeEdgeOverlay(), TechDrawGui::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), TechDrawGui::QGISectionLine::makeSymbolsISO(), TechDrawGui::QGISectionLine::makeSymbolsTrad(), SketcherGui::makeTangentToArcOfEllipseviaNewPoint(), SketcherGui::makeTangentToArcOfHyperbolaviaNewPoint(), SketcherGui::makeTangentToArcOfParabolaviaNewPoint(), SketcherGui::makeTangentToEllipseviaNewPoint(), Part::GeometryPy::mirror(), Part::TopoShapePy::mirror(), TechDraw::mirrorShapeVec(), DrawSketchHandlerLineSet::mouseMove(), DrawSketchHandlerExtend::mouseMove(), Base::Matrix4D::move(), SketcherGui::ViewProviderSketch::moveConstraint(), Sketcher::Sketch::movePoint(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), Gui::Dialog::Transform::on_applyButton_clicked(), PathGui::ViewProviderPath::onChanged(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), PathScripts.PathDressupHoldingTags.Tag::originAt(), 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::CurveProjectorShape::projectCurve(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::LandmarkDimension::projectPoint(), TechDraw::DrawViewPart::projectPoint(), MeshCoreFit::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Part::ConePy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::ParabolaPy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Part::TopoShapeVertexPy::PyInit(), Attacher::AttachEngine::readLinks(), SketcherGui::ViewProviderSketch::rebuildConstraintsVisual(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), Part::TopoShapePy::reflectLines(), DrawSketchHandlerExtend::releaseButton(), Robot::Robot6AxisPy::representation(), Base::AxisPy::representation(), Base::PlacementPy::representation(), Base::VectorPy::representation(), TechDraw::CosmeticVertex::Restore(), Part::Box::Restore(), TechDraw::Circle::Restore(), TechDraw::CenterLine::Restore(), TechDraw::AOC::Restore(), TechDraw::Generic::Restore(), TechDraw::Vertex::Restore(), Part::TopoShapePy::revolve(), Part::GeometryPy::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< float >::RotateY(), Base::Vector3< float >::RotateZ(), Base::Matrix4D::rotLine(), Robot::Robot6Axis::Save(), TechDraw::CosmeticVertex::Save(), Robot::Waypoint::Save(), TechDraw::Circle::Save(), TechDraw::CenterLine::Save(), TechDraw::AOC::Save(), TechDraw::Vertex::Save(), App::PropertyPlacement::Save(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), 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::SaveX3D(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), Part::TopoShapePy::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), TechDraw::DrawViewSection::sectionExec(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), SketcherGui::ViewProviderSketch::seekConstraintPosition(), Part::Part2DObject::seekTrimPoints(), Part::CylinderPy::setCenter(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::ConePy::setCenter(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), Gui::LocationWidget::setDirection(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), PartGui::DlgRevolution::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), Part::OffsetCurvePy::setOffsetDirection(), TechDraw::DrawViewBalloon::setOrigin(), Part::TopoShape::setPlacement(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPoles(), App::PropertyVector::setPyObject(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskDetail::setUiFromFeat(), TechDrawGui::TaskSectionView::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Gui::ManualAlignment::setViewingDirections(), Base::VectorPy::setx(), 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(), Mod.PartDesign.Scripts.FilletArc.Vector::sub(), Part::suggestFilletRadius(), FemGui::TaskPostDataAlongLine::TaskPostDataAlongLine(), DraftGui.DraftToolBar::taskUi(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), TechDraw::CosmeticVertex::toString(), TechDraw::Circle::toString(), TechDraw::CenterLine::toString(), TechDraw::AOC::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), Sketcher::SketchObject::trim(), PartDesign::Groove::updateAxis(), PartDesign::Revolution::updateAxis(), RobotGui::ViewProviderRobotObject::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), DrawSketchHandlerLineSet::updateTransitionData(), DraftGui.DraftToolBar::validatePoint(), 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::~Vertex().
◆ y
_Precision Base::Vector3< _Precision >::y |
y-coordinate
Referenced by PartGui::DlgRevolution::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), PartGui::TaskDlgAttacher::accept(), DrawSketchHandlerCopy::activated(), CmdSketcherConstrainLock::activated(), DrawSketchHandlerRectangularArray::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainDistanceY::activated(), CmdSketcherConstrainPerpendicular::activated(), CmdSketcherConstrainAngle::activated(), 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::Sketch::addEllipse(), PartGui::FaceColors::Private::addFacesToSelection(), Mesh::MeshPy::addFacet(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Points::PointsPy::addPoints(), 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(), Part::BSplineSurfacePy::approximate(), TechDraw::DrawProjGroupItem::autoPosition(), TechDrawGui::QGIViewBalloon::balloonLabelDragged(), TechDraw::DrawUtil::boxIntersect2d(), TechDraw::BSpline::BSpline(), Part::BSplineCurvePy::buildFromPoles(), Part::BSplineCurvePy::buildFromPolesMultsKnots(), Part::BSplineSurfacePy::buildFromPolesMultsKnots(), TechDraw::CenterLine::calcEndPoints(), TechDraw::CenterLine::calcEndPoints2Lines(), TechDraw::CenterLine::calcEndPoints2Points(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeAngleValue(), DraftGui.DraftToolBar::changeYValue(), importSVG.svgHandler::characters(), MeshCore::MeshAlgorithm::CheckFacets(), Sketcher::SketchAnalysis::checkHorizontal(), MeshCore::MeshGrid::CheckPosition(), DraftGui.DraftToolBar::checkSpecialChars(), Sketcher::SketchAnalysis::checkVertical(), PathScripts.PathInspect.GCodeEditorDialog::cleanup(), TechDrawGui::TaskRichAnno::commonFeatureUpdate(), Part::ParabolaPy::compute(), 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(), SketcherGui::ViewProviderSketch::detectPreselectionConstr(), Base::CoordinateSystem::displacement(), TechDraw::DrawViewDimension::dist2Segs(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), SketcherGui::ViewProviderSketch::doBoxSelection(), PathScripts.PostUtils.GCodeEditorDialog::done(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), SketcherGui::ViewProviderSketch::draw(), TechDrawGui::QGIViewBalloon::draw(), SketcherGui::ViewProviderSketch::drawConstraintIcons(), TechDrawGui::QGIViewPart::drawSectionLine(), TechDraw::GeometryUtils::edgeFromGeneric(), Drawing::ProjectionAlgos::execute(), PartDesign::Hole::execute(), Part::Mirroring::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::execute(), TechDraw::DrawViewDimension::execute(), Import::ImpExpDxfWrite::exportAngularDim(), Import::ImpExpDxfWrite::exportDiametricDim(), Import::ImpExpDxfWrite::exportLinearDim(), Import::ImpExpDxfWrite::exportRadialDim(), Import::ImpExpDxfWrite::exportText(), Sketcher::SketchObject::exposeInternalGeometry(), 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(), Part::GeomLine::GeomLine(), TechDrawGui::QGIViewPart::geomToPainterPath(), TechDrawGui::TaskDetail::getAnchorScene(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), Part::BSplineCurvePy::getCardinalSplineTangents(), SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), 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(), 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(), TechDrawGui::QGIWeldSymbol::getTailPoint(), TechDrawGui::QGIWeldSymbol::getTileOrigin(), PartDesign::Mirrored::getTransformations(), PartDesign::LinearPattern::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::getViewAxis(), TechDraw::DrawProjGroupItem::getViewAxis(), Fem::FemMesh::getVolume(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::gety(), Base::Matrix4D::Hat(), Part::BSplineCurvePy::interpolate(), Part::BSplineSurfacePy::interpolate(), Mesh::FacetPy::intersect(), TechDraw::DrawUtil::Intersect2d(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), cSimTool::isInside(), Part::TopoShapePy::isInside(), TechDraw::DrawViewPart::isIso(), Sketcher::SketchObject::isPointOnCurve(), TechDraw::legacyViewAxis1(), Mod.PartDesign.Scripts.FilletArc.Vector::length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), TechDraw::DrawGeomHatch::makeEdgeOverlay(), TechDrawGui::QGIArrow::makeFilledTriangle(), TechDrawGui::QGIArrow::makeForkArrow(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), TechDrawGui::QGIArrow::makeHashMark(), TechDrawGui::QGIArrow::makeOpenArrow(), TechDrawGui::QGIArrow::makePyramid(), Base::Rotation::makeRotationByAxes(), TechDrawGui::QGISectionLine::makeSymbolsISO(), TechDrawGui::QGISectionLine::makeSymbolsTrad(), SketcherGui::makeTangentToArcOfEllipseviaNewPoint(), SketcherGui::makeTangentToArcOfHyperbolaviaNewPoint(), SketcherGui::makeTangentToArcOfParabolaviaNewPoint(), SketcherGui::makeTangentToEllipseviaNewPoint(), Part::GeometryPy::mirror(), Part::TopoShapePy::mirror(), TechDraw::mirrorShapeVec(), DrawSketchHandlerLineSet::mouseMove(), DrawSketchHandlerExtend::mouseMove(), Base::Matrix4D::move(), SketcherGui::ViewProviderSketch::moveConstraint(), Sketcher::Sketch::movePoint(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), Gui::Dialog::Transform::on_applyButton_clicked(), PathGui::ViewProviderPath::onChanged(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), PathScripts.PathDressupHoldingTags.Tag::originAt(), 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::CurveProjectorShape::projectCurve(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::LandmarkDimension::projectPoint(), TechDraw::DrawViewPart::projectPoint(), MeshCoreFit::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Part::ConePy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::ParabolaPy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::TopoShapeVertexPy::PyInit(), Attacher::AttachEngine::readLinks(), SketcherGui::ViewProviderSketch::rebuildConstraintsVisual(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), Part::TopoShapePy::reflectLines(), DrawSketchHandlerExtend::releaseButton(), Robot::Robot6AxisPy::representation(), Base::AxisPy::representation(), Base::PlacementPy::representation(), Base::VectorPy::representation(), TechDraw::CosmeticVertex::Restore(), Part::Box::Restore(), TechDraw::Circle::Restore(), TechDraw::CenterLine::Restore(), TechDraw::AOC::Restore(), TechDraw::Vertex::Restore(), Part::TopoShapePy::revolve(), Part::GeometryPy::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< float >::RotateX(), Base::Vector3< float >::RotateZ(), Base::Matrix4D::rotLine(), Robot::Robot6Axis::Save(), TechDraw::CosmeticVertex::Save(), Robot::Waypoint::Save(), TechDraw::Circle::Save(), TechDraw::CenterLine::Save(), TechDraw::AOC::Save(), TechDraw::Vertex::Save(), App::PropertyPlacement::Save(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), 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::SaveX3D(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), Part::TopoShapePy::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), TechDraw::DrawViewSection::sectionExec(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), SketcherGui::ViewProviderSketch::seekConstraintPosition(), Part::Part2DObject::seekTrimPoints(), Part::CylinderPy::setCenter(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::ConePy::setCenter(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), Gui::LocationWidget::setDirection(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), PartGui::DlgRevolution::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), Part::OffsetCurvePy::setOffsetDirection(), TechDraw::DrawViewBalloon::setOrigin(), Part::TopoShape::setPlacement(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPoles(), App::PropertyVector::setPyObject(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskDetail::setUiFromFeat(), TechDrawGui::TaskSectionView::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Gui::ManualAlignment::setViewingDirections(), Part::GeomArcOfConic::setXAxisDir(), Base::VectorPy::sety(), 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(), Mod.PartDesign.Scripts.FilletArc.Vector::sub(), Part::suggestFilletRadius(), FemGui::TaskPostDataAlongLine::TaskPostDataAlongLine(), DraftGui.DraftToolBar::taskUi(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), TechDraw::CosmeticVertex::toString(), TechDraw::Circle::toString(), TechDraw::CenterLine::toString(), TechDraw::AOC::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), Sketcher::SketchObject::trim(), PartDesign::Groove::updateAxis(), PartDesign::Revolution::updateAxis(), RobotGui::ViewProviderRobotObject::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), DrawSketchHandlerLineSet::updateTransitionData(), DraftGui.DraftToolBar::validatePoint(), Gui::PropertyEditor::PropertyPlacementItem::value(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), Path::PathSegmentWalker::walk(), Points::PlyWriter::write(), Points::PcdWriter::write(), CDxfWrite::writeAngularDimBlock(), CDxfWrite::writeDiametricDimBlock(), PartGui::DlgExtrusion::writeParametersToFeature(), and CDxfWrite::writeRadialDimBlock().
◆ z
_Precision Base::Vector3< _Precision >::z |
z-coordinate
Referenced by PartGui::DlgRevolution::accept(), ReenGui::FitBSplineSurfaceWidget::accept(), PartGui::TaskDlgAttacher::accept(), CmdSketcherConstrainAngle::activated(), Mod.PartDesign.Scripts.FilletArc.Vector::add(), Base::InventorBuilder::addBoundingBox(), Mesh::MeshPy::addFacet(), MeshCore::MeshFastBuilder::AddFacet(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Points::PointsPy::addPoints(), 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(), Part::BSplineSurfacePy::approximate(), 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(), ifc4.ifcsurfaceofrevolution::axisline(), ifc2x3.ifcrevolvedareasolid::axisline(), ifc4.ifcrevolvedareasolid::axisline(), PathScripts.PathDressupHoldingTags.Tag::bottom(), Part::BSplineCurvePy::buildFromPoles(), Part::BSplineCurvePy::buildFromPolesMultsKnots(), Part::BSplineSurfacePy::buildFromPolesMultsKnots(), TechDraw::CenterLine::calcEndPoints2Points(), MeshGui::ViewProviderMeshTransformDemolding::calcNormalVector(), Attacher::AttachEngine3D::calculateAttachedPlacement(), Attacher::AttachEngineLine::calculateAttachedPlacement(), TechDraw::CenterLine::CenterLine(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), DraftGui.DraftToolBar::changeAngleValue(), DraftGui.DraftToolBar::changeZValue(), MeshCore::MeshGrid::CheckPosition(), DraftGui.DraftToolBar::checkSpecialChars(), PathScripts.PathDressupTag.TagSolid::cloneAt(), Part::ParabolaPy::compute(), 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(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), Mod.PartDesign.Scripts.FilletArc.Vector::dot(), SketcherGui::ViewProviderSketch::drawConstraintIcons(), TechDraw::GeometryUtils::edgeFromGeneric(), Drawing::ProjectionAlgos::execute(), PartDesign::Hole::execute(), Part::Mirroring::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::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(), Part::GeomLine::GeomLine(), PartDesign::ProfileBased::getAxis(), Fem::Constraint::getBasePoint(), Part::BSplineCurvePy::getCardinalSplineTangents(), 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(), 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(), PartDesign::Mirrored::getTransformations(), PartDesign::LinearPattern::getTransformations(), PartDesign::PolarPattern::getTransformations(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationWidget::getUserDirection(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), TechDraw::getViewAxis(), TechDraw::DrawProjGroupItem::getViewAxis(), Fem::FemMesh::getVolume(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::getz(), Base::Matrix4D::Hat(), Part::BSplineCurvePy::interpolate(), Part::BSplineSurfacePy::interpolate(), Mesh::FacetPy::intersect(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), TechDraw::AOC::intersectsArc(), TechDraw::BSpline::intersectsArc(), MeshCore::MeshGeomFacet::IntersectWithFacet(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), cSimTool::isInside(), Part::TopoShapePy::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(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), Base::Rotation::makeRotationByAxes(), Part::GeometryPy::mirror(), Part::TopoShapePy::mirror(), TechDraw::mirrorShapeVec(), Base::Matrix4D::move(), TechDraw::moveShape(), Mod.PartDesign.Scripts.FilletArc.Vector::mult(), Mod.PartDesign.Scripts.FilletArc.Vector::norm(), MeshPart::MeshAlgos::offsetSpecial(), Mesh::MeshObject::offsetSpecial(), Gui::Dialog::Transform::on_applyButton_clicked(), PathGui::ViewProviderPath::onChanged(), Gui::ViewProviderOrigin::onChanged(), Fem::FemPostDataAlongLineFilter::onChanged(), PathGui::PathSelectionObserver::onSelectionChanged(), 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::CurveProjectorShape::projectCurve(), MeshPart::CurveProjectorSimple::projectCurve(), MeshPart::MeshProjection::projectEdgeToEdge(), TechDraw::LandmarkDimension::projectPoint(), TechDraw::DrawViewPart::projectPoint(), MeshCoreFit::SphereFit::ProjectToSphere(), MeshCore::SphereFit::ProjectToSphere(), CDxfWrite::putArrow(), CDxfWrite::putText(), Part::TopoShapeVertexPy::PyInit(), Part::ConePy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::ParabolaPy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Attacher::AttachEngine::readLinks(), SketcherGui::ViewProviderSketch::rebuildConstraintsVisual(), Sketcher::SketchObject::rebuildExternalGeometry(), Path::Toolpath::recalculate(), PathGui::ViewProviderPath::recomputeBoundingBox(), Part::TopoShapePy::reflectLines(), Robot::Robot6AxisPy::representation(), Base::AxisPy::representation(), Base::PlacementPy::representation(), Base::VectorPy::representation(), TechDraw::CosmeticVertex::Restore(), Part::Box::Restore(), TechDraw::Circle::Restore(), TechDraw::CenterLine::Restore(), TechDraw::AOC::Restore(), TechDraw::Vertex::Restore(), Part::TopoShapePy::revolve(), Part::GeometryPy::rotate(), TechDraw::DrawViewSection::rotateCSArbitrary(), Base::Vector3< float >::RotateX(), Base::Vector3< float >::RotateY(), Base::Matrix4D::rotLine(), Robot::Robot6Axis::Save(), TechDraw::CosmeticVertex::Save(), Robot::Waypoint::Save(), TechDraw::Circle::Save(), TechDraw::CenterLine::Save(), TechDraw::AOC::Save(), TechDraw::Vertex::Save(), App::PropertyPlacement::Save(), Part::GeomLine::Save(), Part::GeomLineSegment::Save(), MeshCore::MeshOutput::SaveAsciiPLY(), MeshCore::MeshOutput::SaveAsciiSTL(), 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::SaveX3D(), MeshCore::MeshOutput::SaveXML(), Base::Matrix4D::scale(), Part::TopoShapePy::scale(), TechDraw::CenterLine::scaledGeometry(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), TechDraw::DrawViewSection::sectionExec(), Part::CylinderPy::setCenter(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::ConePy::setCenter(), Part::GeomConic::setCenter(), Part::GeomArcOfConic::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), MeshPartGui::ViewProviderCrossSections::setCoords(), PartGui::DlgExtrusion::setDir(), Gui::LocationWidget::setDirection(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), PartGui::DlgRevolution::setDirection(), Gui::LocationUi< Ui >::setDirection(), Gui::LocationImpUi< Ui >::setDirection(), RobotGui::ViewProviderRobotObject::setDragger(), Path::Command::setFromPlacement(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::GeomConic::setLocation(), Part::GeomArcOfConic::setLocation(), Part::GeomEllipse::setMajorAxisDir(), Part::GeomArcOfEllipse::setMajorAxisDir(), Part::GeomArcOfHyperbola::setMajorAxisDir(), Part::OffsetCurvePy::setOffsetDirection(), Part::TopoShape::setPlacement(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPoles(), App::PropertyVector::setPyObject(), Gui::Dialog::Transform::setTransformStrategy(), TechDrawGui::TaskSectionView::setUiEdit(), TechDrawGui::TaskSectionView::setUiPrimary(), PartDesign::Pipe::setupAlgorithm(), MeshCoreFit::SphereFit::setupObservation(), MeshCoreFit::CylinderFit::setupObservation(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyPlacementItem::setValue(), Gui::ManualAlignment::setViewingDirections(), Part::GeomArcOfConic::setXAxisDir(), Base::VectorPy::setz(), 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(), DraftGui.DraftToolBar::taskUi(), Base::Matrix4D::toAxisAngle(), Gui::View3DInventorViewer::toggleClippingPlane(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PathScripts.PathDressupHoldingTags.Tag::top(), PartGui::Location::toPlacement(), TechDraw::DrawUtil::toR3(), TechDraw::CosmeticVertex::toString(), TechDraw::Circle::toString(), TechDraw::CenterLine::toString(), TechDraw::AOC::toString(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Path::Command::transform(), MeshCore::SurfaceFit::Transform(), PartDesign::Groove::updateAxis(), PartDesign::Revolution::updateAxis(), RobotGui::ViewProviderRobotObject::updateData(), FemGui::ViewProviderFemConstraintForce::updateData(), FemGui::ViewProviderFemConstraintPulley::updateData(), FemGui::ViewProviderFemConstraintGear::updateData(), FemGui::ViewProviderFemConstraintFluidBoundary::updateData(), FemGui::ViewProviderFemConstraintTransform::updateData(), FemGui::ViewProviderFemPostPlaneFunction::updateData(), FemGui::ViewProviderFemPostSphereFunction::updateData(), DraftGui.DraftToolBar::updateSnapper(), Gui::ViewProviderDragger::updateTransform(), DraftGui.DraftToolBar::validatePoint(), 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().
The documentation for this class was generated from the following files:
- src/Base/Vector3D.h
- src/Base/Vector3D.cpp