Skip to content

Commit f243cec

Browse files
committed
update CHANGELOG.rsts for new release
1 parent 976f9f3 commit f243cec

File tree

10 files changed

+192
-1
lines changed

10 files changed

+192
-1
lines changed

diffbot_base/CHANGELOG.rst

Lines changed: 75 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,81 @@
22
Changelog for package diffbot_base
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* clean CMakeLists.txt: remove dependency
8+
* add dependency diffbot_msgs_generate_messages_cpp to build diffbot_msgs before diffbot_base package
9+
* Refactor: Update interface
10+
- Exchange jointStates between high hw intf and low level base
11+
controller
12+
- Add measured_joint_state publisher in base controller
13+
to let high level hw intf subscribe to it
14+
- Remove encoder publisher (todo consider publishing at low rate)
15+
- Update docstrings of BaseController
16+
- Extend interface of diffbot::Encoder class to read jointStates
17+
* refactor: renamed methods due to interface change: jointStates
18+
* use new jointState intf between high and low level base
19+
* make use of diffbot namespace
20+
* Update base_controller documentation
21+
- Update BaseController class
22+
- Add E_STOP_COMMAND_RECEIVED_DURATION define in diffbot_base_config
23+
* update diffbot_base
24+
- add diffbot namespace to base_controller library classes
25+
- update docstrings
26+
- run rosdoc_lite
27+
- fix some rosdoc_lite warnings
28+
* add diffbot_base launch arg to choose robot model (for remo and diffbot)
29+
* add AngularVelocitiesStamped.h for rosserial
30+
* remove measured_vel\_ publisher in rosserial
31+
* add low level pid
32+
- Add pid lib for arduino code
33+
- make use of pid in base_controller.h
34+
- update debug logging
35+
- use ros::time in encoder lib
36+
* set motor_constant=1 (gain trim model)
37+
* make use of new diffbot_msgs in hardware interface and base_controller
38+
* feat: add debug parameter to parameter server
39+
add option to enable/disable debug logging of the hw interface
40+
* refactor base_controller: use ros time instead of millis
41+
* refactor main.cpp: add base_controller class
42+
- add base_controller.h with BaseController template class
43+
- use class publisher and subscriber
44+
- use BaseController instead of global variables
45+
- read parameters from parameter server in BaseController
46+
* add encoder resolution to config header and getter/setter
47+
* add include guards to encoder.h
48+
* add base_controller rosserial code using rates
49+
* fix vector assignment of command velocity in hw intf
50+
* add tests for motor controllers
51+
* add compiled rosserial diffbot_msgs
52+
* add adafruit_feather_wing motor controller class header
53+
* moved adafruit_feather_wing.cpp to subfolder
54+
* add adafruit_feather_wing motor controller class
55+
* add author comment
56+
* add abstract MotorControllerInterface class
57+
* remove test_motors.cpp
58+
* update encoder lib for rosserial
59+
- add doc strings to encoder.h
60+
- add ticksToAngle method
61+
- add angularVelocity method
62+
* feature: update diffbot_hw_interface
63+
- add angular wheel joint velocity publisher
64+
- add new WheelCmd.msg in diffbot_msgs
65+
- load new hardware related parameters from
66+
diffbot_base/config/base.yaml
67+
- get hardware related parameters from parameter server
68+
in diffbot_hw_interface
69+
- add gain trim parameters to dynamic reconfigure cfg
70+
* refactor diffbot_msgs
71+
- rename Encoder.msg to Encoders.msg
72+
- update diffbot_pase includes and method signatures
73+
- update arduino script
74+
- change diffbot_msgs license to BSDv3
75+
* add base_controller mcu scripts including tests
76+
* Update package.xml
77+
change license and add rosserial to exec dependencies
78+
* Contributors: Franz Pucher
79+
580
0.0.2 (2021-04-30)
681
------------------
782
* fix `#30 <https://github.com/fjp/diffbot/issues/30>`_: reset encoders after each new launch of hardware interface

diffbot_bringup/CHANGELOG.rst

Lines changed: 15 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,21 @@
22
Changelog for package diffbot_bringup
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* Update bringup_with_laser.launch
8+
pass laser_frame_id argument to rplidar.launch
9+
* rename rosserial node to rosserial_base_controller
10+
* add remo_bringup.rviz
11+
* add model arg to diffbot_bringup launch files
12+
* flip camera image
13+
* add teleop_twist_keyboard to exec dependencies
14+
* use model parameter in diffbot_bringup/view_diffbot.launch
15+
* add keyboard_teleop launch file
16+
* add launch file and rviz config to view real robot
17+
* add rpicamera launch file and camera info
18+
* Contributors: Franz Pucher
19+
520
0.0.2 (2021-04-30)
621
------------------
722
* doc: update comment about node launch order

diffbot_control/CHANGELOG.rst

Lines changed: 10 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,16 @@
22
Changelog for package diffbot_control
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* use db_world by default for diffbot_control launch file
8+
* Update package.xml
9+
update license and email
10+
* increase linear and angular velocity limits
11+
* update wheel_seperation parameter
12+
* add model arg to launch files for remo
13+
* Contributors: Franz Pucher
14+
515
0.0.2 (2021-04-30)
616
------------------
717

diffbot_description/CHANGELOG.rst

Lines changed: 20 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,26 @@
22
Changelog for package diffbot_description
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* make use of non-gpu laser by default update min/max range to fix ghost objects (`#27 <https://github.com/ros-mobile-robots/diffbot/issues/27>`_)
8+
* update diffbot_description: add gpu arg for laser xacro macro (`#27 <https://github.com/ros-mobile-robots/diffbot/issues/27>`_)
9+
* fix diffbot_description laser link name
10+
* update camera sensor parameters
11+
* fix scale if statement in motor xacro macro
12+
* update motor.yaml comment
13+
* refactor diffbot_description
14+
- move stl files
15+
- use separate robot.gazebo.xacro
16+
- add addon xacro macro for addon components
17+
- simplify wheel and motor macros: remove top level name from yaml files
18+
- move caster macro to its own xacro file
19+
- add camera sensor macro
20+
- add imu sensor macro
21+
- refactor gpu laser macro
22+
- update license to BSDv3
23+
* Contributors: Franz Pucher
24+
525
0.0.2 (2021-04-30)
626
------------------
727

diffbot_gazebo/CHANGELOG.rst

Lines changed: 9 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,15 @@
22
Changelog for package diffbot_gazebo
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* use db_world as default world for diffbot_gazebo/launch/diffbot.launch
8+
* update rviz and gazebo view ports
9+
* add diffbot_world and export model
10+
* remove non-working empty.world and add working diffbot_empty.world
11+
* add model arg to launch files for remo
12+
* Contributors: Franz Pucher
13+
514
0.0.2 (2021-04-30)
615
------------------
716

diffbot_mbf/CHANGELOG.rst

Lines changed: 3 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,9 @@
22
Changelog for package diffbot_mbf
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
58
0.0.2 (2021-04-30)
69
------------------
710

diffbot_msgs/CHANGELOG.rst

Lines changed: 24 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,30 @@
22
Changelog for package diffbot_msgs
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* add AngularVelocitiesStamped.msg
8+
* add and refactor diffbot_msgs
9+
- Rename WheelCmd.msg to WheelsCmd.msg and removed Header
10+
- Add WheelsCmdStamped.msg
11+
- PID.msg and PIDStamped.msg
12+
- Refactor Encoders.msg (removing Header) and add EncodersStamped.msg
13+
* add WheelCmd.msg for angular wheel joint velocities
14+
* feature: update diffbot_hw_interface
15+
- add angular wheel joint velocity publisher
16+
- add new WheelCmd.msg in diffbot_msgs
17+
- load new hardware related parameters from
18+
diffbot_base/config/base.yaml
19+
- get hardware related parameters from parameter server
20+
in diffbot_hw_interface
21+
- add gain trim parameters to dynamic reconfigure cfg
22+
* refactor diffbot_msgs
23+
- rename Encoder.msg to Encoders.msg
24+
- update diffbot_pase includes and method signatures
25+
- update arduino script
26+
- change diffbot_msgs license to BSDv3
27+
* Contributors: Franz Pucher
28+
529
0.0.2 (2021-04-30)
630
------------------
731

diffbot_navigation/CHANGELOG.rst

Lines changed: 21 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -2,11 +2,31 @@
22
Changelog for package diffbot_navigation
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* improve amcl.launch parameters: use diff-corrected
8+
* fix typo in comment of costmap_global_params.yaml
9+
* update rviz and gazebo view ports
10+
* fix local costmap: change sensor_frame to rplidar_laser_link
11+
* updated diffbot_navigation rviz default settings
12+
* use db_world as default for navigation
13+
* add diffbot_world and export model
14+
* Update package.xml
15+
add dwa and base local planner package dependencies
16+
* update diffbot_navigation.rviz for remo
17+
* add comments to costmap_local_params.yaml
18+
* add comments to costmap_global_params.yaml
19+
* update costmap_common_params.yaml for Remo
20+
* add model arg to launch files for remo
21+
* update default planner: use dwa local planner
22+
* change license of diffbot_navigation package to BSDv3
23+
* Contributors: Franz Pucher
24+
525
0.0.2 (2021-04-30)
626
------------------
727
* Update diffbot.launch
828
* fix local costmap configuration issue
9-
* Contributors: Franz, Franz Pucher
29+
* Contributors: Franz Pucher
1030

1131
0.0.1 (2020-12-22)
1232
------------------

diffbot_robot/CHANGELOG.rst

Lines changed: 6 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,12 @@
22
Changelog for package diffbot_robot
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* Update package.xml
8+
remove grove_motor_driver exec dependency
9+
* Contributors: Franz Pucher
10+
511
0.0.2 (2021-04-30)
612
------------------
713

diffbot_slam/CHANGELOG.rst

Lines changed: 9 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,15 @@
22
Changelog for package diffbot_slam
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
Forthcoming
6+
-----------
7+
* Update package.xml
8+
add gmapping exec dependency
9+
* Update gmapping_params.yaml
10+
improve map resolution (change delta from 0.05 to 0.01)
11+
* remove new lines
12+
* Contributors: Franz Pucher
13+
514
0.0.2 (2021-04-30)
615
------------------
716

0 commit comments

Comments
 (0)