SUMO - Simulation of Urban MObility
Position Class Reference

A point in 2D or 3D with translation and scaling methods. More...

#include <Position.h>

Inheritance diagram for Position:
Inheritance graph
Collaboration diagram for Position:
Collaboration graph

Public Member Functions

void add (const Position &pos)
 Adds the given position to this one. More...
 
void add (double dx, double dy)
 Adds the given position to this one. More...
 
void add (double dx, double dy, double dz)
 Adds the given position to this one. More...
 
bool almostSame (const Position &p2, double maxDiv=POSITION_EPS) const
 check if two position is almost the sme as other More...
 
double angleTo2D (const Position &other) const
 returns the angle in the plane of the vector pointing from here to the other position More...
 
Position crossProduct (const Position &pos)
 returns the cross product between this point and the second one More...
 
double distanceSquaredTo (const Position &p2) const
 returns the square of the distance to another position More...
 
double distanceSquaredTo2D (const Position &p2) const
 returns the square of the distance to another position (Only using x and y positions) More...
 
double distanceTo (const Position &p2) const
 returns the euclidean distance in 3 dimension More...
 
double distanceTo2D (const Position &p2) const
 returns the euclidean distance in the x-y-plane More...
 
double dotProduct (const Position &pos)
 returns the dot product (scalar product) between this point and the second one More...
 
bool isNAN () const
 check if position is NAN More...
 
void mul (double val)
 Multiplies both positions with the given value. More...
 
void mul (double mx, double my)
 Multiplies position with the given values. More...
 
void mul (double mx, double my, double mz)
 Multiplies position with the given values. More...
 
void norm2d ()
 
bool operator!= (const Position &p2) const
 difference operator More...
 
Position operator* (double scalar) const
 keep the direction but modify the length of the (location) vector to length * scalar More...
 
Position operator+ (const Position &p2) const
 add operator More...
 
Position operator+ (double offset) const
 keep the direction but modify the length of the (location) vector to length + scalar More...
 
Position operator- (const Position &p2) const
 sub operator More...
 
bool operator< (const Position &p2) const
 lexicographical sorting for use in maps and sets More...
 
bool operator== (const Position &p2) const
 comparation operator More...
 
 Position ()
 default constructor More...
 
 Position (double x, double y)
 Parametrised constructor (only for x-y) More...
 
 Position (double x, double y, double z)
 Parametrised constructor. More...
 
Position rotateAround2D (double rad, const Position &origin)
 rotate this position by rad around origin and return the result More...
 
void set (double x, double y)
 set positions x and y More...
 
void set (double x, double y, double z)
 set positions x, y and z More...
 
void set (const Position &pos)
 set position with another position More...
 
void setx (double x)
 set position x More...
 
void sety (double y)
 set position y More...
 
void setz (double z)
 set position z More...
 
void sub (double dx, double dy)
 Substracts the given position from this one. More...
 
void sub (double dx, double dy, double dz)
 Substracts the given position from this one. More...
 
void sub (const Position &pos)
 Substracts the given position from this one. More...
 
void swapXY ()
 swap position X and Y More...
 
double x () const
 Returns the x-position. More...
 
double y () const
 Returns the y-position. More...
 
double z () const
 Returns the z-position. More...
 
 ~Position ()
 Destructor. More...
 

Static Public Member Functions

static const PositioninvalidPosition ()
 reference to invalid position (needed if INVALID is taken by macro-definition) More...
 

Static Public Attributes

static const Position INVALID
 used to indicate that a position is valid More...
 

Private Attributes

double myX
 The x-position. More...
 
double myY
 The y-position. More...
 
double myZ
 The z-position. More...
 

Friends

std::ostream & operator<< (std::ostream &os, const Position &p)
 output operator More...
 

Detailed Description

A point in 2D or 3D with translation and scaling methods.

Definition at line 39 of file Position.h.

Constructor & Destructor Documentation

◆ Position() [1/3]

Position::Position ( )
inline

◆ Position() [2/3]

Position::Position ( double  x,
double  y 
)
inline

Parametrised constructor (only for x-y)

Definition at line 46 of file Position.h.

◆ Position() [3/3]

Position::Position ( double  x,
double  y,
double  z 
)
inline

Parametrised constructor.

Definition at line 50 of file Position.h.

◆ ~Position()

Position::~Position ( )
inline

Destructor.

Definition at line 54 of file Position.h.

Member Function Documentation

◆ add() [1/3]

◆ add() [2/3]

void Position::add ( double  dx,
double  dy 
)
inline

Adds the given position to this one.

Definition at line 134 of file Position.h.

References myX, and myY.

◆ add() [3/3]

void Position::add ( double  dx,
double  dy,
double  dz 
)
inline

Adds the given position to this one.

Definition at line 140 of file Position.h.

References myX, myY, and myZ.

◆ almostSame()

bool Position::almostSame ( const Position p2,
double  maxDiv = POSITION_EPS 
) const
inline

◆ angleTo2D()

◆ crossProduct()

Position Position::crossProduct ( const Position pos)
inline

returns the cross product between this point and the second one

Definition at line 259 of file Position.h.

References myX, myY, myZ, and Position().

Referenced by NBHeightMapper::Triangle::normalVector().

◆ distanceSquaredTo()

double Position::distanceSquaredTo ( const Position p2) const
inline

returns the square of the distance to another position

Definition at line 239 of file Position.h.

References myX, myY, and myZ.

Referenced by distanceTo().

◆ distanceSquaredTo2D()

double Position::distanceSquaredTo2D ( const Position p2) const
inline

◆ distanceTo()

◆ distanceTo2D()

double Position::distanceTo2D ( const Position p2) const
inline

returns the euclidean distance in the x-y-plane

Definition at line 244 of file Position.h.

References distanceSquaredTo2D().

Referenced by NBNode::bezierControlPoints(), NBNode::buildWalkingAreas(), NGRandomNetBuilder::canConnect(), NBNode::checkCrossing(), GUIVehicle::computeSeats(), NIImporter_OpenDrive::computeShapes(), PositionVector::distance2D(), GUIVehicle::drawAction_drawRailCarriages(), GNEBusStop::drawGL(), GUIBusStop::drawGL(), GNEViewNet::drawLaneCandidates(), GNEEdge::editEndpoint(), PositionVector::extrapolate2D(), NBPTStopCont::findAccessEdgesForRailStops(), NBNodeCont::generateNodeClusters(), ROEdge::getDistanceTo(), MSLink::getLeaderInfo(), PositionVector::getMaxGrade(), CState::getPosition(), NBNodeShapeComputer::getSmoothCorner(), GNEInternalLane::GNEInternalLane(), GUILane::GUILane(), MSVehicle::Influencer::implicitDeltaPosRemote(), MSVehicle::Influencer::implicitSpeedRemote(), MSPModel_Striping::initWalkingAreaPaths(), PositionVector::insertAtClosest(), PositionVector::intersects(), PositionVector::intersectsAtLengths2D(), PCLoaderOSM::loadIfSet(), PositionVector::move2side(), GNEViewNet::SelectingArea::moveRectangleSelection(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), GeomHelper::nearest_offset_on_line_to_point2D(), PositionVector::nearest_offset_to_point2D(), PositionVector::positionAtOffset2D(), NBNodeCont::pruneClusterFringe(), PositionVector::removeClosest(), GNEEdge::resetEndpoint(), NBNodeCont::shortestEdge(), PositionVector::sideOffset(), PositionVector::simplified(), PositionVector::slopeDegreeAtOffset(), PositionVector::smoothedZFront(), PositionVector::transformToVectorCoordinates(), GNEConnection::updateGeometry(), GNECrossing::updateGeometry(), GNELane::updateGeometry(), MSPerson::MSPersonStage_Walking::walkDistance(), NWWriter_OpenDrive::writeGeomLines(), and NWWriter_OpenDrive::writeGeomSmooth().

◆ dotProduct()

double Position::dotProduct ( const Position pos)
inline

returns the dot product (scalar product) between this point and the second one

Definition at line 267 of file Position.h.

References myX, myY, myZ, and rotateAround2D().

Referenced by NBHeightMapper::Triangle::getZ().

◆ invalidPosition()

static const Position& Position::invalidPosition ( )
inlinestatic

reference to invalid position (needed if INVALID is taken by macro-definition)

Definition at line 288 of file Position.h.

References INVALID.

◆ isNAN()

bool Position::isNAN ( ) const
inline

check if position is NAN

Definition at line 280 of file Position.h.

References myX, myY, and myZ.

◆ mul() [1/3]

◆ mul() [2/3]

void Position::mul ( double  mx,
double  my 
)
inline

Multiplies position with the given values.

Definition at line 114 of file Position.h.

References myX, and myY.

◆ mul() [3/3]

void Position::mul ( double  mx,
double  my,
double  mz 
)
inline

Multiplies position with the given values.

Definition at line 120 of file Position.h.

References myX, myY, and myZ.

◆ norm2d()

void Position::norm2d ( )
inline

Definition at line 167 of file Position.h.

References myX, and myY.

Referenced by NBNode::getEmptyDir().

◆ operator!=()

bool Position::operator!= ( const Position p2) const
inline

difference operator

Definition at line 213 of file Position.h.

References myX, myY, and myZ.

◆ operator*()

Position Position::operator* ( double  scalar) const
inline

keep the direction but modify the length of the (location) vector to length * scalar

Definition at line 193 of file Position.h.

References myX, myY, myZ, and Position().

◆ operator+() [1/2]

Position Position::operator+ ( const Position p2) const
inline

add operator

Definition at line 183 of file Position.h.

References myX, myY, myZ, and Position().

◆ operator+() [2/2]

Position Position::operator+ ( double  offset) const
inline

keep the direction but modify the length of the (location) vector to length + scalar

Definition at line 198 of file Position.h.

References distanceTo(), myX, myY, myZ, and Position().

◆ operator-()

Position Position::operator- ( const Position p2) const
inline

sub operator

Definition at line 188 of file Position.h.

References myX, myY, myZ, and Position().

◆ operator<()

bool Position::operator< ( const Position p2) const
inline

lexicographical sorting for use in maps and sets

Definition at line 218 of file Position.h.

References myX, myY, and myZ.

◆ operator==()

bool Position::operator== ( const Position p2) const
inline

comparation operator

Definition at line 208 of file Position.h.

References myX, myY, and myZ.

◆ rotateAround2D()

Position Position::rotateAround2D ( double  rad,
const Position origin 
)

rotate this position by rad around origin and return the result

Definition at line 42 of file Position.cpp.

References Position(), x(), and y().

Referenced by dotProduct(), GUIDanielPerspectiveChanger::onMouseMove(), and GUISUMOAbstractView::screenPos2NetPos().

◆ set() [1/3]

◆ set() [2/3]

void Position::set ( double  x,
double  y,
double  z 
)
inline

set positions x, y and z

Definition at line 93 of file Position.h.

References myX, myY, myZ, x(), y(), and z().

◆ set() [3/3]

void Position::set ( const Position pos)
inline

set position with another position

Definition at line 100 of file Position.h.

References myX, myY, and myZ.

◆ setx()

void Position::setx ( double  x)
inline

set position x

Definition at line 72 of file Position.h.

References myX, and x().

Referenced by GNENet::joinSelectedJunctions(), and GUISUMOAbstractView::snapToActiveGrid().

◆ sety()

void Position::sety ( double  y)
inline

set position y

Definition at line 77 of file Position.h.

References myY, and y().

Referenced by GNENet::joinSelectedJunctions(), and GUISUMOAbstractView::snapToActiveGrid().

◆ setz()

◆ sub() [1/3]

void Position::sub ( double  dx,
double  dy 
)
inline

◆ sub() [2/3]

void Position::sub ( double  dx,
double  dy,
double  dz 
)
inline

Substracts the given position from this one.

Definition at line 153 of file Position.h.

References myX, myY, and myZ.

◆ sub() [3/3]

void Position::sub ( const Position pos)
inline

Substracts the given position from this one.

Definition at line 160 of file Position.h.

References myX, myY, and myZ.

◆ swapXY()

void Position::swapXY ( )
inline

swap position X and Y

Definition at line 275 of file Position.h.

References myX, and myY.

Referenced by GNEPolygonFrame::GEOPOICreator::onCmdCreateGEOPOI(), and GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates().

◆ x()

double Position::x ( ) const
inline

Returns the x-position.

Definition at line 57 of file Position.h.

References myX.

Referenced by MSPModel_Remote::add(), Boundary::add(), PositionVector::add(), NIXMLNodesHandler::addNode(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), bezier(), NBNode::bezierControlPoints(), GNEAdditional::AdditionalGeometry::calculateMultiShapeRotationsAndLengths(), GNEAdditional::AdditionalGeometry::calculateShapeRotationsAndLengths(), NIImporter_OpenDrive::calculateStraightEndPoint(), GeoConvHelper::cartesian2geo(), GUIDanielPerspectiveChanger::centerTo(), NGRandomNetBuilder::checkAngles(), GUISUMOAbstractView::checkGDALImage(), TraCIServerAPI_Simulation::commandPositionConversion(), NBPTStopCont::computeCrossProductEdgePosition(), NBNodeShapeComputer::computeNodeShapeSmall(), NGRandomNetBuilder::createNewNode(), Boundary::distanceTo2D(), GNEShape::draw(), GNEAdditional::BlockIcon::draw(), GUIVehicle::drawAction_drawRailCarriages(), GNELane::drawArrows(), GUILane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GUISUMOAbstractView::drawDecals(), GLHelper::drawFilledPoly(), GNEContainerStop::drawGL(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEParkingArea::drawGL(), GNEParkingSpace::drawGL(), GNEJunction::drawGL(), GNEDetectorE1::drawGL(), GNEDetectorEntry::drawGL(), GNEDetectorExit::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUIMEInductLoop::MyWrapper::drawGL(), GNEDetectorE1Instant::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIInstantInductLoop::MyWrapper::drawGL(), GUICalibrator::drawGL(), GUIContainer::drawGL(), GUIPerson::drawGL(), GNECalibrator::drawGL(), GUIJunctionWrapper::drawGL(), GNETAZ::drawGL(), GUIChargingStation::drawGL(), GUIContainerStop::drawGL(), GUIBusStop::drawGL(), GNEDetectorE2::drawGL(), GUIParkingArea::drawGL(), GNEPoly::drawGL(), GNEPOI::drawGL(), GUIInductLoop::MyWrapper::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GNEEdge::drawGL(), GUIPointOfInterest::drawInnerPOI(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GLHelper::drawLine(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GUIBaseVehicle::drawOnPos(), GNEViewNet::SelectingArea::drawRectangleSelection(), GLHelper::drawShapeDottedContour(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEViewNet::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GLHelper::drawTriangleAtEnd(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), GNEConnection::getBoundary(), GNECrossing::getCenteringBoundary(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), PositionVector::getPolygonCenter(), GNEVaporizer::getPositionInView(), GNERouteProbe::getPositionInView(), GNEPOI::getPositionInView(), MSVTKExport::getPositions(), libsumo::InductionLoop::getTree(), GUIDanielPerspectiveChanger::getXPos(), NBHeightMapper::getZ(), GNEInternalLane::GNEInternalLane(), GNEJunction::GNEJunction(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIJunctionWrapper::GUIJunctionWrapper(), GUILane::GUILane(), GUIParkingArea::GUIParkingArea(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), MSPModel_Remote::handleShape(), MSPModel_Remote::handleWalkingArea(), NBNodeCont::insert(), PositionVector::intersects(), PositionVector::isLeft(), GNENet::joinSelectedJunctions(), NBHeightMapper::loadTiff(), MSPModel_Remote::makeStartOrEndTransition(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), GNEViewNet::SelectingArea::moveRectangleSelection(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GUIMEInductLoop::MyWrapper::MyWrapper(), GUIInstantInductLoop::MyWrapper::MyWrapper(), GUIE2Collector::MyWrapper::MyWrapper(), GUIInductLoop::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point2D(), GUIGLObjectPopupMenu::onCmdCopyCursorGeoPosition(), GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates(), GUIDanielPerspectiveChanger::onMouseMove(), PositionVector::as_poly_cw_sorter::operator()(), PositionVector::increasing_x_y_sorter::operator()(), GNEViewNet::SelectingArea::processEdgeRectangleSelection(), GNEViewNet::SelectingArea::processRectangleSelection(), TraCIServerAPI_GUI::processSet(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), setx(), NGNode::setY(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), NBNetBuilder::transformCoordinate(), GNEAdditional::ChildConnections::update(), GNEConnection::updateGeometry(), GNECrossing::updateGeometry(), GNELane::updateGeometry(), GNEJunction::updateGeometry(), GUISUMOAbstractView::updatePositionInformation(), MSEmissionExport::write(), MSBatteryExport::write(), MSFCDExport::write(), GNEAdditional::writeAdditional(), NBSign::writeAsPOI(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWWriter_DlrNavteq::writeNodesUnsplitted(), BinaryFormatter::writePosition(), NWFrame::writePositionLong(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), GeoConvHelper::x2cartesian(), GeoConvHelper::x2cartesian_const(), and GUIDanielPerspectiveChanger::zoom().

◆ y()

double Position::y ( ) const
inline

Returns the y-position.

Definition at line 62 of file Position.h.

References myY.

Referenced by MSPModel_Remote::add(), Boundary::add(), PositionVector::add(), NIXMLNodesHandler::addNode(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), bezier(), NBNode::bezierControlPoints(), GNEAdditional::AdditionalGeometry::calculateMultiShapeRotationsAndLengths(), GNEViewNet::MoveSingleElementValues::calculateOffsetMovement(), GNEAdditional::AdditionalGeometry::calculateShapeRotationsAndLengths(), NIImporter_OpenDrive::calculateStraightEndPoint(), GeoConvHelper::cartesian2geo(), GUIDanielPerspectiveChanger::centerTo(), NGRandomNetBuilder::checkAngles(), GUISUMOAbstractView::checkGDALImage(), TraCIServerAPI_Simulation::commandPositionConversion(), NBPTStopCont::computeCrossProductEdgePosition(), NBNodeShapeComputer::computeNodeShapeSmall(), NGRandomNetBuilder::createNewNode(), Boundary::distanceTo2D(), GNEShape::draw(), GNEAdditional::BlockIcon::draw(), GUIVehicle::drawAction_drawRailCarriages(), GNELane::drawArrows(), GUILane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GUISUMOAbstractView::drawDecals(), GLHelper::drawFilledPoly(), GNEContainerStop::drawGL(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEParkingArea::drawGL(), GNEParkingSpace::drawGL(), GNEJunction::drawGL(), GNEDetectorE1::drawGL(), GNEDetectorEntry::drawGL(), GNEDetectorExit::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUIMEInductLoop::MyWrapper::drawGL(), GNEDetectorE1Instant::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIInstantInductLoop::MyWrapper::drawGL(), GUICalibrator::drawGL(), GUIContainer::drawGL(), GUIPerson::drawGL(), GNECalibrator::drawGL(), GUIJunctionWrapper::drawGL(), GNETAZ::drawGL(), GUIChargingStation::drawGL(), GUIContainerStop::drawGL(), GUIBusStop::drawGL(), GNEDetectorE2::drawGL(), GUIParkingArea::drawGL(), GNEPoly::drawGL(), GNEPOI::drawGL(), GUIInductLoop::MyWrapper::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GNEEdge::drawGL(), GUIPointOfInterest::drawInnerPOI(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GLHelper::drawLine(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GUIBaseVehicle::drawOnPos(), GNEViewNet::SelectingArea::drawRectangleSelection(), GLHelper::drawShapeDottedContour(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEViewNet::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GLHelper::drawTriangleAtEnd(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), GNEConnection::getBoundary(), GNECrossing::getCenteringBoundary(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), GNEVaporizer::getPositionInView(), GNERouteProbe::getPositionInView(), GNEPOI::getPositionInView(), MSVTKExport::getPositions(), libsumo::InductionLoop::getTree(), GUIDanielPerspectiveChanger::getYPos(), NBHeightMapper::getZ(), GNEInternalLane::GNEInternalLane(), GNEJunction::GNEJunction(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIJunctionWrapper::GUIJunctionWrapper(), GUILane::GUILane(), GUIParkingArea::GUIParkingArea(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), MSPModel_Remote::handleShape(), MSPModel_Remote::handleWalkingArea(), NBNodeCont::insert(), PositionVector::intersects(), PositionVector::isLeft(), GNENet::joinSelectedJunctions(), NBHeightMapper::loadTiff(), MSPModel_Remote::makeStartOrEndTransition(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), GNEViewNet::SelectingArea::moveRectangleSelection(), GNEViewNet::MoveMultipleElementValues::moveSelection(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GUIMEInductLoop::MyWrapper::MyWrapper(), GUIInstantInductLoop::MyWrapper::MyWrapper(), GUIE2Collector::MyWrapper::MyWrapper(), GUIInductLoop::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point2D(), GUIGLObjectPopupMenu::onCmdCopyCursorGeoPosition(), GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates(), GUIDanielPerspectiveChanger::onMouseMove(), PositionVector::as_poly_cw_sorter::operator()(), PositionVector::increasing_x_y_sorter::operator()(), GNEViewNet::SelectingArea::processEdgeRectangleSelection(), GNEViewNet::SelectingArea::processRectangleSelection(), TraCIServerAPI_GUI::processSet(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), NGNode::setX(), sety(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), NBNetBuilder::transformCoordinate(), GNEAdditional::ChildConnections::update(), GNEConnection::updateGeometry(), GNECrossing::updateGeometry(), GNELane::updateGeometry(), GNEJunction::updateGeometry(), GUISUMOAbstractView::updatePositionInformation(), MSEmissionExport::write(), MSBatteryExport::write(), MSFCDExport::write(), GNEAdditional::writeAdditional(), NBSign::writeAsPOI(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWWriter_DlrNavteq::writeNodesUnsplitted(), BinaryFormatter::writePosition(), NWFrame::writePositionLong(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), GeoConvHelper::x2cartesian(), GeoConvHelper::x2cartesian_const(), and GUIDanielPerspectiveChanger::zoom().

◆ z()

double Position::z ( ) const
inline

Friends And Related Function Documentation

◆ operator<<

std::ostream& operator<< ( std::ostream &  os,
const Position p 
)
friend

output operator

Definition at line 174 of file Position.h.

Field Documentation

◆ INVALID

◆ myX

◆ myY

◆ myZ

double Position::myZ
private

The documentation for this class was generated from the following files: