Tabnine Logo
DRCRobotModel.getSensorInformation
Code IndexAdd Tabnine to your IDE (free)

How to use
getSensorInformation
method
in
us.ihmc.avatar.drcRobot.DRCRobotModel

Best Java code snippets using us.ihmc.avatar.drcRobot.DRCRobotModel.getSensorInformation (Showing top 20 results out of 315)

origin: us.ihmc/acsell

public WandererSensorReaderFactory(DRCRobotModel robotModel, CostOfTransportCalculator costOfTransportCalculator)
{
 sensorInformation = robotModel.getSensorInformation();
 stateEstimatorParameters = robotModel.getStateEstimatorParameters();
 this.costOfTransportCalculator = costOfTransportCalculator;
}
origin: us.ihmc/acsell

public StepprSensorReaderFactory(DRCRobotModel robotModel)
{
 sensorInformation = robotModel.getSensorInformation();
 stateEstimatorParameters = robotModel.getStateEstimatorParameters();
}
origin: us.ihmc/IHMCAvatarInterfaces

protected void setupSubscribers(ConnectedNode connectedNode)
{
 DRCRobotSensorInformation sensorInforamtion = robotModel.getSensorInformation();
 DRCRobotLidarParameters lidarParameters = sensorInforamtion.getLidarParameters(0);
 if (lidarParameters != null && lidarParameters.getLidarSpindleJointTopic() != null)
 {
   jointSubscriber = connectedNode.newSubscriber(lidarParameters.getLidarSpindleJointTopic(), sensor_msgs.JointState._TYPE);
 }
}
origin: us.ihmc/ihmc-avatar-interfaces

protected void setupSubscribers(ConnectedNode connectedNode)
{
 DRCRobotSensorInformation sensorInforamtion = robotModel.getSensorInformation();
 DRCRobotLidarParameters lidarParameters = sensorInforamtion.getLidarParameters(0);
 if (lidarParameters != null && lidarParameters.getLidarSpindleJointTopic() != null)
 {
   jointSubscriber = connectedNode.newSubscriber(lidarParameters.getLidarSpindleJointTopic(), sensor_msgs.JointState._TYPE);
 }
}
origin: us.ihmc/ihmc-avatar-interfaces-test

private SideDependentList<WristForceSensorFilteredUpdatable> createWristForceSensorUpdateables()
{
 SideDependentList<WristForceSensorFilteredUpdatable> ret = new SideDependentList<WristForceSensorFilteredUpdatable>();
 for (RobotSide robotSide : RobotSide.values)
 {
   WristForceSensorFilteredUpdatable wristSensorUpdatable = new WristForceSensorFilteredUpdatable(drcRobotModel.getSimpleRobotName(), robotSide,
                                                  fullRobotModel, drcRobotModel.getSensorInformation(),
                                                  robotDataReceiver.getForceSensorDataHolder(),
                                                  IHMCHumanoidBehaviorManager.BEHAVIOR_YO_VARIABLE_SERVER_DT,
                                                  ros2Node, registry);
   ret.put(robotSide, wristSensorUpdatable);
 }
 return ret;
}
origin: us.ihmc/IHMCAvatarInterfaces

private void setupControllerThread()
{
 controllerThread = new DRCControllerThread(robotModel.get(), robotModel.get().getSensorInformation(), momentumBasedControllerFactory.get(),
                       threadDataSynchronizer, simulationOutputWriter, humanoidGlobalDataProducer.get(), yoVariableServer,
                       gravity.get(), robotModel.get().getEstimatorDT());
}
origin: us.ihmc/ihmc-avatar-interfaces-test

                                           robotModel.getEstimatorDT());
DRCEstimatorThread estimatorThread = new DRCEstimatorThread(robotModel.getSimpleRobotName(), robotModel.getSensorInformation(),
                              robotModel.getContactPointParameters(), robotModel, robotModel.getStateEstimatorParameters(),
                              sensorReaderFactory, threadDataSynchronizer, realtimeRos2Node, null, null, robotVisualizer,
origin: us.ihmc/IHMCAvatarInterfaces

private void setupLidarController()
{
 DRCRobotLidarParameters lidarParameters = robotModel.get().getSensorInformation().getLidarParameters(0);
 if (lidarParameters != null && lidarParameters.getLidarSpindleJointName() != null)
 {
   PIDLidarTorqueController pidLidarTorqueController = new PIDLidarTorqueController(humanoidFloatingRootJointRobot,
                                           lidarParameters.getLidarSpindleJointName(),
                                           lidarParameters.getLidarSpindleVelocity(),
                                           robotModel.get().getSimulateDT());
   humanoidFloatingRootJointRobot.setController(pidLidarTorqueController);
 }
}
origin: us.ihmc/ihmc-avatar-interfaces

private void setupLidarController()
{
 DRCRobotLidarParameters lidarParameters = robotModel.get().getSensorInformation().getLidarParameters(0);
 if (lidarParameters != null && lidarParameters.getLidarSpindleJointName() != null)
 {
   PIDLidarTorqueController pidLidarTorqueController = new PIDLidarTorqueController(humanoidFloatingRootJointRobot,
                                           lidarParameters.getLidarSpindleJointName(),
                                           lidarParameters.getLidarSpindleVelocity(),
                                           robotModel.get().getSimulateDT());
   humanoidFloatingRootJointRobot.setController(pidLidarTorqueController);
 }
}
origin: us.ihmc/ihmc-avatar-interfaces

private void setupControllerThread()
{
 String robotName = robotModel.get().getSimpleRobotName();
 controllerThread = new DRCControllerThread(robotName, robotModel.get(), robotModel.get().getSensorInformation(), highLevelHumanoidControllerFactory.get(),
                       threadDataSynchronizer, simulationOutputProcessor, realtimeRos2Node.get(), yoVariableServer, gravity.get(),
                       robotModel.get().getEstimatorDT());
}
origin: us.ihmc/ihmc-avatar-interfaces-test

@Before
public void setUp()
{
 registry = new YoVariableRegistry(getClass().getSimpleName());
 this.yoTime = new YoDouble("yoTime", registry);
 this.ros2Node = ROS2Tools.createRos2Node(PubSubImplementation.INTRAPROCESS, "ihmc_humanoid_behavior_dispatcher_test");
 drcSimulationTestHelper = new DRCSimulationTestHelper(simulationTestingParameters, getRobotModel());
 drcSimulationTestHelper.createSimulation(getSimpleRobotName());
 MemoryTools.printCurrentMemoryUsageAndReturnUsedMemoryInMB(getClass().getSimpleName() + " before test.");
 robot = drcSimulationTestHelper.getRobot();
 fullRobotModel = getRobotModel().createFullRobotModel();
 walkingControllerParameters = getRobotModel().getWalkingControllerParameters();
 yoGraphicsListRegistry = new YoGraphicsListRegistry();
 behaviorDispatcher = setupBehaviorDispatcher(getRobotModel().getSimpleRobotName(), fullRobotModel, ros2Node, yoGraphicsListRegistry, registry);
 CapturePointUpdatable capturePointUpdatable = createCapturePointUpdateable(drcSimulationTestHelper, registry, yoGraphicsListRegistry);
 behaviorDispatcher.addUpdatable(capturePointUpdatable);
 DRCRobotSensorInformation sensorInfo = getRobotModel().getSensorInformation();
 for (RobotSide robotSide : RobotSide.values)
 {
   WristForceSensorFilteredUpdatable wristSensorUpdatable = new WristForceSensorFilteredUpdatable(drcSimulationTestHelper.getRobotName(), robotSide,
                                                  fullRobotModel, sensorInfo,
                                                  robotDataReceiver.getForceSensorDataHolder(),
                                                  IHMCHumanoidBehaviorManager.BEHAVIOR_YO_VARIABLE_SERVER_DT,
                                                  drcSimulationTestHelper.getRos2Node(), registry);
   behaviorDispatcher.addUpdatable(wristSensorUpdatable);
 }
 referenceFrames = robotDataReceiver.getReferenceFrames();
}
origin: us.ihmc/ihmc-avatar-interfaces

private void setupBehaviorModule(DRCRobotModel robotModel, DRCNetworkModuleParameters params) throws IOException
{
 if (params.isBehaviorModuleEnabled())
 {
   DRCRobotSensorInformation sensorInformation = robotModel.getSensorInformation();
   LogModelProvider logModelProvider = robotModel.getLogModelProvider();
   if (params.isAutomaticDiagnosticEnabled())
   {
    IHMCHumanoidBehaviorManager.createBehaviorModuleForAutomaticDiagnostic(robotModel.getSimpleRobotName(), robotModel, robotModel, logModelProvider,
                                        params.isBehaviorVisualizerEnabled(), sensorInformation,
                                        params.getTimeToWaitBeforeStartingDiagnostics());
   }
   else
   {
    new IHMCHumanoidBehaviorManager(robotModel.getSimpleRobotName(), robotModel, robotModel, logModelProvider, params.isBehaviorVisualizerEnabled(),
                    sensorInformation);
   }
   String methodName = "setupBehaviorModule ";
   printModuleConnectedDebugStatement(PacketDestination.BEHAVIOR_MODULE, methodName);
 }
}
origin: us.ihmc/ihmc-avatar-interfaces-test

HighLevelControllerParameters highLevelControllerParameters = robotModel.getHighLevelControllerParameters();
DRCRobotSensorInformation sensorInformation = robotModel.getSensorInformation();
SideDependentList<String> feetForceSensorNames = sensorInformation.getFeetForceSensorNames();
SideDependentList<String> feetContactSensorNames = sensorInformation.getFeetContactSensorNames();
origin: us.ihmc/ihmc-avatar-interfaces

private void createControllerCore(YoVariableRegistry walkingControllerRegistry)
{
 JointBasics[] jointsToIgnore = DRCControllerThread.createListOfJointsToIgnore(fullRobotModel, robotModel, robotModel.getSensorInformation());
 JointBasics[] jointsToOptimizeFor = HighLevelHumanoidControllerToolbox.computeJointsToOptimizeFor(fullRobotModel, jointsToIgnore);
 FloatingJointBasics rootJoint = fullRobotModel.getRootJoint();
 ReferenceFrame centerOfMassFrame = referenceFrames.getCenterOfMassFrame();
 WalkingControllerParameters walkingControllerParameters = robotModel.getWalkingControllerParameters();
 MomentumOptimizationSettings momentumOptimizationSettings = walkingControllerParameters.getMomentumOptimizationSettings();
 WholeBodyControlCoreToolbox toolbox = new WholeBodyControlCoreToolbox(controlDT, gravityZ, rootJoint, jointsToOptimizeFor, centerOfMassFrame,
                                    momentumOptimizationSettings, yoGraphicsListRegistry, walkingControllerRegistry);
 toolbox.setupForInverseDynamicsSolver(contactableBodies);
 JointPrivilegedConfigurationParameters jointPrivilegedConfigurationParameters = walkingControllerParameters.getJointPrivilegedConfigurationParameters();
 toolbox.setJointPrivilegedConfigurationParameters(jointPrivilegedConfigurationParameters);
 FeedbackControlCommandList template = managerFactory.createFeedbackControlTemplate();
 controllerOutput = new JointDesiredOutputList(fullRobotModel.getControllableOneDoFJoints());
 controllerCore = new WholeBodyControllerCore(toolbox, template, controllerOutput, walkingControllerRegistry);
}
origin: us.ihmc/IHMCAvatarInterfaces

private void setupBehaviorModule(DRCRobotModel robotModel, DRCNetworkModuleParameters params) throws IOException
{
 if (params.isBehaviorModuleEnabled())
 {
   DRCRobotSensorInformation sensorInformation = robotModel.getSensorInformation();
   LogModelProvider logModelProvider = robotModel.getLogModelProvider();
   if (params.isAutomaticDiagnosticEnabled())
   {
    IHMCHumanoidBehaviorManager
       .createBehaviorModuleForAutomaticDiagnostic(robotModel, logModelProvider, params.isBehaviorVisualizerEnabled(), sensorInformation,
                             params.getTimeToWaitBeforeStartingDiagnostics());
   }
   else
   {
    new IHMCHumanoidBehaviorManager(robotModel, logModelProvider, params.isBehaviorVisualizerEnabled(), sensorInformation);
   }
   PacketCommunicator behaviorModuleCommunicator = PacketCommunicator
      .createIntraprocessPacketCommunicator(NetworkPorts.BEHAVIOUR_MODULE_PORT, NET_CLASS_LIST);
   packetRouter.attachPacketCommunicator(PacketDestination.BEHAVIOR_MODULE, behaviorModuleCommunicator);
   behaviorModuleCommunicator.connect();
   String methodName = "setupBehaviorModule ";
   printModuleConnectedDebugStatement(PacketDestination.BEHAVIOR_MODULE, methodName);
 }
}
origin: us.ihmc/IHMCAvatarInterfaces

private void setupStateEstimationThread()
{
 stateEstimationThread = new DRCEstimatorThread(robotModel.get().getSensorInformation(), robotModel.get().getContactPointParameters(),
                         robotModel.get().getStateEstimatorParameters(), sensorReaderFactory, threadDataSynchronizer,
                         new PeriodicNonRealtimeThreadScheduler("DRCSimGazeboYoVariableServer"), humanoidGlobalDataProducer.get(),
                         yoVariableServer, gravity.get());
 if (humanoidGlobalDataProducer.get() != null)
 {
   PelvisPoseCorrectionCommunicatorInterface pelvisPoseCorrectionCommunicator = new PelvisPoseCorrectionCommunicator(humanoidGlobalDataProducer.get());
   humanoidGlobalDataProducer.get().attachListener(StampedPosePacket.class, pelvisPoseCorrectionCommunicator);
   stateEstimationThread.setExternalPelvisCorrectorSubscriber(pelvisPoseCorrectionCommunicator);
 }
 else
 {
   stateEstimationThread.setExternalPelvisCorrectorSubscriber(null);
 }
}
origin: us.ihmc/IHMCAvatarInterfaces

public LocalObjectCommunicator createSimulatedSensorsPacketCommunicator()
{
 scsSensorOutputPacketCommunicator = new LocalObjectCommunicator();
 if (createSCSSimulatedSensors)
 {
   DRCRobotSensorInformation sensorInformation = robotModel.getSensorInformation();
   DRCRobotJointMap jointMap = robotModel.getJointMap();
   TimestampProvider timeStampProvider = avatarSimulation.getSimulatedRobotTimeProvider();
   HumanoidFloatingRootJointRobot robot = avatarSimulation.getHumanoidFloatingRootJointRobot();
   Graphics3DAdapter graphics3dAdapter = simulationConstructionSet.getGraphics3dAdapter();
   printIfDebug("Streaming SCS Video");
   DRCRobotCameraParameters cameraParameters = sensorInformation.getCameraParameters(0);
   if (cameraParameters != null)
   {
    String cameraName = cameraParameters.getSensorNameInSdf();
    int width = sdfRobot.getCameraMount(cameraName).getImageWidth();
    int height = sdfRobot.getCameraMount(cameraName).getImageHeight();
    CameraConfiguration cameraConfiguration = new CameraConfiguration(cameraName);
    cameraConfiguration.setCameraMount(cameraName);
    int framesPerSecond = 25;
    DRCRenderedSceneVideoHandler drcRenderedSceneVideoHandler = new DRCRenderedSceneVideoHandler(scsSensorOutputPacketCommunicator);
    simulationConstructionSet.startStreamingVideoData(cameraConfiguration, width, height, drcRenderedSceneVideoHandler, timeStampProvider, framesPerSecond);
   }
   for (DRCRobotLidarParameters lidarParams : sensorInformation.getLidarParameters())
   {
    DRCLidar.setupDRCRobotLidar(robot, graphics3dAdapter, scsSensorOutputPacketCommunicator, jointMap, lidarParams, timeStampProvider, true);
   }
 }
 return scsSensorOutputPacketCommunicator;
}
origin: us.ihmc/ihmc-avatar-interfaces-test

DRCRobotSensorInformation robotSensorInfo = robotModel.getSensorInformation();
FlatGroundEnvironment flatGround = new FlatGroundEnvironment();
DRCNetworkModuleParameters networkModuleParameters = new DRCNetworkModuleParameters();
origin: us.ihmc/ihmc-avatar-interfaces

private void setupStateEstimationThread()
{
 String robotName = robotModel.get().getSimpleRobotName();
 MessageTopicNameGenerator publisherTopicNameGenerator = ControllerAPIDefinition.getPublisherTopicNameGenerator(robotName);
 MessageTopicNameGenerator subscriberTopicNameGenerator = ControllerAPIDefinition.getSubscriberTopicNameGenerator(robotName);
 PelvisPoseCorrectionCommunicatorInterface pelvisPoseCorrectionCommunicator;
 if (externalPelvisCorrectorSubscriber.hasValue())
 {
   pelvisPoseCorrectionCommunicator = externalPelvisCorrectorSubscriber.get();
 }
 else
 {
   pelvisPoseCorrectionCommunicator = new PelvisPoseCorrectionCommunicator(realtimeRos2Node.get(), publisherTopicNameGenerator);
   ROS2Tools.createCallbackSubscription(realtimeRos2Node.get(), StampedPosePacket.class, subscriberTopicNameGenerator,
                     s -> pelvisPoseCorrectionCommunicator.receivedPacket(s.takeNextData()));
 }
 stateEstimationThread = new DRCEstimatorThread(robotName, robotModel.get().getSensorInformation(), robotModel.get().getContactPointParameters(),
                         robotModel.get(), robotModel.get().getStateEstimatorParameters(), sensorReaderFactory,
                         threadDataSynchronizer, realtimeRos2Node.get(), pelvisPoseCorrectionCommunicator, simulationOutputWriter,
                         yoVariableServer, gravity.get());
}
origin: us.ihmc/ihmc-avatar-interfaces

DRCRobotSensorInformation sensorInformation = robotModel.getSensorInformation();
DRCRobotJointMap jointMap = robotModel.getJointMap();
TimestampProvider timeStampProvider = avatarSimulation.getSimulatedRobotTimeProvider();
us.ihmc.avatar.drcRobotDRCRobotModelgetSensorInformation

Popular methods of DRCRobotModel

  • getEstimatorDT
  • getControllerDT
  • createFullRobotModel
  • getContactPointParameters
  • getDefaultRobotInitialSetup
  • getSimulateDT
  • getStateEstimatorParameters
  • createHumanoidFloatingRootJointRobot
  • getCapturePointPlannerParameters
  • getJointMap
  • getSimpleRobotName
  • getWalkingControllerParameters
  • getSimpleRobotName,
  • getWalkingControllerParameters,
  • getFootstepPlannerParameters,
  • getHighLevelControllerParameters,
  • createSimulatedHandController,
  • getLogModelProvider,
  • getLogSettings,
  • getPPSTimestampOffsetProvider,
  • getSensorSuiteManager

Popular in Java

  • Updating database using SQL prepared statement
  • notifyDataSetChanged (ArrayAdapter)
  • onRequestPermissionsResult (Fragment)
  • addToBackStack (FragmentTransaction)
  • BorderLayout (java.awt)
    A border layout lays out a container, arranging and resizing its components to fit in five regions:
  • InputStreamReader (java.io)
    A class for turning a byte stream into a character stream. Data read from the source input stream is
  • PrintWriter (java.io)
    Wraps either an existing OutputStream or an existing Writerand provides convenience methods for prin
  • SocketTimeoutException (java.net)
    This exception is thrown when a timeout expired on a socket read or accept operation.
  • Charset (java.nio.charset)
    A charset is a named mapping between Unicode characters and byte sequences. Every Charset can decode
  • LinkedHashMap (java.util)
    LinkedHashMap is an implementation of Map that guarantees iteration order. All optional operations a
  • Top plugins for WebStorm
Tabnine Logo
  • Products

    Search for Java codeSearch for JavaScript code
  • IDE Plugins

    IntelliJ IDEAWebStormVisual StudioAndroid StudioEclipseVisual Studio CodePyCharmSublime TextPhpStormVimAtomGoLandRubyMineEmacsJupyter NotebookJupyter LabRiderDataGripAppCode
  • Company

    About UsContact UsCareers
  • Resources

    FAQBlogTabnine AcademyStudentsTerms of usePrivacy policyJava Code IndexJavascript Code Index
Get Tabnine for your IDE now