ros2_controllers icon indicating copy to clipboard operation
ros2_controllers copied to clipboard

Generic robotic controllers to accompany ros2_control

Results 259 ros2_controllers issues
Sort by recently updated
recently updated
newest added

> we should have `period` available in the `update` method _Originally posted by @destogl in https://github.com/ros-controls/ros2_controllers/pull/260#discussion_r752228051_

help wanted
good first issue
good second issue

Current name “velocity” is confusing and ambiguous. > I am actually proposing to rename the "velocity" to "command" or something like this. _Originally posted by @destogl in https://github.com/ros-controls/ros2_controllers/pull/260#discussion_r752227043_

help wanted
good first issue

Issue #242 revealed a bug with the diff_drive_controller's velocity/acceleration/jerk limit code. Although a PR has been made to fix this, a test should be created to prevent this in future.

help wanted

Our integration tests currently have a recurring pattern where the robot hardware read/update/write steps are repeated a couple of times in a loop until a condition is met. An occurence...

good first issue

# Problem: std_msgs/Float64MultiArray is deprecated. ``` # This was originally provided as an example message. # It is deprecated as of Foxy # It is recommended to create your own...

This confused me because I'm trying to track down dependencies. There is a `position_controllers` package but it does not contain the `GripperActionController`, instead that is inside the `gripper_controllers` package but...

https://github.com/ros-controls/ros_controllers/tree/melodic-devel/rqt_joint_trajectory_controller

Should `last_commanded_state_` here be reduced to existing state interface from the hardware? Or is it OK to internally manage more control-states then can be received from hardware? _Originally posted by...

In gazebo, with varying friction parameters et.c., I can't for the life of me get a consistent behavior of the configuration of the diff_drive_controller. In fact, I struggle to get...

In the current implementation, there is no possibility to wraparound joint angles. Add this functionality from ROS1 version of the controller. Start at [this line](https://github.com/ros-controls/ros_controllers/blob/a075bc36ebf5b81a7dafe911907cc1b781dd0185/joint_trajectory_controller/include/joint_trajectory_controller/joint_trajectory_controller_impl.h#L269).