PX4 Firmware
PX4 Autopilot Software http://px4.io
|
Local functions in support of the shell command. More...
Functions | |
int | print_regs () |
Prints register information to the console. More... | |
int | start (const uint8_t rotation) |
Attempt to start driver on all available I2C busses. More... | |
int | start_bus (const int bus, const uint8_t rotation) |
Start the driver on a specific bus. More... | |
int | start_pwm (const uint8_t rotation) |
Start the pwm driver. More... | |
int | status () |
Prints status info about the driver. More... | |
int | stop () |
Stops the driver. More... | |
int | usage () |
Displays driver usage at the console. More... | |
Variables | |
LidarLite * | instance = nullptr |
Local functions in support of the shell command.
int ll40ls::print_regs | ( | ) |
Prints register information to the console.
Definition at line 80 of file ll40ls.cpp.
References LidarLite::print_registers().
Referenced by ll40ls_main().
int ll40ls::start | ( | const uint8_t | rotation | ) |
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 99 of file ll40ls.cpp.
References i2c_bus_options, NUM_I2C_BUS_OPTIONS, and start_bus().
Referenced by ll40ls_main().
int ll40ls::start_bus | ( | const int | bus, |
const uint8_t | rotation | ||
) |
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 122 of file ll40ls.cpp.
References LidarLite::init(), instance, and LidarLite::start().
Referenced by ll40ls_main(), and start().
int ll40ls::start_pwm | ( | const uint8_t | rotation | ) |
Start the pwm driver.
This function only returns if the sensor is up and running or could not be detected successfully.
Definition at line 160 of file ll40ls.cpp.
References LidarLite::init(), instance, and LidarLite::start().
Referenced by ll40ls_main().
int ll40ls::status | ( | ) |
Prints status info about the driver.
Definition at line 194 of file ll40ls.cpp.
References LidarLite::print_info().
Referenced by ll40ls_main().
int ll40ls::stop | ( | ) |
Stops the driver.
Stop the driver.
Definition at line 209 of file ll40ls.cpp.
References instance.
Referenced by ll40ls_main().
int ll40ls::usage | ( | void | ) |
Displays driver usage at the console.
Prints info about the driver argument usage.
Definition at line 224 of file ll40ls.cpp.
Referenced by ll40ls_main().
LidarLite* ll40ls::instance = nullptr |
Definition at line 65 of file ll40ls.cpp.
Referenced by rpi_rc_in::RcInput::_measure(), DfLtc2946Wrapper::_publish(), QShell::_send_cmd(), BatteryStatus::adc_poll(), Mavlink::add_orb_subscription(), px4::logger::Logger::add_topic(), px4::logger::Logger::add_topic_multi(), uORB::DeviceMaster::advertise(), PreFlightCheck::check_calibration(), INA226::collect(), uORB::DeviceMaster::getDeviceNodeLocked(), uavcan_stm32::SystemClock::getUtc(), uavcan_kinetis::SystemClock::getUtc(), px4::Replay::instantiate(), Sih::instantiate(), Commander::instantiate(), RoverPositionControl::instantiate(), Navigator::instantiate(), QShell::main(), uORB::Utils::node_mkpath(), uORB::Manager::orb_advertise(), uORB::Manager::orb_exists(), orb_group_count(), orb_publish_auto(), uORB::Manager::orb_subscribe_multi(), AirspeedModule::print_status(), uORB::PublicationMulti< rate_ctrl_status_s >::publish(), vmount::OutputBase::publish(), px4::Replay::publishTopic(), MixingOutput::setDriverInstance(), UavcanNode::start(), start_bus(), Mavlink::start_helper(), start_pwm(), stop(), uORB::SubscriptionInterval::SubscriptionInterval(), PWMSim::task_spawn(), SafetyButton::task_spawn(), MulticopterRateControl::task_spawn(), MulticopterAttitudeControl::task_spawn(), RCUpdate::RCUpdate::task_spawn(), AttitudeEstimatorQ::task_spawn(), FixedwingAttitudeControl::task_spawn(), MulticopterPositionControl::task_spawn(), VtolAttitudeControl::task_spawn(), Ekf2::task_spawn(), BatteryStatus::task_spawn(), BlockLocalPositionEstimator::task_spawn(), DShotOutput::task_spawn(), PX4FMU::task_spawn(), FixedwingPositionControl::task_spawn(), RoboClaw::taskMain(), vmount::OutputRC::update(), and Simulator::update_sensors().