The Vector Base class. More...
#include <Vector3D.h>
Public Types | |
typedef _Precision | num_type |
typedef float_traits< num_type > | traits_type |
Public Member Functions | |
void | Set (_Precision fX, _Precision fY, _Precision fZ) |
Vector3 (const Vector3< _Precision > &rcVct) | |
Construction. | |
Vector3 (_Precision fx=0.0f, _Precision fy=0.0f, _Precision fz=0.0f) | |
Construction. | |
Mathematics | |
_Precision | DistanceToLine (const Vector3 &rclBase, const Vector3 &rclDirect) const |
Computes the distance from this point to the line given by rclBase and rclDirect. | |
_Precision | DistanceToPlane (const Vector3 &rclBase, const Vector3 &rclNorm) const |
Computes the distance to the given plane. | |
_Precision | GetAngle (const Vector3 &rcVect) const |
Get angle between both vectors. The returned value lies in the interval [0,pi]. | |
_Precision | Length (void) const |
Length of the vector. | |
Vector3 & | Normalize (void) |
Set length to 1. | |
Vector3 | Perpendicular (const Vector3 &rclBase, const Vector3 &rclDir) const |
Get the perpendicular of this point to the line defined by rclBase and rclDir. | |
Vector3 & | ProjToLine (const Vector3 &rclPoint, const Vector3 &rclLine) |
Projects this point onto the line given by the base rclPoint and the direction rclLine. | |
Vector3 & | ProjToPlane (const Vector3 &rclBase, const Vector3 &rclNorm) |
Projects this point onto the plane given by the base rclBase and the normal rclNorm. | |
_Precision | Sqr (void) const |
Squared length of the vector. | |
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. | |
Modification | |
void | Move (_Precision fX, _Precision fY, _Precision fZ) |
void | MoveX (_Precision f) |
void | MoveY (_Precision f) |
void | MoveZ (_Precision f) |
void | RotateX (_Precision f) |
void | RotateY (_Precision f) |
void | RotateZ (_Precision f) |
void | Scale (_Precision fX, _Precision fY, _Precision fZ) |
void | ScaleX (_Precision f) |
void | ScaleY (_Precision f) |
void | ScaleZ (_Precision f) |
Operator | |
bool | operator!= (const Vector3< _Precision > &rcVct) const |
Comparing for inequality. | |
Vector3 | operator% (const Vector3< _Precision > &rcVct) const |
Cross product. | |
Vector3 | operator& (const Vector3< _Precision > &rcVct) const |
_Precision | operator* (const Vector3< _Precision > &rcVct) const |
Scalar product. | |
Vector3 | operator* (_Precision fScale) const |
Vector scaling. | |
Vector3 & | operator*= (_Precision fScale) |
Vector3 | operator+ (const Vector3< _Precision > &rcVct) const |
Vector addition. | |
Vector3 & | operator+= (const Vector3< _Precision > &rcVct) |
Vector summation. | |
Vector3 | operator- (void) const |
Negative vector. | |
Vector3 | operator- (const Vector3< _Precision > &rcVct) const |
Vector subtraction. | |
Vector3 & | operator-= (const Vector3< _Precision > &rcVct) |
Vector subtraction. | |
Vector3 | operator/ (_Precision fDiv) const |
Vector3 & | operator/= (_Precision fDiv) |
Vector3 & | operator= (const Vector3< _Precision > &rcVct) |
Assignment. | |
bool | operator== (const Vector3< _Precision > &rcVct) const |
Comparing for equality. | |
const _Precision & | operator[] (unsigned short usIndex) const |
Returns a const reference to a coordinate. usIndex must be in the range [0,2]. | |
_Precision & | operator[] (unsigned short usIndex) |
Returns a reference to a coordinate. usIndex must be in the range [0,2]. | |
Static Public Member Functions | |
static num_type | epsilon () |
Public Attributes | |
Public data members | |
_Precision | x |
x-coordinate | |
_Precision | y |
y-coordinate | |
_Precision | z |
z-coordinate |
The Vector Base class.
Definition at line 75 of file Vector3D.h.
typedef _Precision Base::Vector3< _Precision >::num_type |
Definition at line 78 of file Vector3D.h.
typedef float_traits<num_type> Base::Vector3< _Precision >::traits_type |
Definition at line 79 of file Vector3D.h.
Vector3::Vector3 | ( | _Precision | fx = 0.0f , |
|
_Precision | fy = 0.0f , |
|||
_Precision | fz = 0.0f | |||
) | [inline, explicit] |
Construction.
Definition at line 30 of file Vector3D.cpp.
Referenced by Base::Vector3< _Precision >::DistanceToLine(), and Base::Vector3< _Precision >::operator-().
Vector3::Vector3 | ( | const Vector3< _Precision > & | rcVct | ) | [inline] |
Construction.
Definition at line 38 of file Vector3D.cpp.
_Precision Vector3::DistanceToLine | ( | const Vector3< _Precision > & | rclBase, | |
const Vector3< _Precision > & | rclDirect | |||
) | const [inline] |
Computes the distance from this point to the line given by rclBase and rclDirect.
Definition at line 215 of file Vector3D.cpp.
References Base::Vector3< _Precision >::Length(), and Base::Vector3< _Precision >::Vector3().
Referenced by Base::VectorPy::distanceToLine(), MeshCore::MeshGeomFacet::IsPointOf(), and MeshCore::MeshTopoAlgorithm::SplitFacet().
_Precision Vector3::DistanceToPlane | ( | const Vector3< _Precision > & | rclBase, | |
const Vector3< _Precision > & | rclNorm | |||
) | const [inline] |
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.
Definition at line 202 of file Vector3D.cpp.
Referenced by MeshCore::MeshGeomFacet::DistancePlaneToPoint(), Base::VectorPy::distanceToPlane(), Inspection::InspectNominalFastMesh::getDistance(), Inspection::InspectNominalMesh::getDistance(), MeshCore::MeshAlgorithm::GetFacetsFromPlane(), and MeshCore::MeshGeomFacet::IntersectWithPlane().
static num_type Base::Vector3< _Precision >::epsilon | ( | ) | [inline, static] |
Definition at line 80 of file Vector3D.h.
Referenced by Base::Vector3< float >::epsilon(), MeshCore::MeshAlgorithm::GetFacetsFromToolMesh(), Base::Vector3< _Precision >::operator==(), and MeshCore::MeshAlgorithm::Surround().
_Precision Vector3::GetAngle | ( | const Vector3< _Precision > & | rcVect | ) | const [inline] |
Get angle between both vectors. The returned value lies in the interval [0,pi].
Definition at line 351 of file Vector3D.cpp.
References KDL::acos(), SketcherExample::f, and Base::Vector3< _Precision >::Length().
Referenced by Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), MeshCore::MeshGeomFacet::Enlarge(), MeshCore::MeshGeomFacet::Foraminate(), Base::VectorPy::getAngle(), MeshCore::MeshGeomFacet::MaximumAngle(), DrawSketchHandlerFillet::releaseButton(), MeshCore::MeshFixDegeneratedFacets::RemoveEdgeTooSmall(), and MeshCore::MeshTopoAlgorithm::ShouldSwapEdge().
_Precision Vector3::Length | ( | void | ) | const [inline] |
Length of the vector.
Definition at line 209 of file Vector3D.cpp.
References KDL::sqrt(), Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by CmdSketcherConstrainDistance::activated(), Routines::CalcAngle(), Gui::LocationInterfaceComp< Ui_DlgPrimitives >::directionActivated(), Base::Vector3< _Precision >::DistanceToLine(), MeshCore::MeshEigensystem::Evaluate(), Mesh::SegmentByMesh::execute(), Sketcher::SketchObject::fillet(), Base::Vector3< _Precision >::GetAngle(), getBoundary_Conditions(), MeshCore::SurfaceFit::GetCurvatureInfo(), MeshCore::QuadraticFit::GetCurvatureInfo(), Base::VectorPy::getLength(), Robot::Trajectory::getVelocity(), Base::BoundBox3< _Precision >::IsCutLine(), MeshCore::MeshGeomFacet::IsPointOfFace(), MeshCore::MeshAlgorithm::IsVertexVisible(), makeFilletArc(), SketcherGui::ViewProviderSketch::moveConstraint(), Base::VectorPy::normalize(), Base::Vector3< _Precision >::Normalize(), SpringbackCorrection::RegionEvaluate(), DrawSketchHandlerFillet::releaseButton(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Gui::LocationInterfaceComp< Ui_DlgPrimitives >::setDirection(), Base::VectorPy::setLength(), Base::Rotation::setValue(), MeshCore::MeshTopoAlgorithm::SnapVertex(), MeshCore::MeshGeomFacet::SubSample(), and UniGridApprox::SurfMeshParam().
void Vector3::Move | ( | _Precision | fX, | |
_Precision | fY, | |||
_Precision | fZ | |||
) | [inline] |
Definition at line 295 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
void Vector3::MoveX | ( | _Precision | f | ) | [inline] |
Definition at line 277 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x.
void Vector3::MoveY | ( | _Precision | f | ) | [inline] |
Definition at line 283 of file Vector3D.cpp.
References Base::Vector3< _Precision >::y.
void Vector3::MoveZ | ( | _Precision | f | ) | [inline] |
Definition at line 289 of file Vector3D.cpp.
References Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::Normalize | ( | void | ) | [inline] |
Set length to 1.
Definition at line 339 of file Vector3D.cpp.
References SketcherExample::f, Base::Vector3< _Precision >::Length(), Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), MeshCore::MeshTopoAlgorithm::AdjustEdgesToCurvatureDirection(), MeshCore::MeshGeomFacet::CalcNormal(), best_fit::Comp_Normals(), MeshCore::MeshGeomFacet::Enlarge(), SpringbackCorrection::FaceCheck(), MeshCore::MeshFixDeformedFacets::Fixup(), Part::TopoShape::getFacesFromSubelement(), MeshCore::MeshAlgorithm::GetFacetsFromPlane(), MeshCore::MeshKernel::GetNormal(), MeshCore::MeshRefPointToPoints::GetNormal(), MeshCore::MeshRefPointToFacets::GetNormal(), Mesh::MeshObject::getPointNormal(), SpringbackCorrection::InitFaceCheck(), MeshCore::MeshGeomFacet::IsDeformed(), makeFilletArc(), MeshPart::CurveProjectorWithToolMesh::makeToolMesh(), Base::VectorPy::normalize(), offset_mesh(), MeshPart::MeshAlgos::offsetSpecial(), Mesh::MeshObject::offsetSpecial(), MeshPart::MeshAlgos::offsetSpecial2(), Base::Matrix4D::rotLine(), MeshCore::MeshGeomFacet::SetNormal(), Base::Rotation::setValue(), MeshCore::MeshSmoothing::Smooth(), SpringbackCorrection::SmoothMesh(), MeshCore::MeshGeomFacet::SubSample(), Base::Matrix4D::toAxisAngle(), Base::Vector3< _Precision >::TransformToCoordinateSystem(), and MeshVRML::WriteVRMLViewpoints().
bool Vector3::operator!= | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Comparing for inequality.
Definition at line 179 of file Vector3D.cpp.
Vector3< _Precision > Vector3::operator% | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Cross product.
Definition at line 169 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator& | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Definition at line 80 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
_Precision Vector3::operator* | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Scalar product.
Definition at line 163 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator* | ( | _Precision | fScale | ) | const [inline] |
Vector scaling.
Definition at line 142 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator*= | ( | _Precision | fScale | ) | [inline] |
Definition at line 124 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator+ | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Vector addition.
Definition at line 70 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator+= | ( | const Vector3< _Precision > & | rcVct | ) | [inline] |
Vector summation.
Definition at line 106 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator- | ( | void | ) | const [inline] |
Negative vector.
Definition at line 100 of file Vector3D.cpp.
References Base::Vector3< _Precision >::Vector3(), Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator- | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Vector subtraction.
Definition at line 90 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator-= | ( | const Vector3< _Precision > & | rcVct | ) | [inline] |
Vector subtraction.
Definition at line 115 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::operator/ | ( | _Precision | fDiv | ) | const [inline] |
Definition at line 148 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator/= | ( | _Precision | fDiv | ) | [inline] |
Definition at line 133 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > & Vector3::operator= | ( | const Vector3< _Precision > & | rcVct | ) | [inline] |
Assignment.
Reimplemented in MeshCore::MeshPoint.
Definition at line 154 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
bool Vector3::operator== | ( | const Vector3< _Precision > & | rcVct | ) | const [inline] |
Comparing for equality.
Reimplemented in MeshCore::MeshPoint.
Definition at line 185 of file Vector3D.cpp.
References Base::Vector3< _Precision >::epsilon(), epsilon, Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
const _Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) | const [inline] |
Returns a const reference to a coordinate. usIndex must be in the range [0,2].
Definition at line 58 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
_Precision & Vector3::operator[] | ( | unsigned short | usIndex | ) | [inline] |
Returns a reference to a coordinate. usIndex must be in the range [0,2].
Definition at line 46 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Vector3< _Precision > Vector3::Perpendicular | ( | const Vector3< _Precision > & | rclBase, | |
const Vector3< _Precision > & | rclDir | |||
) | const [inline] |
Get the perpendicular of this point to the line defined by rclBase and rclDir.
Note: Do not mix up this method with ProjToLine.
Definition at line 229 of file Vector3D.cpp.
References RobotExample::t.
Vector3< _Precision > & Vector3::ProjToLine | ( | const Vector3< _Precision > & | rclPoint, | |
const Vector3< _Precision > & | rclLine | |||
) | [inline] |
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.
Definition at line 222 of file Vector3D.cpp.
Referenced by SketcherGui::ViewProviderSketch::draw(), MeshCore::MeshEigensystem::Evaluate(), Sketcher::SketchObject::fillet(), SketcherGui::ViewProviderSketch::moveConstraint(), Base::VectorPy::projectToLine(), and SketcherGui::DrawSketchHandler::seekAutoConstraint().
Vector3< _Precision > & Vector3::ProjToPlane | ( | const Vector3< _Precision > & | rclBase, | |
const Vector3< _Precision > & | rclNorm | |||
) | [inline] |
Projects this point onto the plane given by the base rclBase and the normal rclNorm.
Definition at line 193 of file Vector3D.cpp.
Referenced by Base::BoundBox3< _Precision >::NearestPoint(), MeshCore::MeshGeomFacet::ProjectPointToPlane(), Base::VectorPy::projectToPlane(), and PartGui::ViewProviderMirror::setEdit().
void Vector3::RotateX | ( | _Precision | f | ) | [inline] |
Definition at line 303 of file Vector3D.cpp.
References KDL::cos(), KDL::sin(), Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
void Vector3::RotateY | ( | _Precision | f | ) | [inline] |
Definition at line 315 of file Vector3D.cpp.
References KDL::cos(), KDL::sin(), Base::Vector3< _Precision >::x, and Base::Vector3< _Precision >::z.
void Vector3::RotateZ | ( | _Precision | f | ) | [inline] |
Definition at line 327 of file Vector3D.cpp.
References KDL::cos(), KDL::sin(), Base::Vector3< _Precision >::x, and Base::Vector3< _Precision >::y.
void Vector3::Scale | ( | _Precision | fX, | |
_Precision | fY, | |||
_Precision | fZ | |||
) | [inline] |
Definition at line 269 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), MeshCore::MeshGeomFacet::Enlarge(), UniGridApprox::MeshOffset(), Base::VectorPy::multiply(), Base::VectorPy::scale(), MeshCore::MeshSmoothing::Smooth(), and SpringbackCorrection::SmoothMesh().
void Vector3::ScaleX | ( | _Precision | f | ) | [inline] |
Definition at line 251 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x.
void Vector3::ScaleY | ( | _Precision | f | ) | [inline] |
Definition at line 257 of file Vector3D.cpp.
References Base::Vector3< _Precision >::y.
void Vector3::ScaleZ | ( | _Precision | f | ) | [inline] |
Definition at line 263 of file Vector3D.cpp.
References Base::Vector3< _Precision >::z.
void Vector3::Set | ( | _Precision | fX, | |
_Precision | fY, | |||
_Precision | fZ | |||
) | [inline] |
Definition at line 243 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by Base::InventorBuilder::addBoundingBox(), Mesh::MeshPy::addFacets(), SpringbackCorrection::CalcCurv(), calcMeshVolume(), Base::BoundBox3< _Precision >::CalcPlane(), checkBB(), MeshCore::MeshAlgorithm::CheckFacets(), best_fit::Comp_Normals(), MeshCore::Approximation::Convert(), MeshPart::Mesher::createMesh(), MeshGui::ViewProviderMesh::createToolMesh(), MeshCore::MeshGeomFacet::DistanceToPoint(), Mesh::Facet::Facet(), MeshCore::PlaneFit::Fit(), fit_iter(), getBoundary_Conditions(), Base::Rotation::getValue(), best_fit::Initialize_Mesh_Geometrie_1(), best_fit::Initialize_Mesh_Geometrie_2(), MeshCore::MeshGeomFacet::IntersectWithPlane(), MeshCore::MeshInput::LoadAsciiSTL(), minBoundingBox(), Mesh::MeshPointPy::move(), Base::MatrixPy::move(), offset_mesh(), Base::VectorPy::PyInit(), Base::MatrixPy::scale(), MeshGui::ViewProviderMeshDegenerations::showDefects(), SMESH_PCA(), MeshCore::MeshSmoothing::Smooth(), SpringbackCorrection::SmoothMesh(), best_fit::Tesselate_Face(), best_fit::Tesselate_Shape(), tesselateShape(), SpringbackCorrection::TransferFaceTriangulationtoFreeCAD(), Base::MatrixPy::transform(), Fem::FemMesh::transformGeometry(), and Fem::FemMesh::writeABAQUS().
_Precision Vector3::Sqr | ( | void | ) | const [inline] |
Squared length of the vector.
Definition at line 237 of file Vector3D.cpp.
References Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by MeshCore::MeshGeomFacet::SetNormal().
void Vector3::TransformToCoordinateSystem | ( | const Vector3< _Precision > & | rclBase, | |
const Vector3< _Precision > & | rclDirX, | |||
const Vector3< _Precision > & | rclDirY | |||
) | [inline] |
Transforms this point to the coordinate system defined by origin rclBase, vector vector rclDirX and vector vector rclDirY.
Definition at line 371 of file Vector3D.cpp.
References Base::Vector3< _Precision >::Normalize(), Base::Vector3< _Precision >::x, Base::Vector3< _Precision >::y, and Base::Vector3< _Precision >::z.
Referenced by SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), MeshCore::SurfaceFit::PolynomFit(), and MeshCore::AbstractPolygonTriangulator::ProjectOntoSurface().
_Precision Base::Vector3< _Precision >::x |
x-coordinate
Definition at line 84 of file Vector3D.h.
Referenced by CmdPartSimpleCylinder::activated(), CmdSketcherConstrainAngle::activated(), CmdSketcherConstrainDistanceX::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainLock::activated(), CmdSketcherNewSketch::activated(), CmdApproxPlane::activated(), Base::BoundBox3< _Precision >::Add(), Sketcher::Sketch::addArc(), Base::InventorBuilder::addBoundingBox(), Sketcher::Sketch::addCircle(), Mesh::MeshPy::addFacet(), Mesh::MeshPy::addFacets(), Sketcher::Sketch::addLineSegment(), Sketcher::Sketch::addPoint(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Base::InventorBuilder::addPoint(), Base::Builder3D::addPoint(), Points::PointsPy::addPoints(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleLine(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSinglePoint(), Base::InventorBuilder::addSingleTriangle(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addText(), Base::Builder3D::addText(), Base::InventorBuilder::addTransformation(), Base::Builder3D::addTransformation(), Part::BSplineCurvePy::approximate(), Routines::AreaTriangle(), best_fit_test(), Base::BoundBox3< _Precision >::BoundBox3(), Part::BSplineCurvePy::buildFromPoles(), SpringbackCorrection::CalcCurv(), calcMeshVolume(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), MeshCore::MeshAlgorithm::CheckFacets(), MeshCore::MeshGrid::CheckPosition(), best_fit::Comp_Normals(), UniGridApprox::CompMeshError(), MeshGui::SoFCMeshObjectBoundary::computeBBox(), MeshGui::SoFCMeshSegmentShape::computeBBox(), MeshGui::SoFCMeshObjectShape::computeBBox(), MeshGui::SoFCMeshOpenEdge::computeBBox(), MeshGui::SoFCMeshNode::computeBBox(), MeshGui::SoFCMeshOpenEdgeSet::computeBBox(), MeshGui::SoFCMeshFaceSet::computeBBox(), path_simulate::ConnectPaths_Feat(), path_simulate::ConnectPaths_xy(), path_simulate::ConnectPaths_z(), MeshCore::Approximation::Convert(), path_simulate::Correction(), Mesh::GTSAlgos::createGTSSurface(), Mesh::MeshPy::crossSections(), MeshCore::MeshInfo::DetailedEdgeInfo(), Base::Distance(), Base::DistanceP2(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), SketcherGui::ViewProviderSketch::draw(), Drawing::ProjectionAlgos::execute(), PartDesign::Revolution::execute(), Part::Revolution::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::execute(), Part::Mirroring::execute(), Part::Extrusion::execute(), Part::TopoShapePy::extrude(), MeshGui::ViewProviderMesh::faceInfo(), Mesh::Facet::Facet(), Sketcher::SketchObjectPy::fillet(), fit_iter(), Mesh::MeshPy::foraminate(), Base::Placement::fromMatrix(), MeshGui::SoFCMeshSegmentShape::generatePrimitives(), MeshGui::SoFCMeshObjectShape::generatePrimitives(), MeshGui::SoFCMeshNode::generatePrimitives(), MeshGui::SoFCMeshFaceSet::generatePrimitives(), Deviation::GenNormals(), Part::GeomLine::GeomLine(), Part::GeomPoint::GeomPoint(), getBoundary_Conditions(), SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), SpringbackCorrection::GetCurvature(), Inspection::InspectNominalShape::getDistance(), Inspection::InspectNominalPoints::getDistance(), MeshCore::MeshKernel::GetGravityPoint(), Base::BoundBox3< _Precision >::GetOctantFromVector(), Mesh::MeshObject::getPoint(), Inspection::InspectActualPoints::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::FacetPy::getPoints(), Base::BoundBox3< _Precision >::GetSideFromRay(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::getx(), glNormal(), glVertex(), import_NASTRAN(), Part::BezierCurvePy::insertPoleAfter(), Part::BezierCurvePy::insertPoleBefore(), Part::BezierSurfacePy::insertPoleColAfter(), Part::BezierSurfacePy::insertPoleColBefore(), Part::BezierSurfacePy::insertPoleRowAfter(), Part::BezierSurfacePy::insertPoleRowBefore(), Mesh::MeshPy::insertVertex(), Part::BSplineCurvePy::interpolate(), Mesh::FacetPy::intersect(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), SketcherGui::ViewProviderSketch::isConstraintAtPosition(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), Part::TopoShapePy::isInside(), MeshCore::MeshGeomFacet::IsPointOf(), Base::Vector3< _Precision >::Length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), MeshPart::MeshAlgos::LoftOnCurve(), makeBox(), makeCircle(), makeCone(), makeCylinder(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), makeLine(), path_simulate::MakePathSingle(), makePlane(), makePolygon(), makeRevolution(), makeSphere(), makeTorus(), makeWedge(), UniGridApprox::MatComp(), best_fit::MeshFit_Coarse(), UniGridApprox::MeshOffset(), minBoundingBox(), Part::TopoShapePy::mirror(), Part::GeometryPy::mirror(), Base::Vector3< _Precision >::Move(), Base::MatrixPy::move(), Base::Matrix4D::move(), Base::BoundBoxPy::move(), SketcherGui::ViewProviderSketch::moveConstraint(), Sketcher::Sketch::movePoint(), Mesh::MeshObject::movePoint(), Part::BSplineSurfacePy::movePoint(), Part::BSplineCurvePy::movePoint(), Base::Vector3< _Precision >::MoveX(), Base::Rotation::multVec(), Mesh::MeshPy::nearestFacetOnRay(), MeshCore::MeshSearchNeighbours::NeighboursFromSampledFacets(), Base::Vector3< _Precision >::Normalize(), Gui::Dialog::Transform::on_applyButton_clicked(), Base::Vector3< _Precision >::operator%(), Base::Vector3< _Precision >::operator&(), Base::BoundBox3< _Precision >::operator&=(), Gui::ViewVolumeProjection::operator()(), MeshCore::Triangulation::Vertex2d_EqualTo::operator()(), MeshCore::Triangulation::Vertex2d_Less::operator()(), MeshPntLess::operator()(), Base::operator*(), Base::Vector3< _Precision >::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator*=(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator+=(), Base::Vector3< _Precision >::operator-(), Base::Vector3< _Precision >::operator-=(), Base::Vector3< _Precision >::operator/(), Base::Vector3< _Precision >::operator/=(), MeshCore::MeshHelpPoint::operator<(), MeshCore::MeshPoint::operator<(), Base::Vector3< _Precision >::operator=(), Base::Vector3< _Precision >::operator==(), Base::Vector3< _Precision >::operator[](), Part::GeometrySurfacePy::parameter(), Part::GeometryCurvePy::parameter(), MeshGui::SoFCMeshPickNode::pick(), best_fit::PointCloud_Coarse(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), project(), Base::BoundBox3< _Precision >::ProjectBox(), MeshPart::CurveProjectorSimple::projectCurve(), projectEx(), projectToDXF(), projectToSVG(), Part::TopoShapeVertexPy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::PlanePy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::LinePy::PyInit(), Part::HyperbolaPy::PyInit(), Part::EllipsePy::PyInit(), Part::CylinderPy::PyInit(), Part::ConePy::PyInit(), Part::CirclePy::PyInit(), Part::ArcPy::PyInit(), Part::ArcOfCirclePy::PyInit(), MeshGui::SoSFMeshPointArray::read1Value(), DrawSketchHandlerLineSet::releaseButton(), Robot::WaypointPy::representation(), Base::VectorPy::representation(), Base::PlacementPy::representation(), Part::LinePy::representation(), Mesh::FacetPy::representation(), App::PropertyVector::Restore(), Part::Box::Restore(), Part::TopoShapePy::revolve(), Base::Vector3< _Precision >::RotateY(), Base::Vector3< _Precision >::RotateZ(), Base::Matrix4D::rotLine(), Robot::Waypoint::Save(), Robot::Robot6Axis::Save(), App::PropertyPlacement::Save(), App::PropertyVector::Save(), MeshVRML::Save(), Part::GeomLineSegment::Save(), Part::GeomLine::Save(), Part::GeomPoint::Save(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveInventor(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), MeshCore::MeshOutput::SavePLY(), MeshCore::MeshOutput::SavePython(), MeshCore::MeshOutput::SaveXML(), sbvec3f(), Base::Vector3< _Precision >::Scale(), Part::TopoShapePy::scale(), Base::MatrixPy::scale(), Base::Matrix4D::scale(), Part::GeometryPy::scale(), Base::Vector3< _Precision >::ScaleX(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Part::Part2DObject::seekTrimPoints(), Base::Vector3< _Precision >::Set(), Part::ToroidPy::setAxis(), Part::SpherePy::setAxis(), Part::PlanePy::setAxis(), Part::ParabolaPy::setAxis(), Part::HyperbolaPy::setAxis(), Part::EllipsePy::setAxis(), Part::CylinderPy::setAxis(), Part::ConePy::setAxis(), Part::CirclePy::setAxis(), Part::ArcOfCirclePy::setAxis(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::GeomArcOfCircle::setCenter(), Part::GeomCircle::setCenter(), Part::EllipsePy::setCenter(), Part::CylinderPy::setCenter(), Part::ConePy::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), Gui::LocationInterfaceComp< Ui_DlgPrimitives >::setDirection(), PartGui::ViewProviderMirror::setEdit(), Gui::ViewProviderGeometryObject::setEdit(), Part::LinePy::setEndPoint(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::ParabolaPy::setLocation(), Part::HyperbolaPy::setLocation(), Part::OffsetCurvePy::setOffsetDirection(), Part::GeomPoint::setPoint(), Part::GeomLineSegment::setPoints(), Part::GeomBSplineCurve::setPole(), Part::BSplineSurfacePy::setPole(), Part::BSplineCurvePy::setPole(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPole(), Part::BSplineSurfacePy::setPoleCol(), Part::BezierSurfacePy::setPoleCol(), Part::BSplineSurfacePy::setPoleRow(), Part::BezierSurfacePy::setPoleRow(), Part::BezierCurvePy::setPoles(), Part::PlanePy::setPosition(), App::PropertyVectorList::setPyObject(), App::PropertyVector::setPyObject(), Part::LinePy::setStartPoint(), Gui::Dialog::Transform::setTransformStrategy(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyDoubleVectorItem::setValue(), Gui::PropertyEditor::PropertyVectorItem::setValue(), Base::VectorPy::setx(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::MeshSmoothing::Smooth(), SpringbackCorrection::SmoothMesh(), Mesh::MeshPy::snapVertex(), Mesh::MeshPy::splitEdge(), Mesh::MeshPy::splitFacet(), Base::Vector3< _Precision >::Sqr(), Base::Matrix4D::toAxisAngle(), Base::Placement::toMatrix(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::DlgPrimitives::toPlacement(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Gui::PropertyEditor::PropertyDoubleVectorItem::toString(), Gui::PropertyEditor::PropertyVectorItem::toString(), Base::toVector(), Base::MatrixPy::transform(), MeshCore::MeshEigensystem::Transform(), Base::Vector3< _Precision >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), Data::ComplexGeoData::transformToOutside(), Part::TopoShapePy::translate(), Part::GeometryPy::translate(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), MeshCore::DelaunayTriangulator::Triangulate(), Sketcher::SketchObject::trim(), RobotGui::ViewProviderTrajectory::updateData(), Gui::ViewProviderMeasureDistance::updateData(), InspectionGui::ViewProviderInspection::updateData(), Gui::ViewProviderAnnotationLabel::updateData(), Gui::ViewProviderAnnotation::updateData(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), RobotGui::TaskTrajectoryDressUpParameter::viewPlacement(), Gui::View3DInventorPy::viewPosition(), MeshGui::SoSFMeshPointArray::write1Value(), Fem::FemMesh::writeABAQUS(), and MeshVRML::WriteVRMLViewpoints().
_Precision Base::Vector3< _Precision >::y |
y-coordinate
Definition at line 85 of file Vector3D.h.
Referenced by CmdPartSimpleCylinder::activated(), CmdSketcherConstrainAngle::activated(), CmdSketcherConstrainDistanceY::activated(), CmdSketcherConstrainDistance::activated(), CmdSketcherConstrainLock::activated(), CmdSketcherNewSketch::activated(), CmdApproxPlane::activated(), Base::BoundBox3< _Precision >::Add(), Sketcher::Sketch::addArc(), Base::InventorBuilder::addBoundingBox(), Sketcher::Sketch::addCircle(), Mesh::MeshPy::addFacet(), Mesh::MeshPy::addFacets(), Sketcher::Sketch::addLineSegment(), Sketcher::Sketch::addPoint(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Base::InventorBuilder::addPoint(), Base::Builder3D::addPoint(), Points::PointsPy::addPoints(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleLine(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSinglePoint(), Base::InventorBuilder::addSingleTriangle(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addText(), Base::Builder3D::addText(), Base::InventorBuilder::addTransformation(), Base::Builder3D::addTransformation(), Part::BSplineCurvePy::approximate(), Routines::AreaTriangle(), best_fit_test(), Base::BoundBox3< _Precision >::BoundBox3(), Part::BSplineCurvePy::buildFromPoles(), SpringbackCorrection::CalcCurv(), calcMeshVolume(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), MeshCore::MeshAlgorithm::CheckFacets(), MeshCore::MeshGrid::CheckPosition(), best_fit::Comp_Normals(), UniGridApprox::CompMeshError(), MeshGui::SoFCMeshObjectBoundary::computeBBox(), MeshGui::SoFCMeshSegmentShape::computeBBox(), MeshGui::SoFCMeshObjectShape::computeBBox(), MeshGui::SoFCMeshOpenEdge::computeBBox(), MeshGui::SoFCMeshNode::computeBBox(), MeshGui::SoFCMeshOpenEdgeSet::computeBBox(), MeshGui::SoFCMeshFaceSet::computeBBox(), path_simulate::ConnectPaths_Feat(), path_simulate::ConnectPaths_xy(), path_simulate::ConnectPaths_z(), MeshCore::Approximation::Convert(), path_simulate::Correction(), Mesh::GTSAlgos::createGTSSurface(), Mesh::MeshPy::crossSections(), MeshCore::MeshInfo::DetailedEdgeInfo(), Base::Distance(), Base::DistanceP2(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), SketcherGui::ViewProviderSketch::draw(), Drawing::ProjectionAlgos::execute(), PartDesign::Revolution::execute(), Part::Revolution::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::execute(), Part::Mirroring::execute(), Part::Extrusion::execute(), Part::TopoShapePy::extrude(), MeshGui::ViewProviderMesh::faceInfo(), Mesh::Facet::Facet(), Sketcher::SketchObjectPy::fillet(), fit_iter(), Mesh::MeshPy::foraminate(), Base::Placement::fromMatrix(), MeshGui::SoFCMeshSegmentShape::generatePrimitives(), MeshGui::SoFCMeshObjectShape::generatePrimitives(), MeshGui::SoFCMeshNode::generatePrimitives(), MeshGui::SoFCMeshFaceSet::generatePrimitives(), Deviation::GenNormals(), Part::GeomLine::GeomLine(), Part::GeomPoint::GeomPoint(), getBoundary_Conditions(), SketcherGui::ViewProviderSketch::getCoordsOnSketchPlane(), SpringbackCorrection::GetCurvature(), Inspection::InspectNominalShape::getDistance(), Inspection::InspectNominalPoints::getDistance(), MeshCore::MeshKernel::GetGravityPoint(), Base::BoundBox3< _Precision >::GetOctantFromVector(), Mesh::MeshObject::getPoint(), Inspection::InspectActualPoints::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::FacetPy::getPoints(), Base::BoundBox3< _Precision >::GetSideFromRay(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::gety(), glNormal(), glVertex(), import_NASTRAN(), Part::BezierCurvePy::insertPoleAfter(), Part::BezierCurvePy::insertPoleBefore(), Part::BezierSurfacePy::insertPoleColAfter(), Part::BezierSurfacePy::insertPoleColBefore(), Part::BezierSurfacePy::insertPoleRowAfter(), Part::BezierSurfacePy::insertPoleRowBefore(), Mesh::MeshPy::insertVertex(), Part::BSplineCurvePy::interpolate(), Mesh::FacetPy::intersect(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), SketcherGui::ViewProviderSketch::isConstraintAtPosition(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), Part::TopoShapePy::isInside(), MeshCore::MeshGeomFacet::IsPointOf(), Base::Vector3< _Precision >::Length(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), makeBox(), makeCircle(), makeCone(), makeCylinder(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), makeLine(), path_simulate::MakePathSingle(), makePlane(), makePolygon(), makeRevolution(), makeSphere(), makeTorus(), makeWedge(), UniGridApprox::MatComp(), best_fit::MeshFit_Coarse(), UniGridApprox::MeshOffset(), minBoundingBox(), Part::TopoShapePy::mirror(), Part::GeometryPy::mirror(), Base::Vector3< _Precision >::Move(), Base::MatrixPy::move(), Base::Matrix4D::move(), Base::BoundBoxPy::move(), SketcherGui::ViewProviderSketch::moveConstraint(), Sketcher::Sketch::movePoint(), Mesh::MeshObject::movePoint(), Part::BSplineSurfacePy::movePoint(), Part::BSplineCurvePy::movePoint(), Base::Vector3< _Precision >::MoveY(), Base::Rotation::multVec(), Mesh::MeshPy::nearestFacetOnRay(), MeshCore::MeshSearchNeighbours::NeighboursFromSampledFacets(), Base::Vector3< _Precision >::Normalize(), Gui::Dialog::Transform::on_applyButton_clicked(), Base::Vector3< _Precision >::operator%(), Base::Vector3< _Precision >::operator&(), Base::BoundBox3< _Precision >::operator&=(), Gui::ViewVolumeProjection::operator()(), MeshCore::Triangulation::Vertex2d_EqualTo::operator()(), MeshCore::Triangulation::Vertex2d_Less::operator()(), MeshPntLess::operator()(), Base::operator*(), Base::Vector3< _Precision >::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator*=(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator+=(), Base::Vector3< _Precision >::operator-(), Base::Vector3< _Precision >::operator-=(), Base::Vector3< _Precision >::operator/(), Base::Vector3< _Precision >::operator/=(), MeshCore::MeshHelpPoint::operator<(), MeshCore::MeshPoint::operator<(), Base::Vector3< _Precision >::operator=(), Base::Vector3< _Precision >::operator==(), Base::Vector3< _Precision >::operator[](), Part::GeometrySurfacePy::parameter(), Part::GeometryCurvePy::parameter(), MeshGui::SoFCMeshPickNode::pick(), best_fit::PointCloud_Coarse(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), project(), Base::BoundBox3< _Precision >::ProjectBox(), MeshPart::CurveProjectorSimple::projectCurve(), projectEx(), projectToDXF(), projectToSVG(), Part::TopoShapeVertexPy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::PlanePy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::LinePy::PyInit(), Part::HyperbolaPy::PyInit(), Part::EllipsePy::PyInit(), Part::CylinderPy::PyInit(), Part::ConePy::PyInit(), Part::CirclePy::PyInit(), Part::ArcPy::PyInit(), Part::ArcOfCirclePy::PyInit(), MeshGui::SoSFMeshPointArray::read1Value(), DrawSketchHandlerLineSet::releaseButton(), Robot::WaypointPy::representation(), Base::VectorPy::representation(), Base::PlacementPy::representation(), Part::LinePy::representation(), Mesh::FacetPy::representation(), App::PropertyVector::Restore(), Part::Box::Restore(), Part::TopoShapePy::revolve(), Base::Vector3< _Precision >::RotateX(), Base::Vector3< _Precision >::RotateZ(), Base::Matrix4D::rotLine(), Robot::Waypoint::Save(), Robot::Robot6Axis::Save(), App::PropertyPlacement::Save(), App::PropertyVector::Save(), MeshVRML::Save(), Part::GeomLineSegment::Save(), Part::GeomLine::Save(), Part::GeomPoint::Save(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveInventor(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), MeshCore::MeshOutput::SavePLY(), MeshCore::MeshOutput::SavePython(), MeshCore::MeshOutput::SaveXML(), sbvec3f(), Base::Vector3< _Precision >::Scale(), Part::TopoShapePy::scale(), Base::MatrixPy::scale(), Base::Matrix4D::scale(), Part::GeometryPy::scale(), Base::Vector3< _Precision >::ScaleY(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), SketcherGui::DrawSketchHandler::seekAutoConstraint(), Part::Part2DObject::seekTrimPoints(), Base::Vector3< _Precision >::Set(), Part::ToroidPy::setAxis(), Part::SpherePy::setAxis(), Part::PlanePy::setAxis(), Part::ParabolaPy::setAxis(), Part::HyperbolaPy::setAxis(), Part::EllipsePy::setAxis(), Part::CylinderPy::setAxis(), Part::ConePy::setAxis(), Part::CirclePy::setAxis(), Part::ArcOfCirclePy::setAxis(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::GeomArcOfCircle::setCenter(), Part::GeomCircle::setCenter(), Part::EllipsePy::setCenter(), Part::CylinderPy::setCenter(), Part::ConePy::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), Gui::LocationInterfaceComp< Ui_DlgPrimitives >::setDirection(), PartGui::ViewProviderMirror::setEdit(), Gui::ViewProviderGeometryObject::setEdit(), Part::LinePy::setEndPoint(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::ParabolaPy::setLocation(), Part::HyperbolaPy::setLocation(), Part::OffsetCurvePy::setOffsetDirection(), Part::GeomPoint::setPoint(), Part::GeomLineSegment::setPoints(), Part::GeomBSplineCurve::setPole(), Part::BSplineSurfacePy::setPole(), Part::BSplineCurvePy::setPole(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPole(), Part::BSplineSurfacePy::setPoleCol(), Part::BezierSurfacePy::setPoleCol(), Part::BSplineSurfacePy::setPoleRow(), Part::BezierSurfacePy::setPoleRow(), Part::BezierCurvePy::setPoles(), Part::PlanePy::setPosition(), App::PropertyVectorList::setPyObject(), App::PropertyVector::setPyObject(), Part::LinePy::setStartPoint(), Gui::Dialog::Transform::setTransformStrategy(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyDoubleVectorItem::setValue(), Gui::PropertyEditor::PropertyVectorItem::setValue(), Base::VectorPy::sety(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::MeshSmoothing::Smooth(), SpringbackCorrection::SmoothMesh(), Mesh::MeshPy::snapVertex(), Mesh::MeshPy::splitEdge(), Mesh::MeshPy::splitFacet(), Base::Vector3< _Precision >::Sqr(), PartDesignGui::TaskRevolutionParameters::TaskRevolutionParameters(), Base::Matrix4D::toAxisAngle(), Base::Placement::toMatrix(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::DlgPrimitives::toPlacement(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Gui::PropertyEditor::PropertyDoubleVectorItem::toString(), Gui::PropertyEditor::PropertyVectorItem::toString(), Base::toVector(), Base::MatrixPy::transform(), MeshCore::MeshEigensystem::Transform(), Base::Vector3< _Precision >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), Data::ComplexGeoData::transformToOutside(), Part::TopoShapePy::translate(), Part::GeometryPy::translate(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), MeshCore::DelaunayTriangulator::Triangulate(), Sketcher::SketchObject::trim(), RobotGui::ViewProviderTrajectory::updateData(), Gui::ViewProviderMeasureDistance::updateData(), InspectionGui::ViewProviderInspection::updateData(), Gui::ViewProviderAnnotationLabel::updateData(), Gui::ViewProviderAnnotation::updateData(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), RobotGui::TaskTrajectoryDressUpParameter::viewPlacement(), Gui::View3DInventorPy::viewPosition(), MeshGui::SoSFMeshPointArray::write1Value(), and MeshVRML::WriteVRMLViewpoints().
_Precision Base::Vector3< _Precision >::z |
z-coordinate
Definition at line 86 of file Vector3D.h.
Referenced by CmdPartSimpleCylinder::activated(), CmdSketcherNewSketch::activated(), CmdApproxPlane::activated(), Base::BoundBox3< _Precision >::Add(), Base::InventorBuilder::addBoundingBox(), Mesh::MeshPy::addFacet(), Mesh::MeshPy::addFacets(), Points::PointsGrid::AddPoint(), MeshCore::MeshPointGrid::AddPoint(), Base::InventorBuilder::addPoint(), Base::Builder3D::addPoint(), Points::PointsPy::addPoints(), Base::InventorBuilder::addSingleArrow(), Base::Builder3D::addSingleArrow(), Base::InventorBuilder::addSingleLine(), Base::Builder3D::addSingleLine(), Base::InventorBuilder::addSinglePlane(), Base::Builder3D::addSinglePoint(), Base::InventorBuilder::addSingleTriangle(), Base::Builder3D::addSingleTriangle(), Base::InventorBuilder::addText(), Base::Builder3D::addText(), Base::InventorBuilder::addTransformation(), Base::Builder3D::addTransformation(), Part::BSplineCurvePy::approximate(), best_fit_test(), Base::BoundBox3< _Precision >::BoundBox3(), Part::BSplineCurvePy::buildFromPoles(), SpringbackCorrection::CalcCurv(), calcMeshVolume(), MeshCore::MeshGeomFacet::CenterOfCircumCircle(), MeshCore::MeshGeomFacet::CenterOfInscribedCircle(), MeshCore::MeshGrid::CheckPosition(), best_fit::Comp_Normals(), UniGridApprox::CompMeshError(), best_fit::CompTotalError(), MeshGui::SoFCMeshObjectBoundary::computeBBox(), MeshGui::SoFCMeshSegmentShape::computeBBox(), MeshGui::SoFCMeshObjectShape::computeBBox(), MeshGui::SoFCMeshOpenEdge::computeBBox(), MeshGui::SoFCMeshNode::computeBBox(), MeshGui::SoFCMeshOpenEdgeSet::computeBBox(), MeshGui::SoFCMeshFaceSet::computeBBox(), path_simulate::ConnectPaths_Feat(), path_simulate::ConnectPaths_xy(), path_simulate::ConnectPaths_z(), MeshCore::Approximation::Convert(), path_simulate::Correction(), Mesh::GTSAlgos::createGTSSurface(), Mesh::MeshPy::crossSections(), PartGui::CrossSections::CrossSections(), MeshCore::MeshInfo::DetailedEdgeInfo(), Base::Distance(), Base::DistanceP2(), MeshCore::MeshGeomFacet::DistanceToLineSegment(), MeshCore::MeshGeomFacet::DistanceToPoint(), Drawing::ProjectionAlgos::execute(), PartDesign::Revolution::execute(), Part::Revolution::execute(), PartDesign::Pocket::execute(), PartDesign::Pad::execute(), Part::Mirroring::execute(), Part::Extrusion::execute(), Part::TopoShapePy::extrude(), SpringbackCorrection::FaceCheck(), MeshGui::ViewProviderMesh::faceInfo(), Mesh::Facet::Facet(), Sketcher::SketchObjectPy::fillet(), fit_iter(), Mesh::MeshPy::foraminate(), Base::Placement::fromMatrix(), MeshGui::SoFCMeshSegmentShape::generatePrimitives(), MeshGui::SoFCMeshObjectShape::generatePrimitives(), MeshGui::SoFCMeshNode::generatePrimitives(), MeshGui::SoFCMeshFaceSet::generatePrimitives(), Deviation::GenNormals(), Part::GeomLine::GeomLine(), Part::GeomPoint::GeomPoint(), getBoundary_Conditions(), SpringbackCorrection::GetCurvature(), Inspection::InspectNominalShape::getDistance(), Inspection::InspectNominalPoints::getDistance(), MeshCore::MeshKernel::GetGravityPoint(), Base::BoundBox3< _Precision >::GetOctantFromVector(), Mesh::MeshObject::getPoint(), Inspection::InspectActualPoints::getPoint(), Mesh::MeshObject::getPointNormal(), Mesh::FacetPy::getPoints(), Base::BoundBox3< _Precision >::GetSideFromRay(), MeshCore::AbstractPolygonTriangulator::GetTransformToFitPlane(), Gui::LocationDialog::getUserDirection(), Base::Rotation::getValue(), MeshCore::MeshKernel::GetVolume(), Base::VectorPy::getz(), glNormal(), glVertex(), import_NASTRAN(), SpringbackCorrection::Init(), SpringbackCorrection::InitFaceCheck(), Part::BezierCurvePy::insertPoleAfter(), Part::BezierCurvePy::insertPoleBefore(), Part::BezierSurfacePy::insertPoleColAfter(), Part::BezierSurfacePy::insertPoleColBefore(), Part::BezierSurfacePy::insertPoleRowAfter(), Part::BezierSurfacePy::insertPoleRowBefore(), Mesh::MeshPy::insertVertex(), Part::BSplineCurvePy::interpolate(), Mesh::FacetPy::intersect(), MeshCore::MeshGeomFacet::IntersectBoundingBox(), MeshCore::MeshGeomEdge::IntersectBoundingBox(), MeshCore::MeshGeomFacet::IntersectWithFacet(), Base::BoundBox3< _Precision >::IntersectWithLine(), MeshCore::MeshGeomFacet::IntersectWithPlane(), Gui::ViewVolumeProjection::inverse(), SketcherGui::ViewProviderSketch::isConstraintAtPosition(), Base::BoundBox3< _Precision >::IsCutLine(), Base::BoundBox3< _Precision >::IsInBox(), Part::TopoShapePy::isInside(), MeshCore::MeshGeomFacet::IsPointOf(), Base::Vector3< _Precision >::Length(), SpringbackCorrection::Load(), Points::PointsAlgos::LoadAscii(), MeshCore::MeshInput::LoadInventor(), MeshCore::MeshInput::LoadPLY(), makeBox(), makeCircle(), makeCone(), makeCylinder(), Part::TopoShapeShellPy::makeHalfSpace(), Part::TopoShapeFacePy::makeHalfSpace(), makeLine(), path_simulate::MakePathSingle(), makePlane(), makePolygon(), makeRevolution(), makeSphere(), makeTorus(), makeWedge(), UniGridApprox::MatComp(), best_fit::MeshFit_Coarse(), UniGridApprox::MeshOffset(), minBoundingBox(), Part::TopoShapePy::mirror(), Part::GeometryPy::mirror(), Base::Vector3< _Precision >::Move(), Base::MatrixPy::move(), Base::Matrix4D::move(), Base::BoundBoxPy::move(), Mesh::MeshObject::movePoint(), Part::BSplineSurfacePy::movePoint(), Part::BSplineCurvePy::movePoint(), Base::Vector3< _Precision >::MoveZ(), Base::Rotation::multVec(), Mesh::MeshPy::nearestFacetOnRay(), MeshCore::MeshSearchNeighbours::NeighboursFromSampledFacets(), Base::Vector3< _Precision >::Normalize(), offset_mesh(), MeshPart::MeshAlgos::offsetSpecial(), Mesh::MeshObject::offsetSpecial(), Gui::Dialog::Transform::on_applyButton_clicked(), Base::Vector3< _Precision >::operator%(), Base::Vector3< _Precision >::operator&(), Base::BoundBox3< _Precision >::operator&=(), Gui::ViewVolumeProjection::operator()(), MeshPntLess::operator()(), Base::operator*(), Base::Vector3< _Precision >::operator*(), Base::Matrix4D::operator*(), Base::Vector3< _Precision >::operator*=(), Base::Vector3< _Precision >::operator+(), Base::Vector3< _Precision >::operator+=(), Base::Vector3< _Precision >::operator-(), Base::Vector3< _Precision >::operator-=(), Base::Vector3< _Precision >::operator/(), Base::Vector3< _Precision >::operator/=(), MeshCore::MeshHelpPoint::operator<(), MeshCore::MeshPoint::operator<(), Base::Vector3< _Precision >::operator=(), Base::Vector3< _Precision >::operator==(), Base::Vector3< _Precision >::operator[](), Part::GeometrySurfacePy::parameter(), Part::GeometryCurvePy::parameter(), MeshGui::SoFCMeshPickNode::pick(), best_fit::PointCloud_Coarse(), MeshCore::SurfaceFit::PolynomFit(), Points::PointsGrid::Pos(), Inspection::MeshInspectGrid::Pos(), MeshCore::MeshFacetGrid::Pos(), MeshCore::MeshPointGrid::Pos(), Points::PointsGrid::Position(), MeshCore::MeshGrid::Position(), MeshCore::MeshFacetGrid::PosWithCheck(), project(), MeshPart::CurveProjectorSimple::projectCurve(), projectEx(), projectToDXF(), projectToSVG(), Part::TopoShapeVertexPy::PyInit(), Part::SurfaceOfRevolutionPy::PyInit(), Part::SurfaceOfExtrusionPy::PyInit(), Part::PlanePy::PyInit(), Part::OffsetCurvePy::PyInit(), Part::LinePy::PyInit(), Part::HyperbolaPy::PyInit(), Part::EllipsePy::PyInit(), Part::CylinderPy::PyInit(), Part::ConePy::PyInit(), Part::CirclePy::PyInit(), Part::ArcPy::PyInit(), Part::ArcOfCirclePy::PyInit(), MeshGui::SoSFMeshPointArray::read1Value(), Robot::WaypointPy::representation(), Base::VectorPy::representation(), Base::PlacementPy::representation(), Part::LinePy::representation(), Mesh::FacetPy::representation(), App::PropertyVector::Restore(), Part::Box::Restore(), Part::TopoShapePy::revolve(), Base::Vector3< _Precision >::RotateX(), Base::Vector3< _Precision >::RotateY(), Base::Matrix4D::rotLine(), Robot::Waypoint::Save(), Robot::Robot6Axis::Save(), App::PropertyPlacement::Save(), App::PropertyVector::Save(), MeshVRML::Save(), Part::GeomLineSegment::Save(), Part::GeomLine::Save(), Part::GeomPoint::Save(), MeshCore::MeshOutput::SaveAsciiSTL(), MeshCore::MeshOutput::SaveBinarySTL(), MeshCore::MeshOutput::SaveInventor(), MeshCore::MeshOutput::SaveMeshNode(), MeshCore::MeshOutput::SaveOBJ(), MeshCore::MeshOutput::SaveOFF(), MeshCore::MeshOutput::SavePLY(), MeshCore::MeshOutput::SavePython(), MeshCore::MeshOutput::SaveXML(), sbvec3f(), Base::Vector3< _Precision >::Scale(), Part::TopoShapePy::scale(), Base::MatrixPy::scale(), Base::Matrix4D::scale(), Part::GeometryPy::scale(), Base::Vector3< _Precision >::ScaleZ(), MeshCore::MeshAlgorithm::SearchFacetsFromPolyline(), MeshCore::MeshFacetGrid::SearchNearestFromPoint(), Base::Vector3< _Precision >::Set(), Part::ToroidPy::setAxis(), Part::SpherePy::setAxis(), Part::PlanePy::setAxis(), Part::ParabolaPy::setAxis(), Part::HyperbolaPy::setAxis(), Part::EllipsePy::setAxis(), Part::CylinderPy::setAxis(), Part::ConePy::setAxis(), Part::CirclePy::setAxis(), Part::ArcOfCirclePy::setAxis(), Part::ToroidPy::setCenter(), Part::SpherePy::setCenter(), Part::GeomArcOfCircle::setCenter(), Part::GeomCircle::setCenter(), Part::EllipsePy::setCenter(), Part::CylinderPy::setCenter(), Part::ConePy::setCenter(), PartGui::ViewProviderCrossSections::setCoords(), Part::SurfaceOfRevolutionPy::setDirection(), Part::SurfaceOfExtrusionPy::setDirection(), Gui::LocationInterfaceComp< Ui_DlgPrimitives >::setDirection(), PartGui::ViewProviderMirror::setEdit(), Gui::ViewProviderGeometryObject::setEdit(), Part::LinePy::setEndPoint(), Base::VectorPy::setLength(), Part::GeomLine::setLine(), Part::SurfaceOfRevolutionPy::setLocation(), Part::ParabolaPy::setLocation(), Part::HyperbolaPy::setLocation(), Part::OffsetCurvePy::setOffsetDirection(), Part::GeomPoint::setPoint(), Part::GeomLineSegment::setPoints(), Part::GeomBSplineCurve::setPole(), Part::BSplineSurfacePy::setPole(), Part::BSplineCurvePy::setPole(), Part::BezierSurfacePy::setPole(), Part::BezierCurvePy::setPole(), Part::BSplineSurfacePy::setPoleCol(), Part::BezierSurfacePy::setPoleCol(), Part::BSplineSurfacePy::setPoleRow(), Part::BezierSurfacePy::setPoleRow(), Part::BezierCurvePy::setPoles(), Part::PlanePy::setPosition(), App::PropertyVectorList::setPyObject(), App::PropertyVector::setPyObject(), Part::LinePy::setStartPoint(), Gui::Dialog::Transform::setTransformStrategy(), Base::Rotation::setValue(), Gui::PropertyEditor::PropertyDoubleVectorItem::setValue(), Gui::PropertyEditor::PropertyVectorItem::setValue(), Base::VectorPy::setz(), MeshGui::ViewProviderMeshFolds::showDefects(), MeshGui::ViewProviderMeshIndices::showDefects(), MeshGui::ViewProviderMeshDegenerations::showDefects(), MeshGui::ViewProviderMeshDuplicatedFaces::showDefects(), MeshGui::ViewProviderMeshOrientation::showDefects(), MeshGui::ViewProviderMeshNode::showOpenEdges(), Part::TopoShape::slice(), Part::TopoShape::slices(), MeshCore::MeshSmoothing::Smooth(), SpringbackCorrection::SmoothMesh(), Mesh::MeshPy::snapVertex(), Mesh::MeshPy::splitEdge(), Mesh::MeshPy::splitFacet(), SpringbackCorrection::SpringbackCorrection(), Base::Vector3< _Precision >::Sqr(), Base::Matrix4D::toAxisAngle(), Base::Placement::toMatrix(), Gui::PropertyEditor::PropertyPlacementItem::toolTip(), PartGui::DlgPrimitives::toPlacement(), Gui::PropertyEditor::PropertyPlacementItem::toString(), Gui::PropertyEditor::PropertyDoubleVectorItem::toString(), Gui::PropertyEditor::PropertyVectorItem::toString(), Base::toVector(), Base::MatrixPy::transform(), MeshCore::MeshEigensystem::Transform(), Base::Vector3< _Precision >::TransformToCoordinateSystem(), Data::ComplexGeoData::transformToInside(), Data::ComplexGeoData::transformToOutside(), Part::TopoShapePy::translate(), Part::GeometryPy::translate(), MeshCore::MeshSearchNeighbours::TriangleCutsSphere(), RobotGui::ViewProviderTrajectory::updateData(), Gui::ViewProviderMeasureDistance::updateData(), InspectionGui::ViewProviderInspection::updateData(), Gui::ViewProviderAnnotationLabel::updateData(), Gui::ViewProviderAnnotation::updateData(), MeshGui::ViewProviderMeshTransformDemolding::valueChangedCallback(), RobotGui::TaskTrajectoryDressUpParameter::viewPlacement(), Gui::View3DInventorPy::viewPosition(), MeshGui::SoSFMeshPointArray::write1Value(), and MeshVRML::WriteVRMLViewpoints().