|
||||||||||
PREV NEXT | FRAMES NO FRAMES |
Uses of FramePoint in com.yobotics.simulationconstructionset.processedSensors |
---|
Methods in com.yobotics.simulationconstructionset.processedSensors with parameters of type FramePoint | |
---|---|
void |
ProcessedBodyPositionSensorsWriteOnlyInterface.setBodyPosition(FramePoint bodyPosition)
|
Uses of FramePoint in com.yobotics.simulationconstructionset.util |
---|
Methods in com.yobotics.simulationconstructionset.util with parameters of type FramePoint | |
---|---|
void |
PositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
void |
EuclideanPositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
void |
CylindricalCoordinatesPositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
Uses of FramePoint in com.yobotics.simulationconstructionset.util.graphics |
---|
Methods in com.yobotics.simulationconstructionset.util.graphics with parameters of type FramePoint | |
---|---|
void |
DynamicGraphicVector.getBasePosition(FramePoint framePoint)
|
void |
DynamicGraphicCylinder.getBasePosition(FramePoint framePoint)
|
void |
DynamicGraphicPosition.getPosition(FramePoint framePoint)
|
void |
DynamicGraphicAbstractShape.getPosition(FramePoint framePointToPack)
|
void |
BagOfBalls.setBall(FramePoint location)
Sets the next ball to the given location. |
void |
BagOfBalls.setBall(FramePoint location,
AppearanceDefinition appearance)
|
void |
BagOfBalls.setBall(FramePoint location,
AppearanceDefinition appearance,
int ballIndex)
Sets the next ball to the given location, and gives it the given appearance. |
void |
BagOfBalls.setBall(FramePoint location,
int ballIndex)
|
void |
BagOfBalls.setBallLoop(FramePoint location)
Sets the next ball to the given location. |
void |
BagOfBalls.setBallLoop(FramePoint location,
AppearanceDefinition appearance)
Sets the next ball to the given location with the given Appearance. |
void |
DynamicGraphicPosition.setPosition(FramePoint position)
|
void |
DynamicGraphicCoordinateSystem.setPosition(FramePoint position)
|
void |
DynamicGraphicAbstractShape.setPosition(FramePoint position)
|
Uses of FramePoint in com.yobotics.simulationconstructionset.util.math.filter |
---|
Methods in com.yobotics.simulationconstructionset.util.math.filter with parameters of type FramePoint | |
---|---|
void |
AlphaFilteredYoFramePoint.update(FramePoint vectorUnfiltered)
|
Uses of FramePoint in com.yobotics.simulationconstructionset.util.math.frames |
---|
Methods in com.yobotics.simulationconstructionset.util.math.frames that return FramePoint | |
---|---|
FramePoint |
YoFramePoint.getFramePointCopy()
|
Methods in com.yobotics.simulationconstructionset.util.math.frames with parameters of type FramePoint | |
---|---|
void |
YoFramePoint.add(FramePoint point)
|
void |
YoFramePointBuffer.add(FramePoint framePoint)
|
void |
YoFrameVector.add(FramePoint point)
|
void |
YoFramePointBuffer.add(FramePoint framePoint,
AppearanceDefinition appearance)
|
void |
YoFrameVectorBuffer.add(FramePoint framePoint,
FrameVector frameVector)
|
double |
YoFramePoint.distance(FramePoint framePoint)
|
boolean |
YoFramePoint.epsilonEquals(FramePoint framePoint,
double threshold)
|
boolean |
YoFrameVector.epsilonEquals(FramePoint framePoint,
double threshold)
|
void |
YoFramePoint.getFramePoint(FramePoint point)
|
void |
YoFrameVector.getFramePoint(FramePoint point)
|
void |
YoFramePoint.getFramePointAndChangeFrameOfPackedPoint(FramePoint point)
|
void |
YoFramePoint.set(FramePoint point)
|
void |
YoFrameVector.set(FramePoint point)
|
void |
YoFramePointInMultipleFrames.setFramePoint(FramePoint framePoint)
|
void |
YoFramePoint.sub(FramePoint point)
|
void |
YoFrameVector.sub(FramePoint point)
|
void |
YoFrameVector.sub(FramePoint point1,
FramePoint point2)
|
Uses of FramePoint in com.yobotics.simulationconstructionset.util.trajectory |
---|
Methods in com.yobotics.simulationconstructionset.util.trajectory that return FramePoint | |
---|---|
FramePoint |
AdjustableParabolicTrajectory.getEndPoint()
|
FramePoint |
YoSpline3D.getPosition()
|
FramePoint |
YoConcatenatedSplines.getPosition()
|
FramePoint[] |
YoConcatenatedSplinesTest.getRandomPositions(int number)
|
Methods in com.yobotics.simulationconstructionset.util.trajectory with parameters of type FramePoint | |
---|---|
void |
ParabolicPositionTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
ParabolicCartesianTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
CartesianTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
Packs the new desired position, velocity and acceleration. |
void |
AdjustableParabolicTrajectory.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
YoPositionProvider.get(FramePoint positionToPack)
|
void |
PositionProvider.get(FramePoint positionToPack)
|
void |
ParabolicPositionTrajectoryGenerator.get(FramePoint positionToPack)
|
void |
FrameBasedPositionSource.get(FramePoint framePointToPack)
|
void |
ConstantPositionProvider.get(FramePoint positionToPack)
|
void |
YoParabolicTrajectoryGenerator.initialize(FramePoint initialPosition,
FramePoint finalPosition,
double heightAtParameter,
double parameter)
|
void |
YoParabolicTrajectoryGenerator.initialize(FramePoint initialPosition,
FramePoint intermediatePosition,
FramePoint finalPosition,
double intermediateParameter)
|
void |
YoParabolicTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FramePoint finalPosition)
|
void |
ParabolicCartesianTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FrameVector initialAcceleration,
FramePoint finalDesiredPosition,
FrameVector finalDesiredVelocity)
|
void |
CartesianTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FrameVector initialAcceleration,
FramePoint finalDesiredPosition,
FrameVector finalDesiredVelocity)
initializes the trajectory generator with an initial position and velocity, final position and ground height. |
void |
ParabolicCartesianTrajectoryGenerator.packPosition(FramePoint positionToPack)
|
void |
YoParabolicTrajectoryGenerator.packPosition(FramePoint positionToPack,
double parameter)
|
void |
YoPositionProvider.set(FramePoint framePoint)
|
void |
YoSpline3D.setCubic(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf,
FrameVector pdf)
|
void |
YoConcatenatedSplines.setCubicLinearQuinticLinearCubic(double[] fixedPointTimes,
FramePoint[] fixedPointPositions,
FrameVector[] fixedPointVelocities,
double[] intermediateTimes)
|
void |
YoConcatenatedSplines.setCubicQuarticQuinticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoConcatenatedSplines.setCubicQuarticQuinticQuarticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoConcatenatedSplines.setCubicQuinticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoSpline3D.setCubicUsingFinalAccelerationButNotFinalPosition(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setLinear(double t0,
double tf,
FramePoint p0,
FramePoint pf)
|
void |
YoSpline3D.setLinearUsingFinalPositionAndVelocity(double t0,
double tf,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setLinearUsingInitialPositionAndVelocity(double t0,
double tf,
FramePoint p0,
FrameVector pd0)
|
void |
YoConcatenatedSplines.setQuadraticQuinticQuadratic(double[] times,
FramePoint[] positions,
FrameVector initialVelocity,
FrameVector finalVelocity)
|
void |
YoSpline3D.setQuadraticUsingFinalVelocity(double t0,
double tf,
FramePoint p0,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuadraticUsingInitialVelocity(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf)
|
void |
YoConcatenatedSplines.setQuarticLinearQuinticLinearQuartic(double[] fixedPointTimes,
FramePoint[] fixedPointPositions,
FrameVector[] fixedPointVelocities,
double[] intermediateTimes)
|
void |
YoConcatenatedSplines.setQuarticQuinticQuartic(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities)
|
void |
YoSpline3D.setQuarticUsingFinalAcceleration(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setQuarticUsingInitialAcceleration(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuarticUsingIntermediateVelocity(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuintic(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoConcatenatedSplines.setQuintics(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] accelerations)
|
void |
YoConcatenatedSplines.setQuinticSexticQuinticUsingWaypointAndIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double ghostTime,
FramePoint ghostWaypoint,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticSexticQuinticUsingWaypointAndIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double ghostTime,
FramePoint ghostWaypoint,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticsUsingIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoSpline3D.setQuinticUsingIntermediateVelocityAndAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf)
|
void |
YoConcatenatedSplines.setSexticQuinticSexticUsingIntermediateVelocitiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] waypointAccelerations,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoSpline3D.setSexticUsingWaypoint(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint p1,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setSexticUsingWaypointVelocityAndAccelerationAndFinalAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setSexticUsingWaypointVelocityAndAccelerationAndInitialAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf)
|
void |
AdjustableParabolicTrajectory.updateEndPoint(FramePoint newEndPoint)
|
void |
ParabolicPositionTrajectoryGenerator.updateFinalDesiredPosition(FramePoint finalDesiredPosition)
|
void |
ParabolicCartesianTrajectoryGenerator.updateFinalDesiredPosition(FramePoint finalDesiredPosition)
|
void |
CartesianTrajectoryGenerator.updateFinalDesiredPosition(FramePoint finalDesiredPosition)
Changes the final desired position for the trajectory |
void |
AdjustableParabolicTrajectory.updateStartPoint(FramePoint newStartPoint)
|
Constructors in com.yobotics.simulationconstructionset.util.trajectory with parameters of type FramePoint | |
---|---|
AdjustableParabolicTrajectory(java.lang.String trajectoryName,
YoVariableRegistry parentRegistry,
DynamicGraphicObjectsListRegistry graphicsRegistry,
FramePoint startPoint,
FramePoint endPoint,
double apexOfParabola,
int numberOfStepsToVisualize,
double stepTime)
|
|
AdjustableParabolicTrajectory(YoVariableRegistry parentRegistry,
DynamicGraphicObjectsListRegistry graphicsRegistry,
FramePoint startPoint,
FramePoint endPoint,
double apexOfParabola)
|
|
ConstantPositionProvider(FramePoint position)
|
Uses of FramePoint in us.ihmc.utilities.dataStructures.hyperCubeTree |
---|
Constructors in us.ihmc.utilities.dataStructures.hyperCubeTree with parameters of type FramePoint | |
---|---|
SphericalLinearResolutionProvider(FramePoint center,
double radius1,
double innerResolution,
double radius2,
double outerResolution)
|
|
SphericalLinearResolutionProvider(FramePoint center,
OneDimensionalBounds bounds,
double innerResolution,
double exteriorResolution)
|
Uses of FramePoint in us.ihmc.utilities.listeners |
---|
Methods in us.ihmc.utilities.listeners with parameters of type FramePoint | |
---|---|
void |
Listener3DFramed.setLine(java.lang.Object key,
FramePoint endOne,
FramePoint endTwo)
|
void |
Listener3DFramed.setPoint(java.lang.Object key,
FramePoint framePoint)
|
void |
Listener3DFramed.setVector(java.lang.Object key,
FramePoint from,
FrameVector frameVector)
|
Uses of FramePoint in us.ihmc.utilities.math.geometry |
---|
Methods in us.ihmc.utilities.math.geometry that return FramePoint | |
---|---|
FramePoint |
FramePoint.applyTransformCopy(javax.media.j3d.Transform3D transform3D)
|
static FramePoint |
FramePoint.average(java.util.List<? extends FramePoint> framePoints)
|
FramePoint |
FramePoint.changeFrameCopy(ReferenceFrame desiredFrame)
Changes frame of this FramePoint to the given ReferenceFrame and returns a copy. |
static FramePoint[] |
FramePoint.changeFrameCopyBatch(FramePoint[] framePoints,
ReferenceFrame desiredFrame)
|
FramePoint |
FramePoint.changeFrameUsingTransformCopy(ReferenceFrame desiredFrame,
javax.media.j3d.Transform3D transformToNewFrame)
Changes frame of this FramePoint to the given ReferenceFrame, using the given Transform3D and returns a copy. |
FramePoint |
FrameBox3d.getCenter()
|
FramePoint |
FrameBox3d.getCenterCopy()
|
FramePoint |
FrameLine.getFrameOrigin()
|
static FramePoint |
GeometryTools.getIntersectionBetweenLineAndPlane(FramePoint pointOnPlane,
FrameVector planeNormal,
FramePoint lineStart,
FramePoint lineEnd)
Locates and returns the intersection between the given line and plane |
static FramePoint |
FramePoint.getMidPoint(FramePoint point1,
FramePoint point2)
|
FramePoint |
FrameLine.getOriginInFrame(ReferenceFrame desiredFrame)
|
FramePoint |
FramePlane3d.getPointCopy()
|
FramePoint |
FramePose.getPositionCopy()
|
FramePoint |
FramePose.getPositionInFrame(ReferenceFrame referenceFrame)
|
FramePoint |
FramePose.getPostionCopy()
|
static FramePoint |
FramePoint.load(java.io.BufferedReader bufferedReader,
ReferenceFrame referenceFrame)
|
static FramePoint |
FramePoint.morph(FramePoint point1,
FramePoint point2,
double alpha)
|
FramePoint |
FrameTorus3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameShape3d.orthogonalProjectionCopy(FramePoint pointToCheck)
Find the closest point on the surface of this shape to the given point. |
FramePoint |
FrameRamp3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FramePlane3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameEllipsoid3d.orthogonalProjectionCopy(FramePoint pointToCheck)
|
FramePoint |
FrameCylinder3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameBox3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FramePoint.pitchAboutPoint(FramePoint pointToPitchAbout,
double pitch)
|
FramePoint |
FramePoint2d.toFramePoint()
Creates a new FramePoint based on the x and y components of this FramePoint2d |
FramePoint |
FramePoint.yawAboutPoint(FramePoint pointToYawAbout,
double yaw)
yawAboutPoint |
Methods in us.ihmc.utilities.math.geometry with parameters of type FramePoint | |
---|---|
void |
FrameVector.add(FramePoint framePoint)
|
void |
FramePoint.add(FramePoint framePoint)
|
void |
FramePoint.add(FramePoint point1,
FramePoint point2)
|
void |
FramePoint.add(FramePoint point1,
FrameVector vector2)
|
void |
FramePoint.add(FrameVector vector1,
FramePoint point2)
|
static FramePoint[] |
FramePoint.changeFrameCopyBatch(FramePoint[] framePoints,
ReferenceFrame desiredFrame)
|
static ReferenceFrame |
ReferenceFrame.constructReferenceFrameFromPointAndZAxis(java.lang.String frameName,
FramePoint point,
FrameVector zAxis)
|
void |
FrameVector.cross(FramePoint f1,
FramePoint f2)
|
void |
FrameVector.cross(FramePoint f1,
FrameVector f2)
|
void |
FrameVector.cross(FrameVector f1,
FramePoint f2)
|
double |
FrameTorus3d.distance(FramePoint point)
|
double |
FrameShape3d.distance(FramePoint point)
Find the distance from the closest point on this shape to the given point. |
double |
FrameRamp3d.distance(FramePoint point)
|
double |
FramePoint.distance(FramePoint framePoint)
|
double |
FramePlane3d.distance(FramePoint point)
|
double |
FrameEllipsoid3d.distance(FramePoint point)
|
double |
FrameCylinder3d.distance(FramePoint point)
|
double |
FrameBox3d.distance(FramePoint point)
|
double |
FramePoint.distanceSquared(FramePoint framePoint)
|
boolean |
FrameVector.epsilonEquals(FramePoint framePoint,
double threshold)
|
boolean |
FramePoint.epsilonEquals(FramePoint framePoint,
double threshold)
|
static double |
CylindricalCoordinatesCalculator.getAngle(FramePoint position)
|
static double |
CylindricalCoordinatesCalculator.getAngularVelocity(FramePoint position,
FrameVector velocity)
|
void |
FrameBox3d.getCenter(FramePoint pointToPack)
|
void |
FrameTorus3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameShape3d.getClosestPointAndNormalAt(FramePoint closestPointToPack,
FrameVector normalToPack,
FramePoint pointInWorldToCheck)
Find the closest point on the surface of this shape to the given point as well as the surface normal at that point. |
void |
FrameRamp3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameEllipsoid3d.getClosestPointAndNormalAt(FramePoint closestPointToPack,
FrameVector normalToPack,
FramePoint pointInWorldToCheck)
|
void |
FrameCylinder3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameBox3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
static void |
GeometryTools.getClosestPointsForTwoLines(FramePoint point1,
FrameVector vector1,
FramePoint point2,
FrameVector vector2,
FramePoint pointOnLine1,
FramePoint pointOnLine2)
|
static FramePoint |
GeometryTools.getIntersectionBetweenLineAndPlane(FramePoint pointOnPlane,
FrameVector planeNormal,
FramePoint lineStart,
FramePoint lineEnd)
Locates and returns the intersection between the given line and plane |
static FramePoint |
FramePoint.getMidPoint(FramePoint point1,
FramePoint point2)
|
static FrameVector |
GeometryTools.getPerpendicularVectorFromLineToPoint(FramePoint point,
FramePoint lineStart,
FramePoint lineEnd,
FramePoint intersectionPoint)
Returns the Perpendicular Vector that is formed between a given Line (defined by two points) and a given point Returns zeros if point is located on the line |
static FrameVector |
GeometryTools.getPlaneNormalGivenThreePoints(FramePoint point1,
FramePoint point2,
FramePoint point3)
Returns the Normal of a plane that is defined by three points Returns a null if three points are linear, colinear, or equal Returns a null if two points are the same |
void |
FramePlane3d.getPoint(FramePoint pointToPack)
|
void |
FramePose.getPosition(FramePoint framePointToPack)
|
static void |
CylindricalCoordinatesCalculator.getPosition(FramePoint pointToPack,
ReferenceFrame frame,
double angle,
double radius,
double z)
|
static double |
CylindricalCoordinatesCalculator.getRadialVelocity(FramePoint position,
FrameVector velocity)
|
static double |
CylindricalCoordinatesCalculator.getRadius(FramePoint position)
|
static FrameOrientation |
GeometryTools.getTransform(FramePoint point,
FrameVector normal)
|
static double |
GeometryTools.getXYDistance(FramePoint point1,
FramePoint point2)
|
double |
FramePoint.getXYplaneDistance(FramePoint framePoint)
|
static void |
GeometryTools.getZPlanePerpendicularBisector(FramePoint lineStart,
FramePoint lineEnd,
FramePoint bisectorStart,
FrameVector bisectorDirection)
|
void |
FramePoint.interpolate(FramePoint framePoint1,
FramePoint framePoint2,
double alpha)
|
boolean |
FrameTorus3d.isInsideOrOnSurface(FramePoint pointToTest)
|
boolean |
FrameShape3d.isInsideOrOnSurface(FramePoint pointToCheck)
Determine whether the given point is on or inside the surface of this shape. |
boolean |
FrameRamp3d.isInsideOrOnSurface(FramePoint pointToTest)
|
boolean |
FrameEllipsoid3d.isInsideOrOnSurface(FramePoint pointToCheck)
|
boolean |
FrameCylinder3d.isInsideOrOnSurface(FramePoint pointToTest)
|
boolean |
FrameBox3d.isInsideOrOnSurface(FramePoint pointToTest)
|
boolean |
FrameTorus3d.isInsideOrOnSurface(FramePoint pointToTest,
double epsilon)
|
boolean |
FrameShape3d.isInsideOrOnSurface(FramePoint pointToCheck,
double epsilon)
Determine whether the given point is on or inside the surface of this shape, within a given tolerance or error level. |
boolean |
FrameRamp3d.isInsideOrOnSurface(FramePoint pointToTest,
double epsilon)
|
boolean |
FrameEllipsoid3d.isInsideOrOnSurface(FramePoint pointToCheck,
double epsilon)
|
boolean |
FrameCylinder3d.isInsideOrOnSurface(FramePoint pointToTest,
double epsilon)
|
boolean |
FrameBox3d.isInsideOrOnSurface(FramePoint pointToTest,
double epsilon)
|
boolean |
FramePlane3d.isOnOrAbove(FramePoint pointToTest)
|
boolean |
FramePlane3d.isOnOrBelow(FramePoint pointToTest)
|
static boolean |
GeometryTools.isPointOnLeftSideOfLine(FramePoint point,
FramePoint lineStart,
FramePoint lineEnd)
Returns a Boolean value stating whether a point is on the left side of a given line |
static double |
GeometryTools.minimumDistance(FramePoint testPoint,
java.util.List<FramePoint> points)
|
static FramePoint |
FramePoint.morph(FramePoint point1,
FramePoint point2,
double alpha)
|
void |
FrameTorus3d.orthogonalProjection(FramePoint point)
|
void |
FrameShape3d.orthogonalProjection(FramePoint pointToCheckAndPack)
Find the closest point on the surface of this shape to the given point. |
void |
FrameRamp3d.orthogonalProjection(FramePoint point)
|
void |
FramePlane3d.orthogonalProjection(FramePoint point)
|
void |
FrameEllipsoid3d.orthogonalProjection(FramePoint pointToCheckAndPack)
|
void |
FrameCylinder3d.orthogonalProjection(FramePoint point)
|
void |
FrameBox3d.orthogonalProjection(FramePoint point)
|
FramePoint |
FrameTorus3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameShape3d.orthogonalProjectionCopy(FramePoint pointToCheck)
Find the closest point on the surface of this shape to the given point. |
FramePoint |
FrameRamp3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FramePlane3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameEllipsoid3d.orthogonalProjectionCopy(FramePoint pointToCheck)
|
FramePoint |
FrameCylinder3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FrameBox3d.orthogonalProjectionCopy(FramePoint point)
|
FramePoint |
FramePoint.pitchAboutPoint(FramePoint pointToPitchAbout,
double pitch)
|
void |
FrameVector.scale(double scaleFactor,
FramePoint point1)
Sets the value of this tuple to the scalar multiplication of vertor1 (this = s * t1). |
void |
FramePoint.scale(double scaleFactor,
FramePoint point1)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FramePoint point1)
Sets the value of this tuple to the scalar multiplication of itself and then adds tuple t1 (this = s*this + t1). |
void |
FramePoint.scaleAdd(double scaleFactor,
FramePoint point1)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FramePoint point1,
FramePoint point2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2). |
void |
FramePoint.scaleAdd(double scaleFactor,
FramePoint point1,
FramePoint point2)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FramePoint point1,
FrameVector vector2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2). |
void |
FramePoint.scaleAdd(double scaleFactor,
FramePoint point1,
FrameVector vector2)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FrameVector vector1,
FramePoint point2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2). |
void |
FramePoint.scaleAdd(double scaleFactor,
FrameVector vector1,
FramePoint point2)
|
void |
FrameVector.set(FramePoint framePoint)
|
void |
FramePoint.set(FramePoint framePoint)
|
void |
FrameVector.setAndChangeFrame(FramePoint framePoint)
|
void |
FramePoint.setAndChangeFrame(FramePoint framePoint)
|
void |
OriginAndPointFrame.setOriginAndPositionToPointAt(FramePoint origin,
FramePoint positionToPointAt)
|
void |
XYPlaneFrom3PointsFrame.setPoints(FramePoint p1,
FramePoint p2,
FramePoint p3)
|
void |
FramePose.setPosition(FramePoint position)
|
void |
PointXAxisAtPositionFrame.setPositionToPointAt(FramePoint positionToPointAt)
|
void |
FrameVector.sub(FramePoint framePoint)
|
void |
FramePoint.sub(FramePoint framePoint)
|
void |
FrameVector.sub(FramePoint point1,
FramePoint point2)
|
void |
FramePoint.sub(FramePoint point1,
FramePoint point2)
|
void |
FramePoint.sub(FramePoint point1,
FrameVector vector2)
|
void |
FramePoint.sub(FrameVector vector1,
FramePoint point2)
|
static double[] |
FramePoint.toArray(FramePoint[] framePoints)
|
void |
PoseReferenceFrame.updatePose(FramePoint position,
FrameOrientation orientation)
|
void |
PoseReferenceFrame.updatePosition(FramePoint framePoint)
|
void |
FramePoint.weightedAverage(FramePoint point1,
FramePoint point2,
double weightedAverage)
Sets this point to be the weighted average of the two input points. |
FramePoint |
FramePoint.yawAboutPoint(FramePoint pointToYawAbout,
double yaw)
yawAboutPoint |
Method parameters in us.ihmc.utilities.math.geometry with type arguments of type FramePoint | |
---|---|
static FramePoint |
FramePoint.average(java.util.List<? extends FramePoint> framePoints)
|
static java.util.ArrayList<FramePoint2d> |
GeometryTools.changeFrameToZUpAndProjectToXYPlane(ReferenceFrame zUpFrame,
java.util.List<FramePoint> points)
|
static FrameConvexPolygon2d |
FrameConvexPolygon2d.constructByProjectionOntoXYPlane(java.util.List<FramePoint> points,
ReferenceFrame frame)
|
static double |
GeometryTools.minimumDistance(FramePoint testPoint,
java.util.List<FramePoint> points)
|
static java.util.ArrayList<FramePoint2d> |
GeometryTools.projectToXYPlane(java.util.List<FramePoint> points)
|
Constructors in us.ihmc.utilities.math.geometry with parameters of type FramePoint | |
---|---|
FrameLine(FramePoint origin,
FrameVector direction)
|
|
FramePlane3d(FrameVector normal,
FramePoint point)
|
|
FramePoint(FramePoint framePoint)
|
|
FramePoint(FramePoint framePoint,
java.lang.String name)
|
|
FramePose(FramePoint position,
FrameOrientation orientation)
|
|
FrameVector(FramePoint framePoint)
FrameVector Turns a FramePoint into a FrameVector. |
|
FrameVector(FramePoint framePoint,
java.lang.String name)
|
|
TranslationFrame(FramePoint framePoint)
|
|
ZUpFrame(ReferenceFrame worldFrame,
FramePoint origin,
java.lang.String name)
|
Uses of FramePoint in us.ihmc.utilities.math.trajectories |
---|
Methods in us.ihmc.utilities.math.trajectories that return FramePoint | |
---|---|
FramePoint |
WaypointMotionGenerator.getCurrentDesiredPoint(double timeInMove)
|
FramePoint |
ListOfPointsTrajectory.FramePointAndAlpha.getFramePoint()
|
FramePoint |
ListOfPointsTrajectory.getPointOnPath(double alpha)
|
FramePoint |
ListOfPointsTrajectory.getPointOnPathAndAddToInternalList(double alpha)
|
FramePoint |
ListOfPointsTrajectory.getPointOnPathDistanceFromStart(double distanceFromStart)
|
FramePoint |
ListOfPointsTrajectory.getPointOnPathDistanceFromStartAndAddToInternalList(double distanceFromStart)
|
Methods in us.ihmc.utilities.math.trajectories that return types with arguments of type FramePoint | |
---|---|
static java.util.ArrayList<FramePoint> |
ListOfPointsTrajectory.expandList(java.util.ArrayList<FramePoint> listOfPoints,
int numberOfPoints)
|
static java.util.ArrayList<FramePoint> |
Parabolic3dCurveGenerator.generate3dParabola(FramePoint startPoint,
FramePoint endPoint,
double apexOfParabola,
int numberOfPointsToGenerate)
|
java.util.ArrayList<FramePoint> |
ListOfPointsTrajectory.getOriginalList()
|
java.util.ArrayList<FramePoint> |
PointSpliner.getSplinedPoints(int numberOfPoints)
|
Methods in us.ihmc.utilities.math.trajectories with parameters of type FramePoint | |
---|---|
static java.util.ArrayList<FramePoint> |
Parabolic3dCurveGenerator.generate3dParabola(FramePoint startPoint,
FramePoint endPoint,
double apexOfParabola,
int numberOfPointsToGenerate)
|
static ListOfPointsTrajectory |
Parabolic3dCurveGenerator.generateParabolicListOfPointsTrajectory(FramePoint startPoint,
FramePoint endPoint,
double apexOfParabola,
int numberOfPointsToGenerate)
Parabolic3dGenerator gets start & end frame points in cartesian coordinate, and creates a z-splined trajectory as the output. |
double |
ListOfPointsTrajectory.getAlpha(FramePoint pointToCheck)
|
int |
ListOfPointsTrajectory.getIndexOfClosestPoint(FramePoint pointToCheck)
|
Method parameters in us.ihmc.utilities.math.trajectories with type arguments of type FramePoint | |
---|---|
static java.util.ArrayList<FramePoint> |
ListOfPointsTrajectory.expandList(java.util.ArrayList<FramePoint> listOfPoints,
int numberOfPoints)
|
Constructor parameters in us.ihmc.utilities.math.trajectories with type arguments of type FramePoint | |
---|---|
ListOfPointsTrajectory(java.util.ArrayList<FramePoint> listOfPointsForSegment)
|
|
PointSpliner(java.util.ArrayList<FramePoint> listOfPoints)
|
|
PointSpliner(java.util.ArrayList<FramePoint> listOfPoints,
FrameVector initialHeading,
FrameVector finalHeading)
|
Uses of FramePoint in us.ihmc.utilities.screwTheory |
---|
Methods in us.ihmc.utilities.screwTheory that return FramePoint | |
---|---|
FramePoint |
CenterOfMassCalculator.getCenterOfMass()
|
FramePoint |
GeneralizedRigidBodyInertia.getCenterOfMassOffset()
|
FramePoint |
PointJacobian.getPoint()
|
Methods in us.ihmc.utilities.screwTheory with parameters of type FramePoint | |
---|---|
void |
SpatialAccelerationVector.packAccelerationOfPointFixedInBodyFrame(Twist twist,
FramePoint pointFixedInBodyFrame,
FrameVector frameVectorToPack)
Packs the linear acceleration of a point that is fixed in bodyFrame but is expressed in baseFrame, with respect to baseFrame, expressed in expressedInFrame |
void |
CenterOfMassCalculator.packCenterOfMass(FramePoint centerOfMassToPack)
|
void |
RigidBody.packCoMOffset(FramePoint comOffsetToPack)
|
void |
SpatialAccelerationCalculator.packLinearAccelerationOfBodyFixedPoint(FrameVector linearAccelerationToPack,
RigidBody body,
FramePoint bodyFixedPoint)
|
void |
SpatialAccelerationCalculator.packLinearAccelerationOfBodyFixedPoint(FrameVector linearAccelerationToPack,
RigidBody base,
RigidBody body,
FramePoint bodyFixedPoint)
|
void |
Twist.packVelocityOfPointFixedInBodyFrame(FrameVector frameVectorToPack,
FramePoint pointFixedInBodyFrame)
Packs the linear velocity of a point that is fixed in bodyFrame but is expressed in baseFrame, with respect to baseFrame, expressed in expressedInFrame |
void |
PointJacobian.set(GeometricJacobian geometricJacobian,
FramePoint point)
|
Uses of FramePoint in us.ihmc.utilities.test |
---|
Methods in us.ihmc.utilities.test with parameters of type FramePoint | |
---|---|
static void |
JUnitTools.assertFramePointEquals(FramePoint expected,
FramePoint actual,
double delta)
|
|
||||||||||
PREV NEXT | FRAMES NO FRAMES |