-
 
No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

dynamic_reconfigure package from dynamic_reconfigure repo

dynamic_reconfigure

Package Summary

Tags No category tags.
Version 1.7.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/dynamic_reconfigure.git
VCS Type git
VCS Version noetic-devel
Last Updated 2022-10-04
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The dynamic_reconfigure package provides a means to update parameters at runtime without having to restart the node.

Additional Links

Maintainers

  • Michael Carroll

Authors

  • Blaise Gassend
README
No README found. No README in repository either.
CHANGELOG

Changelog for package dynamic_reconfigure

1.7.3 (2022-05-05)

  • Add Loader=yaml.Loader to yaml.load (#178)
  • Switch to new boost/bind/bind.hpp (#191)
  • Contributors: Charles Jenkins, Jochen Sprickerhof

1.7.2 (2022-02-19)

  • Remove calls to string.{join,lower,upper} (#174)
  • fix: Race condition on quickly setting and getting config (#188)
  • do not use system for generated messages or configs (#182)
  • Contributors: Gaël Écorchard, Rokus Ottervanger, Shingo Kitagawa

1.7.1 (2020-08-28)

  • narrow down required boost dependencies (#160)
  • Make Config object pickle-able in Python 3 (#154)
  • Fix python3 issue in a backward compatible way (#157)
  • import setup from setuptools instead of distutils-core (#153)
  • Contributors: Alejandro Hernández Cordero, Mikael Arguedas, Scott K Logan

1.7.0 (2020-03-05)

  • Fixing compile error with cpp client when using -Werror=reorder. (#118)
  • ConfigType.h.template: fixed warnings (#136) (#149)
  • Bump CMake minimum version to use CMP0048 (#148)
  • Use PYTHON_EXECUTABLE to generate config headers. (#146)
  • Python3 compatibility (#135)
  • Use system on gen headers (#140)
  • Fix GCC8 error for unnecessary parentheses (#132)
  • fix generate_dynamic_reconfigure_options (#10) (#134)
  • Make Michael Carroll the maintainer (#125)
  • Contributors: Christopher Wecht, Markus Grimm, Michael Carroll, Mikael Arguedas, Nicolas Limpert, Sean Yen [MSFT], Victor Lopez

1.6.0 (2018-10-02)

  • fix check preventing range for string and bool parameters (#122)
  • Fix build issue on Windows (#114)
  • Contributors: Johnson Shih, Mikael Arguedas

1.5.50 (2018-10-02)

  • final-keyword (#113)
    • Add final keyword to child class since parent has virtual methods and grand parent doesn't have a virtual destructor. This allows the code to be compiled by clang version 6.0 and above.
  • [indentation fixups]
    • Use textwrap dedent for multiline strings
    • Remove extra indentation in wikidoc
    • Use textwrap.dedent to form the error message
  • [test fix] call shutdown to prevent test from hanging (#119)
  • Modernize Python code (#102)
    • Use new-style classes
    • Use with statement to ensure files are closed
  • Python 3 compatibility (#105)
    • some randon python cleanup
    • remove iter* method for their 2/3 compatible equivalent
  • Contributors: Eric Wieser, Jason Mercer, Mikael Arguedas

1.5.49 (2017-07-27)

  • Pep8 (#93)
  • Python3 use print function and not statement (#92)
  • add shebang line in setup_custom_pythonpath.sh.in template (#91)
  • switch to package format 2 (#89)
  • remove trailing whitespaces (#88)
  • Reraising DynamicReconfigureCallbackException in case of a failing service call (#87)
  • Contributors: Arne Hitzmann, Mikael Arguedas

1.5.48 (2017-04-07)

  • [Bugfix] dont enforce ROS names for constants (#84)
  • [Compiler warnings] avoid unused-parameter compiler warnings in specialized ParamDescription<std::string>::clamp() (#83)
  • Contributors: Johannes Meyer, Mikael Arguedas

1.5.47 (2017-03-27)

  • reset received_configuration_ for every request sent (#82)
  • Rename arguments (with a_ prefix) to avoid Wshadow warnings. (#80) handle infinity in python generation, fixes (#77)
  • Add a c++ Dynamic Reconfigure Client (#78)
  • Enforce valid descriptions in cfg files (#74)
  • Fix callback returned by get_description_callback (#73) from ros/description_cb
  • Contributors: Jeff Eberl, Mikael Arguedas

1.5.46 (2016-11-15)

  • Add missing group params to wikidoc (#68) The catkin generated wikidoc files were missing parameters defined as groups. Both the Dox and UsageDox file were generated correctly, but the wikidoc was using the wrong method to traverse all groups.
  • Contributors: Mark Horn

1.5.45 (2016-10-24)

  • Merge pull request #65 from bulwahn/master address gcc6 build error
  • address gcc6 build error With gcc6, compiling fails with [stdlib.h: No such file or directory]{.title-ref}, as including '-isystem /usr/include' breaks with gcc6, cf., https://gcc.gnu.org/bugzilla/show_bug.cgi?id=70129. This commit addresses this issue for this package in the same way it was addressed in various other ROS packages. A list of related commits and pull requests is at: https://github.com/ros/rosdistro/issues/12783 Signed-off-by: Lukas Bulwahn <<lukas.bulwahn@oss.bmw-carit.de>>
  • Contributors: Lukas Bulwahn, Mikael Arguedas

1.5.44 (2016-06-22)

  • Add server namespaces (#56)
    • Add optional namespace argument to Python Server
    • Add test for server with multiple namespaces
  • Merge pull request #61 from vagvaz/Issue_51_Unable_to_reload_parameters_from_file fix issue #51 reloading parameters from dumped file
  • Contributors: Evangelos Vazaios, Mikael Arguedas, v-lopez

1.5.43 (2016-03-19)

  • add devel space to Python environment to allow .cfg files to import them #60
  • Contributors: Dirk Thomas

1.5.42 (2016-03-15)

  • fix Python environment to make it work on the first run #59
  • Contributors: Dirk Thomas

1.5.41 (2016-03-14)

  • fix Python environment to make it work on the first run #58
  • Contributors: Dirk Thomas, Mikael Arguedas

1.5.40 (2016-03-11)

  • updated maintainer
  • Contributors: Mikael Arguedas

1.5.39 (2015-04-22)

  • Better error message, to fix #32
  • Make Python callback code consistent with the C++ API
  • Commented unused parameters to avoid compile warnings
  • Contributors: Esteve Fernandez, Morgan Quigley

1.5.38 (2014-12-23)

  • Fixes #35 by setting queue_size to 10 for publishers.
  • Fixes #31 by removing boilerplate and copyright info from config header.
  • Python 3 Support
  • Honor BUILD_SHARED_LIBS and do not force building shared libraries.
  • Unicode support
  • Contributors: Basheer Subei, Esteve Fernandez, Gary Servin, Kei Okada, Scott K Logan

1.5.37 (2014-06-16)

  • Decode level of ParamDescription
  • Added testsuite
  • Avoid collisions with parameter names (#6)
  • Contributors: Esteve Fernandez, pgorczak

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
aruco_ros
ff_util
avt_vimba_camera
axis_camera
basler_tof
cob_helper_tools
cob_base_velocity_smoother
cob_collision_velocity_filter
cob_frame_tracker
cob_obstacle_distance
cob_omni_drive_controller
cob_trajectory_controller
cob_twist_controller
cob_voltage_control
control_toolbox
costmap_converter
cras_cpp_common
cras_py_common
image_transport_codecs
ddynamic_reconfigure
ddynamic_reconfigure_python
depthai_filters
depthai_ros_driver
depthimage_to_laserscan
driver_base
dynamic_robot_state_publisher
aruco_detect
fiducial_slam
stag_detect
frame_editor
franka_example_controllers
gazebo_plugins
gazebo_ros
graceful_controller_ros
graft
hector_gazebo_plugins
hfl_driver
image_proc
image_publisher
image_rotate
image_view
stereo_image_proc
compressed_depth_image_transport
compressed_image_transport
theora_image_transport
imu_filter_madgwick
mini_maxwell
voice_text
opt_camera
respeaker_ros
respeaker_ros
ros_speech_recognition
rostwitter
dynamic_tf_publisher
jsk_data
jsk_network_tools
jsk_tilt_laser
jsk_topic_tools
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
pr2eus
audio_to_spectrogram
checkerboard_detector
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_utils
roseus
jsk_interactive_marker
jsk_rviz_plugins
kvh_geo_fog_3d_driver
laser_filters
libuvc_camera
swri_roscpp
ros_base
mir_driver
mocap_nokov
mocap_optitrack
mbf_abstract_nav
mbf_costmap_nav
mbf_simple_nav
move_base_swp
move_basic
moveit_planners_ompl
moveit_ros_manipulation
moveit_ros_planning
mpc_local_planner
mrpt_local_obstacles
mrpt_localization
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_icp_slam_2d
mrpt_rbpf_slam
fkie_node_manager
multisense_ros
mvsim
amcl
base_local_planner
costmap_2d
dwa_local_planner
global_planner
move_base
pose_follower
neo_local_planner
planner_cspace
safety_limiter
trajectory_tracker
nerian_stereo
nodelet_topic_tools
nonpersistent_voxel_layer
octomap_server
osm_cartography
route_network
opencv_apps
openni2_camera
openni_camera
pass_through_controllers
face_detector
leg_detector
pcl_ros
pf_driver
pid
prbt_hardware_support
point_cloud_transport
draco_point_cloud_transport
pointgrey_camera_driver
pr2_move_base
pr2_navigation_perception
power_monitor
pr2_camera_synchronizer
prosilica_camera
py_trees_msgs
py_trees_ros
razor_imu_9dof
rc_genicam_camera
rc_genicam_driver
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
robot_body_filter
dwb_plugins
diff_drive_controller
twist_controller
rqt_reconfigure
rtabmap_costmap_plugins
rtabmap_legacy
sciurus17_msgs
sciurus17_vision
sick_ldmrs_driver
sick_safetyscanners
sick_scan
sick_tim
backward_global_planner
forward_global_planner
pure_spinning_local_planner
undo_path_global_planner
move_base_z_client_plugin
spatio_temporal_voxel_layer
teb_local_planner
tuw_multi_robot_router
tuw_voronoi_graph
ubiquity_motor
ueye_cam
urg_node
velo2cam_calibration
velodyne_driver
velodyne_laserscan
velodyne_pointcloud
video_stream_opencv
visp_tracker
wge100_camera
aruco_opencv
astra_ros
beluga_amcl
camera_aravis
diffbot_base
dnn_detect
spinnaker_camera_driver
gmcl
ipcamera_driver
l3cam_ros
leo_example_line_follower
leo_example_object_detection
line_planner
quori_controller
quori_face
rm_common
rm_gimbal_controllers
rm_shooter_controllers
serl_franka_controllers
sick_scan_xd
sob_layer
turtlebot3_autorace_camera
turtlebot3_autorace_detect
vizanti

Recent questions tagged dynamic_reconfigure at Robotics Stack Exchange

No version for distro galactic. Known supported distros are highlighted in the buttons above.

dynamic_reconfigure package from dynamic_reconfigure repo

dynamic_reconfigure

Package Summary

Tags No category tags.
Version 1.6.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/dynamic_reconfigure.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-05-05
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

The dynamic_reconfigure package provides a means to update parameters at runtime without having to restart the node.

Additional Links

Maintainers

  • Michael Carroll

Authors

  • Blaise Gassend
README
No README found. No README in repository either.
CHANGELOG

Changelog for package dynamic_reconfigure

1.6.5 (2022-05-05)

  • Add Loader=yaml.Loader to yaml.load (#178)
  • Contributors: Charles Jenkins

1.6.4 (2022-02-19)

  • fix: Race condition on quickly setting and getting config (#188) (#190)
  • Contributors: Rokus Ottervanger

1.6.3 (2020-03-19)

  • Revert #140 (#152)
  • Contributors: Michael Carroll

1.6.2 (2020-03-19)

  • Set right order of SYSTEM/BEFORE options in dynamic_reconfigure-macros.cmake. Fix #150 (#151)
  • Contributors: Alexander

1.6.1 (2020-03-05)

  • Use PYTHON_EXECUTABLE to generate config headers. (#146)
  • Python3 compatibility (#135)
  • Use system on gen headers (#140)
  • Fix GCC8 error for unnecessary parentheses (#132)
  • fix generate_dynamic_reconfigure_options (#10) (#134)
  • Make Michael Carroll the maintainer (#125)
  • Contributors: Christopher Wecht, Markus Grimm, Michael Carroll, Mikael Arguedas, Nicolas Limpert, Sean Yen [MSFT], Victor Lopez

1.6.0 (2018-10-02)

  • fix check preventing range for string and bool parameters (#122)
  • Fix build issue on Windows (#114)
  • Contributors: Johnson Shih, Mikael Arguedas

1.5.50 (2018-10-02)

  • final-keyword (#113)
    • Add final keyword to child class since parent has virtual methods and grand parent doesn't have a virtual destructor. This allows the code to be compiled by clang version 6.0 and above.
  • [indentation fixups]
    • Use textwrap dedent for multiline strings
    • Remove extra indentation in wikidoc
    • Use textwrap.dedent to form the error message
  • [test fix] call shutdown to prevent test from hanging (#119)
  • Modernize Python code (#102)
    • Use new-style classes
    • Use with statement to ensure files are closed
  • Python 3 compatibility (#105)
    • some randon python cleanup
    • remove iter* method for their 2/3 compatible equivalent
  • Contributors: Eric Wieser, Jason Mercer, Mikael Arguedas

1.5.49 (2017-07-27)

  • Pep8 (#93)
  • Python3 use print function and not statement (#92)
  • add shebang line in setup_custom_pythonpath.sh.in template (#91)
  • switch to package format 2 (#89)
  • remove trailing whitespaces (#88)
  • Reraising DynamicReconfigureCallbackException in case of a failing service call (#87)
  • Contributors: Arne Hitzmann, Mikael Arguedas

1.5.48 (2017-04-07)

  • [Bugfix] dont enforce ROS names for constants (#84)
  • [Compiler warnings] avoid unused-parameter compiler warnings in specialized ParamDescription<std::string>::clamp() (#83)
  • Contributors: Johannes Meyer, Mikael Arguedas

1.5.47 (2017-03-27)

  • reset received_configuration_ for every request sent (#82)
  • Rename arguments (with a_ prefix) to avoid Wshadow warnings. (#80) handle infinity in python generation, fixes (#77)
  • Add a c++ Dynamic Reconfigure Client (#78)
  • Enforce valid descriptions in cfg files (#74)
  • Fix callback returned by get_description_callback (#73) from ros/description_cb
  • Contributors: Jeff Eberl, Mikael Arguedas

1.5.46 (2016-11-15)

  • Add missing group params to wikidoc (#68) The catkin generated wikidoc files were missing parameters defined as groups. Both the Dox and UsageDox file were generated correctly, but the wikidoc was using the wrong method to traverse all groups.
  • Contributors: Mark Horn

1.5.45 (2016-10-24)

  • Merge pull request #65 from bulwahn/master address gcc6 build error
  • address gcc6 build error With gcc6, compiling fails with [stdlib.h: No such file or directory]{.title-ref}, as including '-isystem /usr/include' breaks with gcc6, cf., https://gcc.gnu.org/bugzilla/show_bug.cgi?id=70129. This commit addresses this issue for this package in the same way it was addressed in various other ROS packages. A list of related commits and pull requests is at: https://github.com/ros/rosdistro/issues/12783 Signed-off-by: Lukas Bulwahn <<lukas.bulwahn@oss.bmw-carit.de>>
  • Contributors: Lukas Bulwahn, Mikael Arguedas

1.5.44 (2016-06-22)

  • Add server namespaces (#56)
    • Add optional namespace argument to Python Server
    • Add test for server with multiple namespaces
  • Merge pull request #61 from vagvaz/Issue_51_Unable_to_reload_parameters_from_file fix issue #51 reloading parameters from dumped file
  • Contributors: Evangelos Vazaios, Mikael Arguedas, v-lopez

1.5.43 (2016-03-19)

  • add devel space to Python environment to allow .cfg files to import them #60
  • Contributors: Dirk Thomas

1.5.42 (2016-03-15)

  • fix Python environment to make it work on the first run #59
  • Contributors: Dirk Thomas

1.5.41 (2016-03-14)

  • fix Python environment to make it work on the first run #58
  • Contributors: Dirk Thomas, Mikael Arguedas

1.5.40 (2016-03-11)

  • updated maintainer
  • Contributors: Mikael Arguedas

1.5.39 (2015-04-22)

  • Better error message, to fix #32
  • Make Python callback code consistent with the C++ API
  • Commented unused parameters to avoid compile warnings
  • Contributors: Esteve Fernandez, Morgan Quigley

1.5.38 (2014-12-23)

  • Fixes #35 by setting queue_size to 10 for publishers.
  • Fixes #31 by removing boilerplate and copyright info from config header.
  • Python 3 Support
  • Honor BUILD_SHARED_LIBS and do not force building shared libraries.
  • Unicode support
  • Contributors: Basheer Subei, Esteve Fernandez, Gary Servin, Kei Okada, Scott K Logan

1.5.37 (2014-06-16)

  • Decode level of ParamDescription
  • Added testsuite
  • Avoid collisions with parameter names (#6)
  • Contributors: Esteve Fernandez, pgorczak

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
ar_track_alvar
aruco_ros
asr_aruco_marker_recognition
asr_descriptor_surface_based_recognition
asr_direct_search_manager
asr_fake_object_recognition
asr_ftc_local_planner
asr_ism
asr_ism_visualizations
asr_world_model
ff_util
avt_vimba_camera
axis_camera
basler_tof
bta_tof_driver
cis_camera
aruco_pose
cob_helper_tools
cob_base_velocity_smoother
cob_collision_velocity_filter
cob_frame_tracker
cob_obstacle_distance
cob_omni_drive_controller
cob_trajectory_controller
cob_twist_controller
cob_voltage_control
cognitao_ros
control_toolbox
copernicus_control
costmap_converter
costmap_tf_layer
cras_cpp_common
cras_py_common
image_transport_codecs
ddynamic_reconfigure
ddynamic_reconfigure_python
depthcloud_encoder
depthimage_to_laserscan
driver_base
dynamic_robot_state_publisher
eband_local_planner
aruco_detect
fiducial_slam
force_torque_sensor
frame_editor
franka_example_controllers
freenect_camera
gazebo_plugins
gazebo_ros
graceful_controller_ros
graft
hector_gazebo_plugins
hfl_driver
igvc_self_drive_gazebo_plugins
iirob_filters
image_proc
image_publisher
image_rotate
image_view
stereo_image_proc
compressed_depth_image_transport
compressed_image_transport
theora_image_transport
imu_filter_madgwick
mini_maxwell
voice_text
opt_camera
respeaker_ros
ros_speech_recognition
rostwitter
dynamic_tf_publisher
jsk_data
jsk_network_tools
jsk_tilt_laser
jsk_topic_tools
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
pr2eus
audio_to_spectrogram
checkerboard_detector
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_utils
roseus
jsk_interactive_marker
jsk_rviz_plugins
kvh_geo_fog_3d_driver
laser_filters
libuvc_camera
access_point_control
ddwrt_access_point
hostapd_access_point
linksys_access_point
multi_interface_roam
network_control_tests
network_traffic_control
swri_roscpp
ros_base
mir_driver
mocap_nokov
mocap_optitrack
mbf_abstract_nav
mbf_costmap_nav
mbf_simple_nav
move_base_swp
move_basic
moveit_planners_ompl
moveit_ros_manipulation
moveit_ros_planning
mpc_local_planner
mrp2_hardware
mrpt_local_obstacles
mrpt_localization
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_icp_slam_2d
mrpt_rbpf_slam
node_manager_fkie
multisense_ros
mvsim
amcl
base_local_planner
costmap_2d
dwa_local_planner
global_planner
move_base
pose_follower
range_sensor_layer
social_navigation_layers
neo_local_planner
planner_cspace
safety_limiter
trajectory_tracker
nerian_stereo
nodelet_topic_tools
nonpersistent_voxel_layer
octomap_server
osm_cartography
route_network
opencv_apps
openni2_camera
openni_camera
optris_drivers
orb_slam2_ros
pass_through_controllers
face_detector
leg_detector
pcl_ros
pf_driver
pid
prbt_hardware_support
ping360_sonar
pipeline_planner
point_cloud_transport
draco_point_cloud_transport
pointgrey_camera_driver
pr2_move_base
pr2_navigation_perception
power_monitor
pr2_camera_synchronizer
prosilica_camera
py_trees_msgs
py_trees_ros
razor_imu_9dof
rc_genicam_camera
rc_genicam_driver
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
rslidar_driver
rslidar_pointcloud
robot_body_filter
dwb_plugins
diff_drive_controller
twist_controller
rosparam_handler
rotors_control
rqt_reconfigure
rtabmap_ros
hrpsys_ros_bridge
sciurus17_msgs
sciurus17_vision
sick_ldmrs_driver
sick_safetyscanners
sick_scan
sick_tim
backward_global_planner
forward_global_planner
pure_spinning_local_planner
undo_path_global_planner
move_base_z_client_plugin
spatio_temporal_voxel_layer
sr_hand
sr_grasp
teb_local_planner
teraranger
teraranger_array
turtlebot3_autorace_camera
turtlebot3_autorace_detect
tuw_aruco
tuw_checkerboard
tuw_ellipses
tuw_marker_pose_estimation
tuw_multi_robot_router
tuw_voronoi_graph
ubiquity_motor
ueye_cam
urg_node
uuv_control_cascaded_pid
velo2cam_calibration
velodyne_driver
velodyne_laserscan
velodyne_pointcloud
video_stream_opencv
visp_tracker
wge100_camera
xaxxon_openlidar
yocs_msgs
yocs_ar_pair_approach
yocs_cmd_vel_mux
yocs_localization_manager
yocs_velocity_smoother

Recent questions tagged dynamic_reconfigure at Robotics Stack Exchange