当前位置: 首页>>代码示例>>Java>>正文


Java Ultrasonic类代码示例

本文整理汇总了Java中edu.wpi.first.wpilibj.Ultrasonic的典型用法代码示例。如果您正苦于以下问题:Java Ultrasonic类的具体用法?Java Ultrasonic怎么用?Java Ultrasonic使用的例子?那么, 这里精选的类代码示例或许可以为您提供帮助。


Ultrasonic类属于edu.wpi.first.wpilibj包,在下文中一共展示了Ultrasonic类的15个代码示例,这些例子默认根据受欢迎程度排序。您可以为喜欢或者感觉有用的代码点赞,您的评价将有助于系统推荐出更棒的Java代码示例。

示例1: ProximitySensor

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Creates the ProximitySensor.
 */
public ProximitySensor() {
  logger.trace("Initializing proximity sensor");

  ultrasonicLeft =
      new Ultrasonic(RobotMap.ULTRASONIC_LEFT_TRIGGER, RobotMap.ULTRASONIC_LEFT_ECHO);
  
  ultrasonicRight =
      new Ultrasonic(RobotMap.ULTRASONIC_RIGHT_TRIGGER, RobotMap.ULTRASONIC_RIGHT_ECHO);
  ultrasonicRight.setAutomaticMode(true);

  bufferLeft = new double[12];
  bufferCopyLeft = new double[12];
  bufferIndexLeft = 0;
  
  bufferRight = new double[12];
  bufferCopyRight = new double[12];
  bufferIndexRight = 0;

  Thread averagingThread = new Thread(this::averagingThread);
  averagingThread.setName("Ultrasonic Averaging Thread");
  averagingThread.setDaemon(true);
  averagingThread.start();
}
 
开发者ID:ligerbots,项目名称:Steamworks2017Robot,代码行数:27,代码来源:ProximitySensor.java

示例2: Robot

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public Robot() {
	stick = new Joystick(0);
	driveLeftFront = new Victor(LEFT_FRONT_DRIVE);
	driveLeftRear = new Victor(LEFT_REAR_DRIVE);
	driveRightFront = new Victor(RIGHT_FRONT_DRIVE);
	driveRightRear = new Victor(RIGHT_REAR_DRIVE);
	enhancedDriveLeft = new Victor(ENHANCED_LEFT_DRIVE);
	enhancedDriveRight = new Victor(ENHANCED_RIGHT_DRIVE);
	gearBox = new DoubleSolenoid(GEAR_BOX_PART1, GEAR_BOX_PART2);
	climber1 = new Victor(CLIMBER_PART1);
	climber2 = new Victor(CLIMBER_PART2);
	vexSensorBackLeft = new Ultrasonic(0, 1);
	vexSensorBackRight = new Ultrasonic(2, 3);
	vexSensorFrontLeft = new Ultrasonic(4, 5);
	vexSensorFrontRight = new Ultrasonic(6, 7);

	Skylar = new RobotDrive(driveLeftFront, driveLeftRear, driveRightFront, driveRightRear);
	OptimusPrime = new RobotDrive(enhancedDriveLeft, enhancedDriveRight);
}
 
开发者ID:TeamAutomatons,项目名称:Steamwork_2017,代码行数:20,代码来源:Robot.java

示例3: Drive

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
private Drive()
{
    drive = new RobotDrive(new Talon(1),new Talon(2),new Talon(3),new Talon(4));
    drive.setSafetyEnabled(false);

    
    e1 = new Encoder(RobotMap.ENCODER_1_A, RobotMap.ENCODER_1_B, false, CounterBase.EncodingType.k4X);
    e2 = new Encoder(RobotMap.ENCODER_2_A, RobotMap.ENCODER_2_B, false, CounterBase.EncodingType.k4X);
    
    //A calculated constant to convert from encoder ticks to feet on 4 inch diameter wheels
    e1.setDistancePerPulse(0.0349065850388889/12);
    e2.setDistancePerPulse(0.0349065850388889/12);
    startEncoders();
    
    drive.setInvertedMotor(RobotDrive.MotorType.kFrontLeft, true);      
    drive.setInvertedMotor(RobotDrive.MotorType.kRearLeft, true);
    
    sonic = new Ultrasonic(RobotMap.ULTRASONIC_A, RobotMap.ULTRASONIC_B);
    sonic.setAutomaticMode(true);
    sonic.setEnabled(true);
    
    
    shifter = new DoubleSolenoid(RobotMap.SHIFTER_ENGAGE, RobotMap.SHIFTER_DISENGAGE);
}
 
开发者ID:Nashoba-Robotics,项目名称:NR-2014-CMD,代码行数:25,代码来源:Drive.java

示例4: AngleFinder

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Constructor
 * 
 * @param goalHeight
 * @param ultra
 * @param targetX
 */
public AngleFinder(double goalHeight, Ultrasonic ultra, int targetX) {
    this.goalHeight = goalHeight;
    this.targetX = targetX;
    this.targetY = 0;
    this.ultra = ultra;
    ultra.setAutomaticMode(true);
}
 
开发者ID:FIRST-Team-1699,项目名称:team-1699-utils,代码行数:15,代码来源:AngleFinder.java

示例5: robotInit

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * This function is run when the robot is first started up and should be
 * used for any initialization code.
 */
public void robotInit()
{
    // PWM's
    mTestMotor1 = new Talon(0);
    mTestMotor2 = new Jaguar(1);
    mServo = new Servo(2);

    // Digital IO
    mDigitalOutput = new DigitalOutput(0);
    mRightEncoder = new Encoder(4, 5);
    mLeftEncoder = new Encoder(1, 2);
    mUltrasonic = new Ultrasonic(7, 6);

    // Analog IO
    mAnalogGryo = new AnalogGyro(0);
    mPotentiometer = new AnalogPotentiometer(1);

    // Solenoid
    mSolenoid = new Solenoid(0);

    // Relay
    mRelay = new Relay(0);

    // Joysticks
    mJoystick1 = new Joystick(0);
    mJoystick2 = new XboxController(1);

    // SPI
    mSpiGryo = new ADXRS450_Gyro();

    // Utilities
    mTimer = new Timer();
    mPDP = new PowerDistributionPanel();

    Preferences.getInstance().putDouble("Motor One Speed", .5);
}
 
开发者ID:ArcticWarriors,项目名称:snobot-2017,代码行数:41,代码来源:Snobot.java

示例6: initialize

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public static void initialize()
{
	if (!initialized) {
		//ultrasonicDevice = new AnalogInput(ANALOG_CHANNEL_ID);
		ultrasonicDevice = new Ultrasonic(TRIGGER_CHANNEL_ID,ECHO_CHANNEL_ID);
		ultrasonicDevice.setAutomaticMode(true);
		
		initialized = true;
	}
}
 
开发者ID:MTHSRoboticsClub,项目名称:FRC-2017,代码行数:11,代码来源:UltrasonicSensor.java

示例7: initialize

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public static void initialize()
{
	if (!initialized) {
		ultrasonicDevice = new Ultrasonic(HardwareIDs.TRIGGER_CHANNEL_ID,HardwareIDs.ECHO_CHANNEL_ID);
		ultrasonicDevice.setAutomaticMode(true);
		
		initialized = true;
	}
}
 
开发者ID:MTHSRoboticsClub,项目名称:FRC-2017,代码行数:10,代码来源:UltrasonicSensor.java

示例8: robotInit

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public void robotInit(){
    driveStick= new JoyStickCustom(1, DEADZONE);
    secondStick=new JoyStickCustom(2, DEADZONE);
    
    frontLeft= new Talon(1);
    rearLeft= new Talon(2);
    frontRight= new Talon(3);
    rearRight= new Talon(4);
    
    timer=new Timer();
    timer.start();
    
    armM = new Victor(7);
    rollers =new Victor(6);
    
    mainDrive=new RobotDrive(frontLeft,rearLeft,frontRight,rearRight);

    mainDrive.setInvertedMotor(RobotDrive.MotorType.kFrontRight,true);
    mainDrive.setInvertedMotor(RobotDrive.MotorType.kRearRight, true);
    
    armP = new AnalogPotentiometer(1);
    distance= new AnalogChannel(2);
    ultra=new Ultrasonic(6,7);
    ultra.setAutomaticMode(true);
    
    compress=new Compressor(5,1);
    
    handJoint=new Pneumatics(3,4);
    
    //ultra = new Ultrasonic(6,5);
    //ultra.setAutomaticMode(true);
    
    winch = new Winch(secondStick);
    
}
 
开发者ID:4500robotics,项目名称:4500-2014,代码行数:36,代码来源:RobotTemplate.java

示例9: DistanceReader

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public DistanceReader(){
    sensor = new Ultrasonic(RobotMap.PING_CHANNEL, RobotMap.ECHO_CHANNEL);
    sensor.setEnabled(true);
    sensor.setAutomaticMode(true);
}
 
开发者ID:owatonnarobotics,项目名称:2014RobotCode,代码行数:6,代码来源:DistanceReader.java

示例10: init

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public void init() {
    
    motorLeft = new Talon(1);
    motorRight = new Talon(2);
    System.out.println("[INFO] TALON[1&2]: Created!");
    elToro1 = new Talon(3);
    elToro2 = new Talon(4);
    System.out.println("[INFO] TALON[3&4]: Created!");
    robotdrive = new RobotDriveSteering(motorLeft, motorRight);
    robotdrive.setInvertedMotor(RobotDriveSteering.MotorType.kRearLeft, true);
    robotdrive.setInvertedMotor(RobotDriveSteering.MotorType.kRearRight, true);
    
    compressor = new Compressor(1, 1); // presureSwitchDigitalInput, RelayOut
    compressor.start();
    
    wormgear = new Relay(2);
    spreader = new Relay(3);
    System.out.println("[INFO] RELAY[1&2&3]: Created!");
    
    joystick = new Joystick(1);
    //joystick2 = new Joystick(2);
    System.out.println("[INFO] JOYSTICK[1&2]: Created!");
    
    cock = new Solenoid(1);
    uncock = new Solenoid(2);
    lock = new Solenoid(3);
    fire = new Solenoid(4);
    
    System.out.println("[INFO] Digital I/O: Enabled.");
    
    sonic = new Ultrasonic(4, 2);
    sonic.setEnabled(true);
    sonic2 = new AnalogChannel(3);
    pot = new AnalogPotentiometer(2, 10);
    
    autonomousTimer = new Timer();
    t = new Timer();
    
    LCD = DriverStationLCD.getInstance();
    ds = DriverStation.getInstance();
    
    System.out.println("[INFO] Robot Initialized");
}
 
开发者ID:BreakerBots,项目名称:Felix-2014,代码行数:44,代码来源:Console.java

示例11: robotInit

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
public void robotInit(){
		Subsystems.robot = this;
		Subsystems.imu = new IMU(GYRO_CHANNEL);
		Subsystems.imu.reset();
		
		Subsystems.driveTrain = new DriveTrain(DRIVE_MOTOR_FRONTLEFT, DRIVE_MOTOR_BACKLEFT
				, DRIVE_MOTOR_FRONTRIGHT, DRIVE_MOTOR_BACKRIGHT, ContinuousMotor.SpeedControllerType.TALON);
//		Subsystems.driveTrain = new DriveTrain(1,2,ContinuousMotor.SpeedControllerType.JAGUAR);
		
		Subsystems.compressor = new Compressor(COMPRESSOR_RELAY, COMPRESSOR_PRESSURESWITCH);
		
		Subsystems.nets = new Nets
				( new LimitedMotor(NET_MOTOR_LEFT, LimitedMotor.SpeedControllerType.VICTOR, NET_SWITCH_LEFT, NET_PROX_LEFT)
				, new LimitedMotor(NET_MOTOR_RIGHT, LimitedMotor.SpeedControllerType.VICTOR, NET_SWITCH_RIGHT, NET_PROX_RIGHT));
		
		Subsystems.arm = new RollerArm(SOLENOID_LEFT_EXTEND,SOLENOID_LEFT_RETRACT,SOLENOID_RIGHT_EXTEND,SOLENOID_RIGHT_RETRACT);
		Subsystems.roller = new Roller(ROLLER_MOTOR, ContinuousMotor.SpeedControllerType.VICTOR);
		Subsystems.ranger = new Ranger(RANGER_CHANNEL);
		Subsystems.pid = new PIDController(0.5,0,0,Subsystems.ranger,new PIDDriveInterface());
		Subsystems.turnPID = new PIDController(0.003,0,0.007,Subsystems.imu, new PIDTurnInterface());
		
		Subsystems.leftUltrasonicSensor = new Ultrasonic(ULTRASONIC_LEFT_PING, ULTRASONIC_LEFT_ECHO, Ultrasonic.Unit.kInches);
		Subsystems.rightUltrasonicSensor = new Ultrasonic(ULTRASONIC_RIGHT_PING, ULTRASONIC_RIGHT_EHCO, Ultrasonic.Unit.kInches);
		
		Subsystems.leftUltrasonicSensor.setAutomaticMode(true);
		Subsystems.rightUltrasonicSensor.setAutomaticMode(true);
		
		//Subsystems.compressor.init();
		OperatorInterface.init();
		
		smartDashboardInit();
		
//		Subsystems.compressor.activate();
//		long then = System.currentTimeMillis();
//		while(System.currentTimeMillis()-then<100*1000){
//			Subsystems.compressor.activate();
//		}
//		Subsystems.compressor.deactive();
		Subsystems.compressor.init();
		
		//TODO Have drivers refine these values and make them constants in DriveTrain.
		SmartDashboard.putNumber("Range 1", 0.4);
		SmartDashboard.putNumber("Range 2", 0.8);
		SmartDashboard.putNumber("Range 3", 1.0);
		
		SmartDashboard.putNumber("Max Delta 1", 1.0);
		SmartDashboard.putNumber("Max Delta 2", 0.1);
		SmartDashboard.putNumber("Max Delta 3", 0.01);
//		Scheduler.getInstance().add(new SetState(Subsystems.nets.leftNet, State.CLOSED, Nets.CLOSE_SPEED));
		
//		Scheduler.getInstance().add(new AddCommandAfterDelay
//				(new SetState(Subsystems.nets.rightNet, State.CLOSED, Nets.OPEN_SPEED),0.5));
	}
 
开发者ID:frc-4931,项目名称:2014-Robot,代码行数:54,代码来源:CompetitionRobot.java

示例12: getUltra

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Used to get ultra
 * 
 * @return ultra
 */
public Ultrasonic getUltra() {
    return ultra;
}
 
开发者ID:FIRST-Team-1699,项目名称:team-1699-utils,代码行数:9,代码来源:AngleFinder.java

示例13: setUltra

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Used to set ultra
 * 
 * @param ultra
 */    
public void setUltra(Ultrasonic ultra) {
    this.ultra = ultra;
}
 
开发者ID:FIRST-Team-1699,项目名称:team-1699-utils,代码行数:9,代码来源:AngleFinder.java

示例14: digitalUltrasonic

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Create a digital ultrasonic {@link DistanceSensor} for an {@link Ultrasonic} sensor that uses the specified channels.
 *
 * @param pingChannel the digital output channel to use for sending pings
 * @param echoChannel the digital input channel to use for receiving echo responses
 * @return a {@link DistanceSensor} linked to the specified channels
 */
public static DistanceSensor digitalUltrasonic(int pingChannel, int echoChannel) {
    Ultrasonic ultrasonic = new Ultrasonic(pingChannel, echoChannel);
    ultrasonic.setAutomaticMode(true);
    return DistanceSensor.create(ultrasonic::getRangeInches);
}
 
开发者ID:strongback,项目名称:strongback-java,代码行数:13,代码来源:Hardware.java

示例15: UltrasonicRangeFinderModule

import edu.wpi.first.wpilibj.Ultrasonic; //导入依赖的package包/类
/**
 * Constructs the module with the ultrasonic object underneath this class to
 * call methods from.
 *
 * @param ultrasonic the composing instance which will return values
 */
protected UltrasonicRangeFinderModule(Ultrasonic ultrasonic) {
    this.ultrasonic = ultrasonic;
}
 
开发者ID:Team4334,项目名称:atalibj,代码行数:10,代码来源:UltrasonicRangeFinderModule.java


注:本文中的edu.wpi.first.wpilibj.Ultrasonic类示例由纯净天空整理自Github/MSDocs等开源代码及文档管理平台,相关代码片段筛选自各路编程大神贡献的开源项目,源码版权归原作者所有,传播和使用请参考对应项目的License;未经允许,请勿转载。