- 使用 Spring Initializr 创建 Spring Boot 应用程序
- 在Spring Boot中配置Cassandra
- 在 Spring Boot 上配置 Tomcat 连接池
- 将Camel消息路由到嵌入WildFly的Artemis上
本文整理了Java中us.ihmc.simulationconstructionset.yoUtilities.graphics.YoGraphicsListRegistry
类的一些代码示例,展示了YoGraphicsListRegistry
类的具体用法。这些代码示例主要来源于Github
/Stackoverflow
/Maven
等平台,是从一些精选项目中提取出来的代码,具有较强的参考意义,能在一定程度帮忙到你。YoGraphicsListRegistry
类的具体详情如下:
包路径:us.ihmc.simulationconstructionset.yoUtilities.graphics.YoGraphicsListRegistry
类名称:YoGraphicsListRegistry
暂无
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public FootstepGeneratorVisualizer(int maxNumberOfContacts, int maxPointsPerContact, YoVariableRegistry parentRegistry,
YoGraphicsListRegistry yoGraphicsListRegistry)
{
YoGraphicsList yoGraphicsList = new YoGraphicsList("FootstepGeneratorVisualizer");
AppearanceDefinition[] appearances = new AppearanceDefinition[] { YoAppearance.Red(), YoAppearance.Green(), YoAppearance.Blue(), YoAppearance.Purple() };
for (int i = 0; i < maxNumberOfContacts; i++)
{
YoFramePose contactPose = new YoFramePose("contactPose" + i, "", worldFrame, registry);
contactPoses.add(contactPose);
YoFrameConvexPolygon2d contactPolygon = new YoFrameConvexPolygon2d("contactPolygon" + i, "", worldFrame, maxPointsPerContact, registry);
contactPolygonsWorld.add(contactPolygon);
YoGraphicPolygon dynamicGraphicPolygon = new YoGraphicPolygon("contactPolygon" + i, contactPolygon, contactPose, 1.0, appearances[i
% appearances.length]);
yoGraphicsList.add(dynamicGraphicPolygon);
}
yoGraphicsListRegistry.registerYoGraphicsList(yoGraphicsList);
parentRegistry.addChild(registry);
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public ActualCMPComputer(boolean createViz, SimulationConstructionSet scs, HumanoidFloatingRootJointRobot simulatedRobot)
{
this.simulatedRobot = simulatedRobot;
simulateDT = scs.getDT();
gravity = simulatedRobot.getGravityZ();
momentumChange = FilteredVelocityYoFrameVector.createFilteredVelocityYoFrameVector("rateOfChangeLinearMomentum", "", alpha, simulateDT, registry, yoLinearMomentum);
if (createViz)
{
yoGraphicsListRegistry = new YoGraphicsListRegistry();
YoArtifactPosition cmpViz = new YoArtifactPosition("SimulationCMP", yoCmp.getYoX(), yoCmp.getYoY(),
GraphicType.BALL_WITH_CROSS, Color.RED , 0.005);
cmpViz.setVisible(visibleByDefault);
yoGraphicsListRegistry.registerArtifact(getClass().getSimpleName(), cmpViz);
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
}
else
{
yoGraphicsListRegistry = null;
}
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public final void setLogDataProcessor(LogDataProcessorFunction logDataProcessor)
{
YoGraphicsListRegistry yoGraphicsListRegistry = logDataProcessor.getYoGraphicsListRegistry();
if (yoGraphicsListRegistry != null)
{
yoGraphicsListRegistry.addArtifactListsToPlotter(plotter);
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
}
logDataProcessorWrapper.addLogDataProcessor(logDataProcessor);
}
代码示例来源:origin: us.ihmc/RobotDataCommunication
public void addDynamicGraphicObjects(YoGraphicsListRegistry yoGraphicsListRegistry)
yoGraphicsListRegistry.getRegisteredDynamicGraphicObjectsLists(yoGraphicsLists);
DynamicGraphicMessage.Builder msg;
for (YoGraphicsList yoGraphicsList : yoGraphicsLists)
yoGraphicsListRegistry.getRegisteredArtifactLists(artifactLists);
代码示例来源:origin: us.ihmc/RobotDataCommunication
yoGraphicsListRegistry.registerYoGraphicsList(dgoListMap.get(list));
yoGraphicsListRegistry.registerArtifactList(artifactList);
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
this.robotSide = robotSide;
yoGraphicsListRegistry = new YoGraphicsListRegistry();
yoGraphicsListRegistry.registerYoGraphic("drillComViz", yoWristCoordinateSystem);
yoGraphicsListRegistry.registerYoGraphic("drillToolTipViz", yoToolTip);
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public static void main(String[] args)
{
YoGraphicsListRegistry yoGraphicsListRegistry = new YoGraphicsListRegistry();
DRCDemoEnvironmentSimpleSteeringWheelContact env = new DRCDemoEnvironmentSimpleSteeringWheelContact(yoGraphicsListRegistry);
List<Robot> robots = env.getEnvironmentRobots();
Robot[] robotArray = new Robot[robots.size()];
robots.toArray(robotArray);
SimulationConstructionSetParameters parameters = new SimulationConstructionSetParameters();
parameters.setDataBufferSize(36000);
SimulationConstructionSet scs = new SimulationConstructionSet(robotArray, parameters);
scs.setDT(1e-4, 20);
TerrainObject3D terrainObject = env.getTerrainObject3D();
scs.addStaticLinkGraphics(terrainObject.getLinkGraphics());
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
scs.setGroundVisible(false);
scs.startOnAThread();
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicPosition("centerOfMass", centerOfMassPosition, 0.03, YoAppearance.Gold()));
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicPosition("centerOfMass2d", centerOfMassPosition2d, 0.03, YoAppearance.Gold()));
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicPosition(sidePrefix + "AnkleViz", anklePositions.get(robotSide), 0.05, appearance.get(robotSide)));
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicPosition(sidePrefix + "WristViz", wristPositions.get(robotSide), 0.05, appearance.get(robotSide)));
yoGraphicsListRegistry.registerYoGraphic(listName, footCoordinateSystem);
feetCoordinateSystems.put(robotSide, footCoordinateSystem);
yoGraphicsListRegistry.registerYoGraphic(listName, handCoordinateSystem);
handCoordinateSystems.put(robotSide, handCoordinateSystem);
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
yoGraphicsListRegistry.registerYoGraphics("EFP", efp_positionViz);
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public OverallDesiredCoPProcessor(LogDataProcessorHelper logDataProcessorHelper)
{
this.logDataProcessorHelper = logDataProcessorHelper;
yoGraphicsListRegistry.registerArtifact("Desired Center of Pressure", new YoGraphicPosition("Desired Overall Center of Pressure", admissibleDesiredCenterOfPressure, 0.008, YoAppearance.Navy(), GraphicType.BALL).createArtifact());
centerOfMassFrame = logDataProcessorHelper.getReferenceFrames().getCenterOfMassFrame();
admissibleDesiredGroundReactionTorque = logDataProcessorHelper.findYoFrameVector("admissibleDesiredGroundReactionTorque", centerOfMassFrame);
admissibleDesiredGroundReactionForce = logDataProcessorHelper.findYoFrameVector("admissibleDesiredGroundReactionForce", centerOfMassFrame);
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
@Override
public void write(long timestamp)
{
try
{
long startTimestamp = estimatorTime.getLongValue();
threadDataSynchronizer.publishEstimatorState(startTimestamp, estimatorTick.getLongValue(), startClockTime.getLongValue());
if (robotVisualizer != null)
{
robotVisualizer.update(startTimestamp);
}
estimatorTick.increment();
rootFrame.getTransformToDesiredFrame(rootToWorldTransform, ReferenceFrame.getWorldFrame());
yoGraphicsListRegistry.setControllerTransformToWorld(rootToWorldTransform);
}
catch (Throwable e)
{
if (globalDataProducer != null)
{
globalDataProducer.notifyControllerCrash(CrashLocation.ESTIMATOR_WRITE, e.getMessage());
}
throw new RuntimeException(e);
}
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public static void main(String argv[]) throws FileNotFoundException, JAXBException, MalformedURLException
{
Robot robot = new Robot("robot");
SimulationConstructionSet scs = new SimulationConstructionSet(robot);
DRCVehicleSDFLoader drcVehicleSDFLoader = new DRCVehicleSDFLoader();
scs.addStaticLinkGraphics(drcVehicleSDFLoader.loadDRCVehicle(false));
RigidBodyTransform vehicleToWorldTransform = new RigidBodyTransform();
ReferenceFrame vehicleFrame = ReferenceFrame.constructFrameWithUnchangingTransformToParent("vehicle", ReferenceFrame.getWorldFrame(),
vehicleToWorldTransform, false, true, true);
VehicleModelObjects vehicleModelObjects = new VehicleModelObjects();
YoGraphicsListRegistry yoGraphicsListRegistry = new YoGraphicsListRegistry();
YoVariableRegistry registry = scs.getRootRegistry();
VehicleModelObjectVisualizer vehicleModelObjectVisualizer = new VehicleModelObjectVisualizer(vehicleFrame, vehicleModelObjects, yoGraphicsListRegistry, registry);
vehicleModelObjectVisualizer.setVisible(true);
vehicleModelObjectVisualizer.update();
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
Thread thread = new Thread(scs);
thread.start();
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
YoGraphicCoordinateSystem desiredFootPoseViz = new YoGraphicCoordinateSystem(sidePrefix + "DesiredFootPose", "", registry, 0.2);
desiredFootPosesViz.put(robotSide, desiredFootPoseViz);
yoGraphicsListRegistry.registerYoGraphic("DesiredCoords", desiredHandPoseViz);
yoGraphicsListRegistry.registerYoGraphic("DesiredCoords", desiredFootPoseViz);
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
private void addSupportBaseGraphics(YoGraphicsListRegistry yoGraphicsListRegistry,YoFramePoint[] basePoints, ArrayList<YoGraphic> basePointsList, ArrayList<YoGraphic> linesList, String namePrefix,AppearanceDefinition appearance)
{
AppearanceDefinition[] colors = { YoAppearance.Red(), YoAppearance.Green(), YoAppearance.Blue(), YoAppearance.Yellow() };
YoGraphicsList yoGraphicsList = new YoGraphicsList(namePrefix + "Points");
for (int i = 0; i < basePoints.length; i++)
{
YoGraphicPosition baseControlPointViz = new YoGraphicPosition(namePrefix + "Point" + i, basePoints[i], 0.01, colors[i]);
yoGraphicsList.add(baseControlPointViz);
basePointsList.add(baseControlPointViz);
for (int j = i + 1; j < basePoints.length; j++)
{
YoGraphicLineSegment dynamicGraphicLineSegment = new YoGraphicLineSegment(namePrefix + "SupportLine", basePoints[i], basePoints[j],
1.0, appearance, false);
yoGraphicsList.add(dynamicGraphicLineSegment);
linesList.add(dynamicGraphicLineSegment);
}
}
if (yoGraphicsListRegistry != null)
yoGraphicsListRegistry.registerYoGraphicsList(yoGraphicsList);
yoGraphicsList.hideYoGraphics();
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public static void visualizeFootsteps(Robot nullRobot, List<Footstep> footsteps, List<ContactablePlaneBody> contactablePlaneBodies)
{
SimulationConstructionSet scs = new SimulationConstructionSet(nullRobot);
scs.setDT(0.25, 1);
YoVariableRegistry rootRegistry = scs.getRootRegistry();
YoGraphicsListRegistry yoGraphicsListRegistry = new YoGraphicsListRegistry();
int maxNumberOfContacts = 2;
int maxPointsPerContact = 4;
FootstepGeneratorVisualizer footstepGeneratorVisualizer = new FootstepGeneratorVisualizer(maxNumberOfContacts, maxPointsPerContact, rootRegistry,
yoGraphicsListRegistry);
scs.addYoGraphicsListRegistry(yoGraphicsListRegistry);
footstepGeneratorVisualizer.addFootstepsAndTickAndUpdate(scs, footsteps, contactablePlaneBodies);
scs.startOnAThread();
deleteFirstDataPointAndCropData(scs);
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
handIKs.put(robotSide, handIK);
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicCoordinateSystem(sidePrefix + "FootViz", footIK, scale));
yoGraphicsListRegistry.registerYoGraphic(listName, new YoGraphicCoordinateSystem(sidePrefix + "HandViz", handIK, scale));
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public DRCSimulationVisualizer(Robot robot, YoGraphicsListRegistry yoGraphicsListRegistry)
{
this.robot = robot;
YoGraphicsList yoGraphicsList = new YoGraphicsList("Simulation Viz");
ArrayList<GroundContactPoint> groundContactPoints = robot.getAllGroundContactPoints();
AppearanceDefinition appearance = YoAppearance.Red(); // BlackMetalMaterial();
for (GroundContactPoint groundContactPoint : groundContactPoints)
{
double scaleFactor = 0.0015;
YoGraphicVector dynamicGraphicVector = new YoGraphicVector(groundContactPoint.getName(), groundContactPoint.getYoPosition(), groundContactPoint.getYoForce(), scaleFactor, appearance);
yoGraphicsList.add(dynamicGraphicVector);
}
if (yoGraphicsListRegistry != null)
yoGraphicsListRegistry.registerYoGraphicsList(yoGraphicsList);
robot.setController(this, 10);
}
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public DRCDemo03(DRCGuiInitialSetup guiInitialSetup, DRCRobotModel robotModel, DRCRobotInitialSetup<HumanoidFloatingRootJointRobot> robotInitialSetup)
YoGraphicsListRegistry yoGraphicsListRegistry = new YoGraphicsListRegistry();
代码示例来源:origin: us.ihmc/DarpaRoboticsChallenge
public VehicleModelObjectVisualizer(ReferenceFrame vehicleFrame, VehicleModelObjects vehicleModelObjects, YoGraphicsListRegistry yoGraphicsListRegistry,
YoVariableRegistry parentRegistry)
{
yoGraphicsList = new YoGraphicsList("vehicleObjects");
for (VehicleObject vehicleObject : VehicleObject.values())
{
FramePose framePose = vehicleModelObjects.getFramePose(vehicleFrame, vehicleObject);
String objectName = FormattingTools.underscoredToCamelCase(vehicleObject.toString(), false);
ReferenceFrame objectFrame = new PoseReferenceFrame(objectName, framePose);
objectFrame.update();
YoGraphicReferenceFrame dynamicGraphicReferenceFrame = new YoGraphicReferenceFrame(objectFrame, registry, objectFrameScale);
yoGraphicsList.add(dynamicGraphicReferenceFrame);
}
YoGraphicReferenceFrame vehicleFrameViz = new YoGraphicReferenceFrame(vehicleFrame, registry, vehicleFrameScale);
yoGraphicsList.add(vehicleFrameViz);
yoGraphicsListRegistry.registerYoGraphicsList(yoGraphicsList);
parentRegistry.addChild(registry);
}
本文整理了Java中us.ihmc.robotDataLogger.YoVariableServer类的一些代码示例,展示了YoVariableServer类的具体用法。这些代码示例主要来源于Gith
本文整理了Java中us.ihmc.robotDataLogger.YoVariableClient类的一些代码示例,展示了YoVariableClient类的具体用法。这些代码示例主要来源于Gith
本文整理了Java中us.ihmc.kalman.YoKalmanFilter类的一些代码示例,展示了YoKalmanFilter类的具体用法。这些代码示例主要来源于Github/Stackoverf
本文整理了Java中us.ihmc.robotDataLogger.YoVariablesUpdatedListener类的一些代码示例,展示了YoVariablesUpdatedListener类的
本文整理了Java中us.ihmc.robotics.screwTheory.Wrench类的一些代码示例,展示了Wrench类的具体用法。这些代码示例主要来源于Github/Stackoverflo
本文整理了Java中us.ihmc.mecano.spatial.Wrench类的一些代码示例,展示了Wrench类的具体用法。这些代码示例主要来源于Github/Stackoverflow/Mave
本文整理了Java中us.ihmc.yoVariables.variable.YoVariable类的一些代码示例,展示了YoVariable类的具体用法。这些代码示例主要来源于Github/Stac
本文整理了Java中us.ihmc.yoVariables.variable.YoLong类的一些代码示例,展示了YoLong类的具体用法。这些代码示例主要来源于Github/Stackoverflo
本文整理了Java中us.ihmc.yoVariables.variable.YoFrameVector3D类的一些代码示例,展示了YoFrameVector3D类的具体用法。这些代码示例主要来源于G
本文整理了Java中us.ihmc.yoVariables.variable.YoEnum类的一些代码示例,展示了YoEnum类的具体用法。这些代码示例主要来源于Github/Stackoverflo
本文整理了Java中us.ihmc.yoVariables.variable.YoFramePoint3D类的一些代码示例,展示了YoFramePoint3D类的具体用法。这些代码示例主要来源于Git
本文整理了Java中us.ihmc.graphicsDescription.yoGraphics.YoGraphicsList类的一些代码示例,展示了YoGraphicsList类的具体用法。这些代码
本文整理了Java中us.ihmc.yoVariables.variable.YoBoolean类的一些代码示例,展示了YoBoolean类的具体用法。这些代码示例主要来源于Github/Stacko
本文整理了Java中us.ihmc.yoVariables.variable.YoInteger类的一些代码示例,展示了YoInteger类的具体用法。这些代码示例主要来源于Github/Stacko
本文整理了Java中us.ihmc.graphicsDescription.yoGraphics.YoGraphicPosition类的一些代码示例,展示了YoGraphicPosition类的具体用
本文整理了Java中us.ihmc.graphicsDescription.appearance.YoAppearance类的一些代码示例,展示了YoAppearance类的具体用法。这些代码示例主要
本文整理了Java中us.ihmc.graphicsDescription.yoGraphics.YoGraphicsListRegistry类的一些代码示例,展示了YoGraphicsListReg
本文整理了Java中us.ihmc.yoVariables.variable.YoDouble类的一些代码示例,展示了YoDouble类的具体用法。这些代码示例主要来源于Github/Stackove
本文整理了Java中us.ihmc.yoVariables.variable.YoFrameVector2D类的一些代码示例,展示了YoFrameVector2D类的具体用法。这些代码示例主要来源于G
本文整理了Java中us.ihmc.codecs.yuv.YUVPictureConverter类的一些代码示例,展示了YUVPictureConverter类的具体用法。这些代码示例主要来源于Git
我是一名优秀的程序员,十分优秀!