PX4 Firmware
PX4 Autopilot Software http://px4.io
|
Local functions in support of the shell command. More...
Functions | |
int | start () |
Attempt to start driver on all available I2C busses. More... | |
int | start_bus (int i2c_bus) |
Start the driver on a specific bus. More... | |
int | stop () |
Stop the driver. More... | |
int | reset () |
Reset the driver. More... | |
int | info () |
Print a little info about the driver. More... | |
Variables | |
ETSAirspeed * | g_dev = nullptr |
Local functions in support of the shell command.
int ets_airspeed::info | ( | ) |
Print a little info about the driver.
Print a little info about the driver.
Definition at line 211 of file lps22hb_main.cpp.
References lps22hb::bus_options, mpl3115a2::bus_options, lps25h::bus_options, mpl3115a2::mpl3115a2_bus_option::dev, lps25h::lps25h_bus_option::dev, mpl3115a2::mpl3115a2_bus_option::devpath, lps25h::lps25h_bus_option::devpath, errx, fxos8701cq::g_dev, DfMPU6050Wrapper::info(), DfLsm9ds1Wrapper::info(), DfMpu9250Wrapper::info(), NUM_BUS_OPTIONS, DfAK8963Wrapper::print_calibration(), FXAS21002C::print_info(), MPL3115A2::print_info(), DfBebopBusWrapper::print_info(), PX4FLOW::print_info(), SF0X::print_info(), PAW3902::print_info(), SF1XX::print_info(), PMW3901::print_info(), GPSSIM::print_info(), LSM303AGR::print_info(), FXOS8701CQ::print_info(), BMA180::print_info(), LSM303D::print_info(), INA226::print_info(), LPS25H::print_info(), L3GD20::print_info(), and warnx.
Referenced by bma180_main(), df_ak8963_wrapper_main(), df_bebop_bus_wrapper_main(), df_bebop_rangefinder_wrapper_main(), df_bmp280_wrapper_main(), df_hmc5883_wrapper_main(), df_isl29501_wrapper_main(), df_lsm9ds1_wrapper_main(), df_ltc2946_wrapper_main(), df_mpu6050_wrapper_main(), df_mpu9250_wrapper_main(), df_ms5607_wrapper_main(), df_ms5611_wrapper_main(), df_trone_wrapper_main(), fxas21002c_main(), fxos8701cq_main(), gpssim_main(), hardfault_dowrite(), ina226_main(), l3gd20_main(), lps22hb_main(), lps25h_main(), lsm303agr_main(), lsm303d_main(), mpl3115a2_main(), paw3902_main(), pmw3901_main(), DfBebopBusWrapper::print_info(), px4flow_main(), Commander::run(), sf0x_main(), sf1xx_main(), spektrum_rc_main(), and voxlpm_main().
int ets_airspeed::reset | ( | ) |
Reset the driver.
Definition at line 319 of file ets_airspeed.cpp.
Referenced by ets_airspeed_main().
int ets_airspeed::start | ( | ) |
Attempt to start driver on all available I2C busses.
This function will return as soon as the first sensor is detected on one of the available busses or if no sensors are detected.
Definition at line 235 of file ets_airspeed.cpp.
Referenced by ets_airspeed_main().
int ets_airspeed::start_bus | ( | int | i2c_bus | ) |
Start the driver on a specific bus.
This function only returns if the sensor is up and running or could not be detected successfully.
Definition at line 254 of file ets_airspeed.cpp.
References AIRSPEED0_DEVICE_PATH, ETSAirspeed::ETSAirspeed(), fd, g_dev, Airspeed::init(), OK, px4_ioctl(), px4_open(), SENSOR_POLLRATE_DEFAULT, and SENSORIOCSPOLLRATE.
Referenced by ets_airspeed_main(), and spektrum_rc::start().
int ets_airspeed::stop | ( | ) |
Stop the driver.
Definition at line 301 of file ets_airspeed.cpp.
References g_dev.
Referenced by ets_airspeed_main().
ETSAirspeed* ets_airspeed::g_dev = nullptr |
Definition at line 218 of file ets_airspeed.cpp.
Referenced by PX4IO::PX4IO(), px4io_main(), PX4IO::set_update_rate(), start_bus(), stop(), ToneAlarm::stop_note(), PX4IO::task_main_trampoline(), tone_alarm_main(), and PX4IO::~PX4IO().