![]() |
Eclipse SUMO - Simulation of Urban MObility
|
A point in 2D or 3D with translation and scaling methods. More...
#include <Position.h>
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 Position & | invalidPosition () |
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... | |
A point in 2D or 3D with translation and scaling methods.
Definition at line 39 of file Position.h.
|
inline |
default constructor
Definition at line 42 of file Position.h.
Referenced by crossProduct(), GNEPOI::drawGL(), GUIPointOfInterest::drawInnerPOI(), GNEPOI::getPositionInView(), operator*(), operator+(), operator-(), and rotateAround2D().
|
inline |
Parametrised constructor (only for x-y)
Definition at line 46 of file Position.h.
|
inline |
Parametrised constructor.
Definition at line 50 of file Position.h.
|
inline |
Destructor.
Definition at line 54 of file Position.h.
|
inline |
Adds the given position to this one.
Definition at line 127 of file Position.h.
Referenced by NBNodeCont::analyzeCluster(), AGPosition::compute2dPosition(), NBNodeShapeComputer::computeNodeShapeDefault(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), GNEEdge::drawEdgeName(), GUIEdge::drawGL(), GLHelper::drawTextBox(), PositionVector::extrapolate(), PositionVector::extrapolate2D(), NBNode::getEmptyDir(), GeoConvHelper::moveConvertedBy(), GNEDetectorE3::moveGeometry(), GNEParkingSpace::moveGeometry(), GNEVariableSpeedSign::moveGeometry(), GNEAccess::moveGeometry(), GNERerouter::moveGeometry(), GNEDetectorE1::moveGeometry(), GNEDetectorEntryExit::moveGeometry(), GNEDetectorE1Instant::moveGeometry(), GNEStoppingPlace::moveGeometry(), GNEStop::moveGeometry(), GNEDetectorE2::moveGeometry(), GNEPOI::moveGeometry(), GNERide::moveGeometry(), GNEPersonTrip::moveGeometry(), GNEWalk::moveGeometry(), GNEJunction::moveGeometry(), GNEEdge::moveShapeEnd(), GNEEdge::moveShapeStart(), NBPTPlatform::reshiftPosition(), NBPTStop::reshiftPosition(), NBDistrict::reshiftPosition(), NBNode::reshiftPosition(), GUISUMOAbstractView::showToolTipFor(), and GeoConvHelper::x2cartesian_const().
|
inline |
Adds the given position to this one.
Definition at line 134 of file Position.h.
|
inline |
Adds the given position to this one.
Definition at line 140 of file Position.h.
|
inline |
check if two position is almost the sme as other
Definition at line 229 of file Position.h.
References distanceTo().
Referenced by NBNode::getEndPoints(), PositionVector::insert_noDoublePos(), AGPosition::operator==(), PositionVector::push_back_noDoublePos(), and PositionVector::push_front_noDoublePos().
|
inline |
returns the angle in the plane of the vector pointing from here to the other position
Definition at line 254 of file Position.h.
Referenced by NBNode::bezierControlPoints(), MSVehicle::computeAngle(), NBEdge::computeAngle(), GNEBusStop::drawGL(), GUIBusStop::drawGL(), GLHelper::drawTriangleAtEnd(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), NBContHelper::relative_outgoing_edge_sorter::operator()(), NBContHelper::relative_incoming_edge_sorter::operator()(), PositionVector::rotationAtOffset(), and NWWriter_OpenDrive::writeGeomSmooth().
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().
|
inline |
returns the square of the distance to another position
Definition at line 239 of file Position.h.
Referenced by distanceTo().
|
inline |
returns the square of the distance to another position (Only using x and y positions)
Definition at line 249 of file Position.h.
Referenced by GNEInspectorFrame::OverlappedInspection::checkSavedPosition(), distanceTo2D(), GNEEdge::drawGeometryPoints(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEContainerStop::drawGL(), GNEParkingArea::drawGL(), GNEJunction::drawGL(), GNETAZ::drawGL(), GNEPoly::drawGL(), GNEVehicle::drawGL(), GNEEdge::drawPartialPersonPlan(), and NBPTStopCont::getClosestPlatformToPTStopPosition().
|
inline |
returns the euclidean distance in 3 dimension
Definition at line 234 of file Position.h.
References distanceSquaredTo().
Referenced by IntermodalNetwork< E, L, N, V >::addSchedule(), almostSame(), GNEAdditional::AdditionalGeometry::calculateMultiShapeRotationsAndLengths(), GNENetElement::NetElementGeometry::calculateShapeRotationsAndLengths(), GNEAdditional::AdditionalGeometry::calculateShapeRotationsAndLengths(), GNEDemandElement::DemandElementGeometry::calculateShapeRotationsAndLengths(), TraCIServerAPI_Simulation::commandDistanceRequest(), NBHelpers::distance(), AGPosition::distanceTo(), GLHelper::drawBoxLines(), GLHelper::drawTriangleAtEnd(), PositionVector::extrapolate(), MSStoppingPlace::getAccessDistance(), libsumo::Simulation::getDistance2D(), libsumo::Simulation::getDistanceRoad(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIParkingArea::GUIParkingArea(), PositionVector::indexOfClosest(), NBEdge::init(), GUIE2Collector::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point25D(), MSDevice_Bluelight::notifyMove(), GNEViewNet::onCmdTransformPOI(), GUIViewTraffic::onGamingClick(), operator+(), PositionVector::positionAtOffset(), NIVissimEdge::remapOneOfNodes(), PositionVector::rotationAtOffset(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), PositionVector::slopeDegreeAtOffset(), GUILane::splitAtSegments(), and MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility().
|
inline |
returns the euclidean distance in the x-y-plane
Definition at line 244 of file Position.h.
References distanceSquaredTo2D().
Referenced by MSCFModel_CC::_consensus(), MSCFModel_CC::_v(), NBNode::bezierControlPoints(), NBNode::buildWalkingAreas(), GNEDemandElement::DemandElementSegmentGeometry::calculatePartialShapeRotationsAndLengths(), NGRandomNetBuilder::canConnect(), NBNode::checkCrossing(), MSLink::checkWalkingAreaFoe(), GUIBaseVehicle::computeSeats(), NIImporter_OpenDrive::computeShapes(), PositionVector::distance2D(), GUIVehicle::drawAction_drawCarriageClass(), GNEBusStop::drawGL(), GUIBusStop::drawGL(), GNEViewNet::drawLaneCandidates(), GNEEdge::editEndpoint(), PositionVector::extrapolate2D(), NBPTStopCont::findAccessEdgesForRailStops(), NBNodeCont::generateNodeClusters(), 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(), GNEViewNetHelper::SelectingArea::moveRectangleSelection(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), GeomHelper::nearest_offset_on_line_to_point25D(), GeomHelper::nearest_offset_on_line_to_point2D(), PositionVector::nearest_offset_to_point25D(), PositionVector::nearest_offset_to_point2D(), GUIViewTraffic::onGamingClick(), PositionVector::positionAtOffset2D(), NBNodeCont::pruneClusterFringe(), PositionVector::removeClosest(), GNEEdge::resetEndpoint(), NBNodeCont::shortestEdge(), PositionVector::sideOffset(), PositionVector::simplified(), PositionVector::slopeDegreeAtOffset(), PositionVector::smoothedZFront(), PositionVector::transformToVectorCoordinates(), MSPerson::MSPersonStage_Walking::walkDistance(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomSmooth(), and NWWriter_OpenDrive::writeRoadObjects().
|
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().
|
inlinestatic |
reference to invalid position (needed if INVALID is taken by macro-definition)
Definition at line 288 of file Position.h.
References INVALID.
|
inline |
|
inline |
Multiplies both positions with the given value.
Definition at line 107 of file Position.h.
Referenced by NIXMLNodesHandler::addNode(), NBNodeCont::analyzeCluster(), AGPosition::compute2dPosition(), GeoConvHelper::computeFinal(), NBNodeShapeComputer::computeNodeShapeDefault(), GNEEdge::drawEdgeName(), GUIEdge::drawGL(), NBNode::getEmptyDir(), NBDistrict::mirrorX(), NBNode::mirrorX(), PCPolyContainer::saveDlrTDP(), NWWriter_DlrNavteq::writeNodesUnsplitted(), and NWWriter_DlrNavteq::writeTrafficSignals().
|
inline |
Multiplies position with the given values.
Definition at line 114 of file Position.h.
|
inline |
Multiplies position with the given values.
Definition at line 120 of file Position.h.
|
inline |
Definition at line 167 of file Position.h.
Referenced by NBNode::getEmptyDir().
|
inline |
|
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().
|
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().
|
inline |
lexicographical sorting for use in maps and sets
Definition at line 218 of file Position.h.
|
inline |
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().
|
inline |
set positions x and y
Definition at line 87 of file Position.h.
References myX, myY, x(), and y().
Referenced by MSCFModel_CC::_consensus(), NIXMLNodesHandler::addNode(), ShapeHandler::addPOI(), NBNode::bezierControlPoints(), GeoConvHelper::cartesian2geo(), CC_VehicleVariables::CC_VehicleVariables(), TraCIServerAPI_Simulation::commandDistanceRequest(), TraCIServerAPI_Simulation::commandPositionConversion(), NBNodeShapeComputer::computeNodeShapeSmall(), GUISUMOAbstractView::destroyPopup(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), GUICompleteSchemeStorage::init(), NBHeightMapper::loadTiff(), GUISettingsHandler::myStartElement(), NLJunctionControlBuilder::openJunction(), operator>>(), TraCIServerAPI_GUI::processSet(), GUICompleteSchemeStorage::saveViewport(), MSPModel_Remote::PState::setPosition(), NGNode::setX(), NGNode::setY(), GeoConvHelper::x2cartesian(), and GeoConvHelper::x2cartesian_const().
|
inline |
|
inline |
set position with another position
Definition at line 100 of file Position.h.
|
inline |
set position x
Definition at line 72 of file Position.h.
Referenced by MSCFModel_CC::_consensus(), NIXMLNodesHandler::addJoinCluster(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), and GUISUMOAbstractView::snapToActiveGrid().
|
inline |
set position y
Definition at line 77 of file Position.h.
Referenced by MSCFModel_CC::_consensus(), GNENet::joinSelectedJunctions(), and GUISUMOAbstractView::snapToActiveGrid().
|
inline |
set position z
Definition at line 82 of file Position.h.
Referenced by NBNodeShapeComputer::computeNodeShapeDefault(), libsumo::Simulation::convert2D(), GNEViewNetHelper::MoveMultipleElementValues::moveSelection(), GNEViewNetHelper::MoveSingleElementValues::moveSingleElement(), libsumo::Vehicle::moveToXY(), GUISUMOAbstractView::snapToActiveGrid(), NBEdge::startShapeAt(), and GeoConvHelper::x2cartesian_const().
|
inline |
Substracts the given position from this one.
Definition at line 147 of file Position.h.
Referenced by NBNode::bezierControlPoints(), GeoConvHelper::cartesian2geo(), AGPosition::compute2dPosition(), PositionVector::extrapolate(), PositionVector::extrapolate2D(), NBNode::getEmptyDir(), NBHeightMapper::Triangle::getZ(), and libsumo::Vehicle::highlight().
|
inline |
Substracts the given position from this one.
Definition at line 153 of file Position.h.
|
inline |
Substracts the given position from this one.
Definition at line 160 of file Position.h.
|
inline |
swap position X and Y
Definition at line 275 of file Position.h.
Referenced by GNEPolygonFrame::GEOPOICreator::onCmdCreateGEOPOI(), and GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates().
|
inline |
Returns the x-position.
Definition at line 57 of file Position.h.
References myX.
Referenced by MSCFModel_CC::_consensus(), MSPModel_Remote::add(), Boundary::add(), PositionVector::add(), NIXMLNodesHandler::addNode(), MSPModel_Striping::addVehicleFoe(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), PositionVector::bezier(), NBNode::bezierControlPoints(), GNEAdditional::AdditionalGeometry::calculateMultiShapeRotationsAndLengths(), GNEDemandElement::DemandElementSegmentGeometry::calculatePartialShapeRotationsAndLengths(), GNENetElement::NetElementGeometry::calculateShapeRotationsAndLengths(), GNEAdditional::AdditionalGeometry::calculateShapeRotationsAndLengths(), GNEDemandElement::DemandElementGeometry::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(), GUIVehicle::drawAction_drawCarriageClass(), GNELane::drawArrows(), GUILane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GUISUMOAbstractView::drawDecals(), GLHelper::drawFilledPoly(), GNEEdge::drawGeometryPoints(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEContainerStop::drawGL(), GNEParkingArea::drawGL(), GNEDetectorE3::drawGL(), GNEParkingSpace::drawGL(), GNEDetectorE1::drawGL(), GNEDetectorEntryExit::drawGL(), GNEVariableSpeedSign::drawGL(), GNERerouter::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUIMEInductLoop::MyWrapper::drawGL(), GNEDetectorE1Instant::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIPerson::drawGL(), GUIInstantInductLoop::MyWrapper::drawGL(), GUIContainer::drawGL(), GNEJunction::drawGL(), GUICalibrator::drawGL(), GUIJunctionWrapper::drawGL(), GNECalibrator::drawGL(), GNETAZ::drawGL(), GNEDetectorE2::drawGL(), GUIChargingStation::drawGL(), GUIContainerStop::drawGL(), GUIBusStop::drawGL(), GUIParkingArea::drawGL(), GNEPoly::drawGL(), GNEPOI::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GUIInductLoop::MyWrapper::drawGL(), GNEPerson::drawGL(), GNEVehicle::drawGL(), GNEAdditional::BlockIcon::drawIcon(), GUIPointOfInterest::drawInnerPOI(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GLHelper::drawLine(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GUIBaseVehicle::drawOnPos(), GNEEdge::drawPartialPersonPlan(), GNEViewNetHelper::SelectingArea::drawRectangleSelection(), GNEEdge::drawRerouterSymbol(), GLHelper::drawShapeDottedContourRectangle(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEViewNetHelper::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GLHelper::drawTriangleAtEnd(), GNELane::drawVSSSymbol(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), NIImporter_OpenDrive::geomFromLine(), GNEConnection::getBoundary(), PointOfInterest::getCenter(), GNEJunction::getCenteringBoundary(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), MSCFModel_CC::getParameter(), PositionVector::getPolygonCenter(), GNEVaporizer::getPositionInView(), GNERouteProbe::getPositionInView(), GNEPOI::getPositionInView(), GNEPerson::getPositionInView(), GNEVehicle::getPositionInView(), MSVTKExport::getPositions(), libsumo::InductionLoop::getTree(), GUIDanielPerspectiveChanger::getXPos(), NBHeightMapper::getZ(), GNEInternalLane::GNEInternalLane(), 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(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), NBHeightMapper::loadTiff(), MSPModel_Remote::makeStartOrEndTransition(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), GNEViewNetHelper::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()(), GNEViewNetHelper::SelectingArea::processEdgeRectangleSelection(), GNEViewNetHelper::SelectingArea::processRectangleSelection(), TraCIServerAPI_GUI::processSet(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), setx(), NGNode::setY(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), PositionVector::sub(), NBNetBuilder::transformCoordinate(), GNEHierarchicalElementParents::ParentConnections::update(), GNEHierarchicalElementChildren::ChildConnections::update(), GUISUMOAbstractView::updatePositionInformation(), MSBatteryExport::write(), MSEmissionExport::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().
|
inline |
Returns the y-position.
Definition at line 62 of file Position.h.
References myY.
Referenced by MSCFModel_CC::_consensus(), MSPModel_Remote::add(), Boundary::add(), PositionVector::add(), NIXMLNodesHandler::addNode(), MSPModel_Striping::addVehicleFoe(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), NBNode::bezierControlPoints(), GNEAdditional::AdditionalGeometry::calculateMultiShapeRotationsAndLengths(), GNEDemandElement::DemandElementSegmentGeometry::calculatePartialShapeRotationsAndLengths(), GNENetElement::NetElementGeometry::calculateShapeRotationsAndLengths(), GNEAdditional::AdditionalGeometry::calculateShapeRotationsAndLengths(), GNEDemandElement::DemandElementGeometry::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(), GUIVehicle::drawAction_drawCarriageClass(), GNELane::drawArrows(), GUILane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GUISUMOAbstractView::drawDecals(), GLHelper::drawFilledPoly(), GNEEdge::drawGeometryPoints(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEContainerStop::drawGL(), GNEParkingArea::drawGL(), GNEDetectorE3::drawGL(), GNEParkingSpace::drawGL(), GNEDetectorE1::drawGL(), GNEDetectorEntryExit::drawGL(), GNEVariableSpeedSign::drawGL(), GNERerouter::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUIMEInductLoop::MyWrapper::drawGL(), GNEDetectorE1Instant::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIPerson::drawGL(), GUIInstantInductLoop::MyWrapper::drawGL(), GUIContainer::drawGL(), GNEJunction::drawGL(), GUICalibrator::drawGL(), GUIJunctionWrapper::drawGL(), GNECalibrator::drawGL(), GNETAZ::drawGL(), GNEDetectorE2::drawGL(), GUIChargingStation::drawGL(), GUIContainerStop::drawGL(), GUIBusStop::drawGL(), GUIParkingArea::drawGL(), GNEPoly::drawGL(), GNEPOI::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GUIInductLoop::MyWrapper::drawGL(), GNEPerson::drawGL(), GNEVehicle::drawGL(), GNEAdditional::BlockIcon::drawIcon(), GUIPointOfInterest::drawInnerPOI(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GLHelper::drawLine(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GUIBaseVehicle::drawOnPos(), GNEEdge::drawPartialPersonPlan(), GNEViewNetHelper::SelectingArea::drawRectangleSelection(), GNEEdge::drawRerouterSymbol(), GLHelper::drawShapeDottedContourRectangle(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEViewNetHelper::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GLHelper::drawTriangleAtEnd(), GNELane::drawVSSSymbol(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), NIImporter_OpenDrive::geomFromLine(), GNEConnection::getBoundary(), PointOfInterest::getCenter(), GNEJunction::getCenteringBoundary(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), MSCFModel_CC::getParameter(), PositionVector::getPolygonCenter(), GNEVaporizer::getPositionInView(), GNERouteProbe::getPositionInView(), GNEPOI::getPositionInView(), GNEPerson::getPositionInView(), GNEVehicle::getPositionInView(), MSVTKExport::getPositions(), libsumo::InductionLoop::getTree(), GUIDanielPerspectiveChanger::getYPos(), NBHeightMapper::getZ(), GNEInternalLane::GNEInternalLane(), 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(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), NBHeightMapper::loadTiff(), MSPModel_Remote::makeStartOrEndTransition(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), GNEViewNetHelper::SelectingArea::moveRectangleSelection(), GNEViewNetHelper::MoveMultipleElementValues::moveSelection(), GNEViewNetHelper::MoveSingleElementValues::moveSingleElement(), 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()(), GNEViewNetHelper::SelectingArea::processEdgeRectangleSelection(), GNEViewNetHelper::SelectingArea::processRectangleSelection(), TraCIServerAPI_GUI::processSet(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), NGNode::setX(), sety(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), PositionVector::sub(), NBNetBuilder::transformCoordinate(), GNEHierarchicalElementParents::ParentConnections::update(), GNEHierarchicalElementChildren::ChildConnections::update(), 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().
|
inline |
Returns the z-position.
Definition at line 67 of file Position.h.
References myZ.
Referenced by Boundary::add(), PositionVector::add(), GUISettingsHandler::applyViewport(), Boundary::around(), NBNode::bezierControlPoints(), TraCIServerAPI_Simulation::commandPositionConversion(), NBEdge::computeEdgeShape(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), GNEEdge::drawGeometryPoints(), GNEJunction::drawGL(), MSVTypeProbe::execute(), GUIJunctionWrapper::getColorValue(), GNEJunction::getColorValue(), PositionVector::getMaxGrade(), PositionVector::getOverlapWith(), PositionVector::getPolygonCenter(), GNELane::getPopUpMenu(), GUILane::getPopUpMenu(), MSVTKExport::getPositions(), NBNodeShapeComputer::getSmoothCorner(), NBNodeCont::joinNodeCluster(), libsumo::Helper::makeTraCIPosition(), PositionVector::move2side(), GNEJunction::moveGeometry(), GNEEdge::moveShapeEnd(), GNEEdge::moveShapeStart(), libsumo::Vehicle::moveToXY(), GNEEdge::moveVertexShape(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GNENet::registerJunction(), set(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), setz(), PositionVector::slopeDegreeAtOffset(), GNEEdge::smoothElevation(), GNEEdge::smoothShape(), GUISUMOAbstractView::snapToActiveGrid(), NBEdge::startShapeAt(), GNEEdge::straightenElevation(), PositionVector::sub(), MSFCDExport::write(), GNEAdditional::writeAdditional(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), BinaryFormatter::writePosition(), NWFrame::writePositionLong(), and MSFCDExport::writeTransportable().
|
friend |
output operator
Definition at line 174 of file Position.h.
|
static |
used to indicate that a position is valid
Definition at line 285 of file Position.h.
Referenced by NIXMLNodesHandler::addJoinCluster(), MSVehicle::addStop(), MSPModel_Striping::addVehicleFoe(), NBNodeShapeComputer::badIntersection(), NBNode::bezierControlPoints(), MSVehicle::computeAngle(), MSLaneChanger::continueChange(), GLHelper::drawShapeDottedContourPartialShapes(), MSVehicle::enterLaneAtInsertion(), MSVehicle::enterLaneAtLaneChange(), MSVehicle::enterLaneAtMove(), MSVehicle::executeMove(), PositionVector::getCentroid(), GUIPerson::getGUIPosition(), NIXMLShapeHandler::getLanePos(), NLShapeHandler::getLanePos(), PCLoaderXML::getLanePos(), GNEAdditionalHandler::getLanePos(), DummyState::getPosition(), MSPModel_Striping::PState::getPosition(), MSTransportable::Stage_Driving::getPosition(), MSVehicle::getPosition(), MSVehicle::getPositionAlongBestLanes(), MSParkingArea::getVehiclePosition(), MSVehicle::Influencer::implicitSpeedRemote(), PolygonDynamics::initTrackedPosition(), PositionVector::intersectionPosition2D(), invalidPosition(), NBNodeCont::joinNodeCluster(), PCLoaderOSM::loadIfSet(), PositionVector::move2side(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::PState::moveToXY(), GUIDialog_EditViewport::onCmdChanged(), GUIDialog_EditViewport::onCmdOk(), GNEAdditionalHandler::parseAndBuildPOI(), PositionVector::positionAtOffset(), PositionVector::positionAtOffset2D(), MSPerson::MSPersonStage_Driving::proceed(), GUISUMOAbstractView::showViewportEditor(), MSLaneChangerSublane::startChangeSublane(), PositionVector::transformToVectorCoordinates(), PolygonDynamics::update(), MSVehicle::updateState(), and MSVehicle::validatePosition().
|
private |
The x-position.
Definition at line 294 of file Position.h.
Referenced by add(), angleTo2D(), crossProduct(), distanceSquaredTo(), distanceSquaredTo2D(), dotProduct(), isNAN(), mul(), norm2d(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), setx(), sub(), swapXY(), and x().
|
private |
The y-position.
Definition at line 297 of file Position.h.
Referenced by add(), angleTo2D(), crossProduct(), distanceSquaredTo(), distanceSquaredTo2D(), dotProduct(), isNAN(), mul(), norm2d(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), sety(), sub(), swapXY(), and y().
|
private |
The z-position.
Definition at line 300 of file Position.h.
Referenced by add(), crossProduct(), distanceSquaredTo(), dotProduct(), isNAN(), mul(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), setz(), sub(), and z().