Skip to content

Commit

Permalink
Update changelog
Browse files Browse the repository at this point in the history
  • Loading branch information
vooon committed Jun 23, 2016
1 parent 3c9095d commit 82346a5
Show file tree
Hide file tree
Showing 5 changed files with 141 additions and 0 deletions.
39 changes: 39 additions & 0 deletions libmavconn/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,45 @@
Changelog for package libmavconn
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* libmavconn: Fix _KiB literal
* readme `#544 <https://github.com/mavlink/mavros/issues/544>`_: add udp-b://@ URL
* libmavconn fix `#544 <https://github.com/mavlink/mavros/issues/544>`_: New URL for UDP Broadcast (for GCS discovery)
Broadcast v4 address used until GCS respond.
udp-b://[bind_host][:bind_port]@[:remote_port]
* libmavconn: fix context.py.in
* libmavconn: Add protocol version selection helpers
* libmavconn: Use monotonic id for logging. Looks better than this ptr.
* node: Update plugin loading and message routing
* node: Rename plugib base class - API incompatible to old class
* labmavconn: remove set_thread_name(), add utils::format()
* libmavconn: APM dialect should be second
* libmavconn fix `#522 <https://github.com/mavlink/mavros/issues/522>`_: place generated files in source tree.
* libmavconn: Use EmPy to generate dialect-enabling files
* libmavconn: update copyright year
* libmavconn: update unit test
* libmavconn: Replace sig-slot with simple std::function() callbacks
* libmavconn: Limit send_message() queue maximum size.
* libmavconn:udp: try to make STL container handle allocations
* libmavconn: Use std::call_once() for init
* libmavconn: Leak in send_message() when it called from self IO thread (such as message_received event)
* libmavconn: update unit test
* libmavconn: support C++ serialization. Warn: RX leaks somewhere.
* libmavconn: Use MAVLink2 C++11
* labmavconn: trying to merge all dialects
* libmavconn: std::thread are invalidated before set_thread_name() called. Result is SIGSEGV
* labmavconn: finding sigsegv
* libmavconn: uncrustify
* libmavconn `#543 <https://github.com/mavlink/mavros/issues/543>`_: remove boost::signals2 (TCP)
* libmavconn `#543 <https://github.com/mavlink/mavros/issues/543>`_: remove boost::signals2 (UDP)
* libmavconn `#543 <https://github.com/mavlink/mavros/issues/543>`_: remove boost.signals2 (serial)
* libmavconn: uncrustify all
* mavconn: Import Simple Signal library (with some minor modifications).
Source file can be found here:
https://testbit.eu/cpp11-signal-system-performance/
* Contributors: Vladimir Ermakov

0.17.3 (2016-05-20)
-------------------
* libmavconn `#543 <https://github.com/mavlink/mavros/issues/543>`_: support build with mavlink 2.0 capable mavgen
Expand Down
72 changes: 72 additions & 0 deletions mavros/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,78 @@
Changelog for package mavros
^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* lib `#439 <https://github.com/mavlink/mavros/issues/439>`_: MAV_CMD to_string is not required.
* plugin:sys_status `#458 <https://github.com/mavlink/mavros/issues/458>`_: Hanlde BATTERY_STATUS (PX4)
* plugin:sys_status fix `#458 <https://github.com/mavlink/mavros/issues/458>`_: Use sensor_msgs/BatteryState message.
Minimal data, for all other need to handle BATTERY_STATUS.
* plugin:command fix `#561 <https://github.com/mavlink/mavros/issues/561>`_: PX4 now sends COMMAND_ACK.
And like APM do not check confirmation field. :)
* readme `#544 <https://github.com/mavlink/mavros/issues/544>`_: add udp-b://@ URL
* plugin:hil_controls: Update plugin API
* Merge branch 'feature/hil_controls_plugin' of https://github.com/pvechersky/mavros into pvechersky-feature/hil_controls_plugin
* 'feature/hil_controls_plugin' of https://github.com/pvechersky/mavros:
Adding anchor to the HIL_CONTROLS message reference link
Ran uncrustify on hil_controls plugin
Utilizing synchronise_stamp and adding reference to MAVLINK msg documentation
Added a plugin that publishes HIL_CONTROLS as ROS messages
* node: fix subscription message type checks
* plugin: use mavlink::to_string() for std::array<char, N>
* readme: update CI, no more MAVLINK_DIALECT
* plugin:waypoint: Fix target id's on MISSION_ITEM
* node: Add ~fcu_protocol parameter
* Ran uncrustify on hil_controls plugin
* Utilizing synchronise_stamp and adding reference to MAVLINK msg documentation
* node: set gcs_url on internal GCS bridge diag hardware Id
* plugins: Use UAS::msg_set_target()
* Added a plugin that publishes HIL_CONTROLS as ROS messages
* lib: PX4 add AUTO.FOLLOW_TARGET
* mavros: Update tests
* extras: Update UAS
* UAS: Update plugins for FTF module
* UAS: move enum stringify functions
* lib: Generate MAV_SENSOR_ORIENTATION
* UAS: move MAV_SENSOR_ORIENTATION out
* UAS: Move transformation utilities to ftf module
* plugin:rc_io: Fix log printf-format warning
* make GCC 4.8 happy. (travis)
* gcs_bridge: done
* param:ftp: Update API
* plugin:param: Works. Tested on APM
* plugin:param: Update, almost work
* plugin:waypoint: Fix Item - ROS binding
* Message type mismatch code do not work
* plugin:waypoint: Update API
* plugin:sys_time: Update API
* plugin:sys_status: Update API
* plugin:setpoint_raw: Update API
* plugin:setpoint_attitude: Update API
* plugin:setpoint_accel: Update API
* plugin:setpoint_velocity: Update API
* plugin:setpoint_position: Update API
* plugin:vfr_hud: Update API
* plugin:safety_area: Update API
* plugin:rc_io: Update API
* plugin:manual_control: Update API, fix uas init
* plugin:local_position: Update API
* plugin:imu_pub: Update API
* plugin:global_position: Update API
* mavros: make_handle() this shouldn't be const
* plugin:common: Update API
* plugin:altitude: uncrustify
* plugins: Rutine sed + fix misprint
* plugin:altitude: Update API
* plugins: Automatic replacement of routine API changes (sed)
* plugin:actuator_control: Update API
* plugin:3dr_radio: Update API
* node: Update plugin loading and message routing
* node: type_info -> SIGSEGV
* node: prepare new plugin loading
* node: Rename plugib base class - API incompatible to old class
* labmavconn: finding sigsegv
* Contributors: Pavel, Vladimir Ermakov

0.17.3 (2016-05-20)
-------------------
* libmavconn `#543 <https://github.com/mavlink/mavros/issues/543>`_: support build with mavlink 2.0 capable mavgen
Expand Down
16 changes: 16 additions & 0 deletions mavros_extras/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,22 @@
Changelog for package mavros_extras
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* extras `#560 <https://github.com/mavlink/mavros/issues/560>`_: remove cv_bridge and image_transport deps
* extras: Update UAS
* extras:vision_speed_estimate: Update API
* extras:vision_pose_estimate: Update API
* extras:px4flow: Update API
* extras:mocap_pose_estimate: Update API
* extras:distance_sensor: Update API
* extras:cam_imu_sync: Update API
* extras: Automatic update by sed
* extras: prepare to update
* extras `#560 <https://github.com/mavlink/mavros/issues/560>`_: Remove image streaming over mavlink support.
Use external RTP streamer, e.g. https://github.com/ProjectArtemis/gst_video_server
* Contributors: Vladimir Ermakov

0.17.3 (2016-05-20)
-------------------

Expand Down
9 changes: 9 additions & 0 deletions mavros_msgs/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,15 @@
Changelog for package mavros_msgs
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Adding anchor to the HIL_CONTROLS message reference link
* Utilizing synchronise_stamp and adding reference to MAVLINK msg documentation
* Added a plugin that publishes HIL_CONTROLS as ROS messages
* node: Rename plugib base class - API incompatible to old class
* msgs `#543 <https://github.com/mavlink/mavros/issues/543>`_: Update for MAVLink 2.0
* Contributors: Pavel, Vladimir Ermakov

0.17.3 (2016-05-20)
-------------------

Expand Down
5 changes: 5 additions & 0 deletions test_mavros/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package test_mavros
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
* Test_mavros : fix compilation on gcc6.1
* Contributors: khancyr

0.17.3 (2016-05-20)
-------------------
* test `#546 <https://github.com/mavlink/mavros/issues/546>`_: Added check of control_toolbox version (1.14.0)
Expand Down

0 comments on commit 82346a5

Please sign in to comment.