Replies: 1 comment
-
|
There is a third way I'm finding all over the code base and that is calling There is a forth way, that in affect is similar to the third way, which is calling |
Beta Was this translation helpful? Give feedback.
0 replies
Sign up for free
to join this conversation on GitHub.
Already have an account?
Sign in to comment
Uh oh!
There was an error while loading. Please reload this page.
Uh oh!
There was an error while loading. Please reload this page.
-
There are two basic ways that parameters are declared in moveit. In some cases
automatically_declare_parameters_from_overridesis set and parameters are automatically declared from what is in yaml files. The second way is with thedelcare_parametermethod onrclcpp::Node.Below I've cataloged the parameter usage by MoveIt. Calling out the two ways that parameters get declared and in what file that happens. Then I listed each parameter and its type that is explicitly declared.
I propose we work on a unified design for our parameter names so the configs become more consistent and easy to use before changing how we declare parameters in the code.
automatically_declare_parameters_from_overrides
declare_parameters
setup_assistant_widget.cpp
urdf_config.cpp
srdf_config.cpp
planning_scene_monitor.cpp
robot_model_loader.cpp
kinematics_plugin_loader.cpp
synchronized_string_parameter.cpp
boring_string_publisher.cpp
motion_planning_frame.cpp
pose_tracking.cpp
servo_parameters.cpp
unit_test_servo_calcs.cpp
test_basic_integration.cpp
local_plannier_component.h
forward_trajectory.cpp
moveit_planning_pipeline.cpp
global_planner_component.cpp
hybrid_planning_manager.cpp
cartesian_limits_aggregator.cpp
joint_limits_interface_extension.h
joint_limits_rosparam.hpp
controller_manager_plugin.cpp
Beta Was this translation helpful? Give feedback.
All reactions