PX4 Firmware
PX4 Autopilot Software http://px4.io
|
This is the complete list of members for PX4IO, including all inherited members.
_alarms | PX4IO | private |
_analog_rc_rssi_stable | PX4IO | private |
_analog_rc_rssi_volt | PX4IO | private |
_armed | PX4IO | private |
_cb_flighttermination | PX4IO | private |
_hardware | PX4IO | private |
_hitl_mode | PX4IO | private |
_in_esc_calibration_mode | PX4IO | private |
_interface | PX4IO | private |
_io_reg_get_error | PX4IO | privatestatic |
_last_written_arming_c | PX4IO | private |
_last_written_arming_s | PX4IO | private |
_lock | cdev::CDev | protected |
_lockdown_override | PX4IO | private |
_mavlink_log_pub | PX4IO | private |
_max_actuators | PX4IO | private |
_max_controls | PX4IO | private |
_max_rc_input | PX4IO | private |
_max_relays | PX4IO | private |
_max_transfer | PX4IO | private |
_motor_test | PX4IO | private |
_override_available | PX4IO | private |
_param_update_force | PX4IO | private |
_parameter_update_sub | PX4IO | private |
_perf_sample_latency | PX4IO | private |
_perf_update | PX4IO | private |
_perf_write | PX4IO | private |
_primary_pwm_device | PX4IO | private |
_rc_chan_count | PX4IO | private |
_rc_handling_disabled | PX4IO | private |
_rc_last_valid | PX4IO | private |
_rssi_pwm_chan | PX4IO | private |
_rssi_pwm_max | PX4IO | private |
_rssi_pwm_min | PX4IO | private |
_status | PX4IO | private |
_t_actuator_armed | PX4IO | private |
_t_actuator_controls_0 | PX4IO | private |
_t_actuator_controls_1 | PX4IO | private |
_t_actuator_controls_2 | PX4IO | private |
_t_actuator_controls_3 | PX4IO | private |
_t_vehicle_command | PX4IO | private |
_t_vehicle_control_mode | PX4IO | private |
_task | PX4IO | private |
_task_should_exit | PX4IO | private |
_test_fmu_fail | PX4IO | private |
_thermal_control | PX4IO | private |
_to_input_rc | PX4IO | private |
_to_mixer_status | PX4IO | private |
_to_outputs | PX4IO | private |
_to_safety | PX4IO | private |
_to_servorail | PX4IO | private |
_update_interval | PX4IO | private |
CDev(const char *devname) | cdev::CDev | explicit |
CDev(const CDev &)=delete | cdev::CDev | |
CDev(CDev &&)=delete | cdev::CDev | |
close(file_t *filep) | cdev::CDev | virtual |
close_last(file_t *filep) | cdev::CDev | inlineprotectedvirtual |
detect() | PX4IO | virtual |
disable_rc_handling() | PX4IO | |
dsm_bind_ioctl(int dsmMode) | PX4IO | private |
fops | cdev::CDev | protectedstatic |
get_devname() const | cdev::CDev | inline |
handle_motor_test() | PX4IO | private |
init() | PX4IO | virtual |
init(bool disable_rc_handling, bool hitl_mode) | PX4IO | |
io_disable_rc_handling() | PX4IO | private |
io_get_raw_rc_input(input_rc_s &input_rc) | PX4IO | private |
io_get_status() | PX4IO | private |
io_handle_alarms(uint16_t alarms) | PX4IO | private |
io_handle_status(uint16_t status) | PX4IO | private |
io_handle_vservo(uint16_t vservo, uint16_t vrssi) | PX4IO | private |
io_publish_pwm_outputs() | PX4IO | private |
io_publish_raw_rc() | PX4IO | private |
io_reg_get(uint8_t page, uint8_t offset, uint16_t *values, unsigned num_values) | PX4IO | private |
io_reg_get(uint8_t page, uint8_t offset) | PX4IO | private |
io_reg_modify(uint8_t page, uint8_t offset, uint16_t clearbits, uint16_t setbits) | PX4IO | private |
io_reg_set(uint8_t page, uint8_t offset, const uint16_t *values, unsigned num_values) | PX4IO | private |
io_reg_set(uint8_t page, uint8_t offset, const uint16_t value) | PX4IO | private |
io_set_arming_state() | PX4IO | private |
io_set_control_groups() | PX4IO | private |
io_set_control_state(unsigned group) | PX4IO | private |
io_set_rc_config() | PX4IO | private |
ioctl(file *filp, int cmd, unsigned long arg) | PX4IO | virtual |
cdev::CDev::ioctl(file_t *filep, int cmd, unsigned long arg) | cdev::CDev | virtual |
lock() | cdev::CDev | inlineprotected |
mixer_send(const char *buf, unsigned buflen, unsigned retries=3) | PX4IO | private |
open(file_t *filep) | cdev::CDev | virtual |
open_first(file_t *filep) | cdev::CDev | inlineprotectedvirtual |
operator=(const PX4IO &) | PX4IO | private |
cdev::CDev::operator=(const CDev &)=delete | cdev::CDev | |
cdev::CDev::operator=(CDev &&)=delete | cdev::CDev | |
poll(file_t *filep, px4_pollfd_struct_t *fds, bool setup) | cdev::CDev | virtual |
poll_notify(pollevent_t events) | cdev::CDev | protectedvirtual |
poll_notify_one(px4_pollfd_struct_t *fds, pollevent_t events) | cdev::CDev | protectedvirtual |
poll_state(file_t *filep) | cdev::CDev | inlineprotectedvirtual |
print_debug() | PX4IO | |
print_status(bool extended_status) | PX4IO | |
PX4IO(device::Device *interface) | PX4IO | |
PX4IO(const PX4IO &) | PX4IO | private |
read(file_t *filep, char *buffer, size_t buflen) | cdev::CDev | inlinevirtual |
register_class_devname(const char *class_devname) | cdev::CDev | protectedvirtual |
seek(file_t *filep, off_t offset, int whence) | cdev::CDev | inlinevirtual |
set_update_rate(int rate) | PX4IO | |
system_status() const | PX4IO | inline |
task_main() | PX4IO | private |
task_main_trampoline(int argc, char *argv[]) | PX4IO | privatestatic |
test_fmu_fail(bool is_fail) | PX4IO | inline |
unlock() | cdev::CDev | inlineprotected |
unregister_class_devname(const char *class_devname, unsigned class_instance) | cdev::CDev | protectedvirtual |
unregister_driver_and_memory() | cdev::CDev | protected |
write(file *filp, const char *buffer, size_t len) | PX4IO | virtual |
cdev::CDev::write(file_t *filep, const char *buffer, size_t buflen) | cdev::CDev | inlinevirtual |
~CDev() | cdev::CDev | virtual |
~PX4IO() | PX4IO | virtual |