aboutsummaryrefslogtreecommitdiff
path: root/src/modules/uORB/objects_common.cpp
Commit message (Collapse)AuthorAgeFilesLines
* uORB: added actuator_direct topicAndrew Tridgell2014-11-261-0/+3
| | | | | this topic will be used to allow direct output of actuator values for uavcan, bypassing the mixer.
* Merge pull request #1326 from hsteinhaus/drive_testingLorenz Meier2014-10-301-0/+3
|\ | | | | Drive testing interface and cmd line tool
| * ORB topic for drive testing requestsHolger Steinhaus2014-08-261-0/+3
| |
* | mixer_multirotor: topic for motor limit notificationHolger Steinhaus2014-08-261-0/+3
|/
* Merged masterLorenz Meier2014-07-311-4/+11
|\
| * uORB: Support up to three topics per sensorLorenz Meier2014-07-151-0/+3
| |
| * Merged masterLorenz Meier2014-07-151-1/+16
| |\
| * | introduce multi device support on uORBLorenz Meier2014-06-101-4/+8
| | |
* | | Merged master into vision_estimateLorenz Meier2014-07-091-1/+10
|\ \ \ | | |/ | |/|
| * | Merge pull request #1072 from PX4/forcesetpointLorenz Meier2014-07-081-0/+3
| |\ \ | | | | | | | | Force setpoint uorb topic
| | * \ Merge remote-tracking branch 'upstream/master' into forcesetpointThomas Gubler2014-06-301-0/+6
| | |\ \ | | | | | | | | | | | | | | | | | | | | Conflicts: src/modules/uORB/objects_common.cpp
| | * | | define force setpoint uorb topicThomas Gubler2014-06-231-0/+3
| | | |/ | | |/|
| * | | telemetry_statur: use 4 separate topicsAnton Babushkin2014-07-061-1/+4
| | | |
| * | | Merged upstream master into gnss_rework branchKynos2014-06-301-0/+6
| |\ \ \ | | | |/ | | |/|
| * | | U-blox driver rework, step 2Kynos2014-05-301-0/+3
| | |/ | |/| | | | | | | | | | | | | | | | Moved satellite info from vehicle_gps_position_s into a new uORB topic satellite_info. Renamed satellites_visible to satellites_used to reflect true content. sdlog2 will log info for GPS satellites only for now.
* | | Merged master into vision_estimateLorenz Meier2014-07-011-0/+6
|\ \ \ | | |/ | |/|
| * | wind estimate: added uORB topicLorenz Meier2014-06-011-0/+2
| | |
| * | introduce tecs status uorb messageThomas Gubler2014-05-241-0/+4
| |/
* / Added vision position estimate topicLorenz Meier2014-06-051-0/+3
|/
* navigator: wrong mission topic was copied, clearer naming of offboard ↵Julian Oes2014-04-181-1/+1
| | | | mission now
* uORB: added an ORB topic for system_powerAndrew Tridgell2014-04-051-0/+3
| | | | holds power supply state and 5V rail voltage on FMUv2
* Added EKF filter health status reporting, added dynamic in-air reset.Lorenz Meier2014-03-241-0/+3
|
* Added encoder uORB message/ fixedwing_backside working if enabled.James Goppert2014-03-201-0/+3
|
* Replace mission_item_triplet with position_setpoint_triplet, WIPAnton Babushkin2014-01-231-2/+2
|
* Topics: Move from global_position_setpoint to mission_item_tripletJulian Oes2013-12-261-3/+0
|
* Merge remote-tracking branch 'upstream/master' into ↵Thomas Gubler2013-12-131-7/+0
|\ | | | | | | | | | | | | fw_autoland_att_tecs_navigator_termination_controlgroups Conflicts: src/drivers/px4io/px4io.cpp
| * actuator_controls_effective topic removedAnton Babushkin2013-11-161-7/+0
| |
* | Navigator: Added onboard mission (not usable yet)Julian Oes2013-11-291-0/+1
| |
* | Mavlink and navigator: Disable some functions in mavlink that are taken over ↵Julian Oes2013-11-271-0/+3
| | | | | | | | by navigator, introduce topic to report mission status from commander back to mavlink
* | Mission topic: Use mission topic instead of global position for tripletJulian Oes2013-11-201-2/+2
| |
* | Add data manager module and fence support to navigatorJean Cyr2013-11-031-0/+3
|/ | | | | | | | - Add function to geo.c to determine if global position is inside fence - Add navigator support/commands for maintaining fence coords. - Add data manager module to support persistence fence storage. Can store other data, but only used for fence at this time. - Add unit tests for data manager
* uORB: added new servorail_status objectAndrew Tridgell2013-09-121-0/+3
| | | | used for VSERVO and RSSI on FMUv2
* merged master, updated fixed wingLorenz Meier2013-08-161-0/+4
|\
| * Hotfix: Fixed Doxygen tags for uORB topicsLorenz Meier2013-08-151-0/+4
| |
* | Merge branch 'seatbelt_multirotor' into seatbelt_multirotor_newAnton Babushkin2013-08-161-0/+3
|\ \ | | | | | | | | | WIP, TODO fixedwing
| * | uORB topic vehicle_global_velocity_setpoint addedAnton Babushkin2013-07-121-0/+3
| |/
* | Renamed actuator_safety back to actuator_armed, compiling but untestedJulian Oes2013-07-151-3/+6
| |
* | Merged masterLorenz Meier2013-07-151-0/+3
|\|
| * Merged mkblctrlLorenz Meier2013-07-081-0/+3
| |\
| | * mkclctrl 8/11Bit support, uOrb Topic added, ESC Topic to Sdlog2 addedmarco2013-07-021-0/+3
| | |
* | | Merge branch 'master' into new_state_machineJulian Oes2013-07-081-0/+8
|\| | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | compiling again Conflicts: src/modules/fixedwing_att_control/fixedwing_att_control_att.c src/modules/fixedwing_att_control/fixedwing_att_control_rate.c src/modules/fixedwing_pos_control/fixedwing_pos_control_main.c src/modules/mavlink/orb_listener.c src/modules/multirotor_att_control/multirotor_attitude_control.c src/modules/multirotor_att_control/multirotor_rate_control.c src/modules/systemlib/pid/pid.c src/modules/systemlib/pid/pid.h src/modules/uORB/objects_common.cpp
| * | Update to uORB topics, added / improved position triplet, added radio statusLorenz Meier2013-07-041-0/+9
| |/
* | Dropped superseded safety topic, added warning tones before armingJulian Oes2013-06-251-3/+0
| |
* | Merge remote-tracking branch 'upstream/io_fixes' into new_state_machineJulian Oes2013-06-181-0/+4
|\ \ | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | Conflicts: src/drivers/px4io/px4io.cpp src/modules/commander/commander.c src/modules/commander/state_machine_helper.c src/modules/commander/state_machine_helper.h src/modules/px4iofirmware/mixer.cpp src/modules/uORB/topics/actuator_controls.h src/modules/uORB/topics/vehicle_status.h
| * | Added safety status feedback, disallow arming of a rotary wing with engaged ↵Lorenz Meier2013-06-091-0/+4
| | | | | | | | | | | | safety
* | | Added ctrl debugging valuesJulian Oes2013-06-161-0/+3
| | |
* | | Merge branch 'pid_fixes' into new_state_machineJulian Oes2013-06-151-0/+6
|\ \ \ | | |/ | |/|
| * | Add PX4Flow board modules and corresponding ORB msgs.samuezih2013-06-141-0/+6
| |/
* | Controllers should not access state machine anymore but access the ↵Julian Oes2013-06-151-0/+3
| | | | | | | | vehicle_control_mode flags
* | Introduced new actuator_safety topicJulian Oes2013-06-141-1/+3
|/