ros_controllers icon indicating copy to clipboard operation
ros_controllers copied to clipboard

Generic robotic controllers to accompany ros_control

Results 111 ros_controllers issues
Sort by recently updated
recently updated
newest added

Hi, I am using the `effort_controllers/JointVelocityController` to drive a 6 wheel in simulation. Torque is very important for the simulated response of the robot. I have 2 motors driving a...

Hey Guys, i'm trying to use the joint_trajectory_controller. Moving the Robot with Trajectories works really fine. But when i send a new Traj before the old one finished the robot...

When looking at the documentation [here](http://wiki.ros.org/ackermann_steering_controller#Controller_configuration_examples), the configuration examples show as follow: Minimal description: `mobile_base_controller: type: "steer_drive_controller/SteerDriveController"` Complete description: `mobile_base_controller: type : "diff_drive_controller/DiffDriveController"`

According to the [sensor_msgs/JointState](http://docs.ros.org/api/sensor_msgs/html/msg/JointState.html) documentation, the `position`, `velocity` and `effort` lists should only be populated if the joint(s) support reporting that quantity: > The goal is to make each of...

There is a package containing message types for ackermann drive commands: http://wiki.ros.org/ackermann_msgs It would be nice if the ackermann_steering_controller would support drive commands of this message type.

@mintar I have tested your `mimic_joint_gazebo_tutorial` and it works fine for the small example, but when I tried to apply that plugins to a more complex model, for example, humanoid...

As discussed in #184 this patch introduces a base class for ForwardJointGroupCommandController that allows subclassing for various ROS interface types. - added virtual specifiers to outline the (implicitly) virtual member...

I am trying to simulate two kuka youbots in gazebo7 using ROS Kinetic. I am attempting to use the "steered_wheel_base_controller" for both youbots bases, but I am running into a...

Hello, I'm observing trajectory planned by moveit! into gazebo for PANDA arm. I'm using position_controllers/JointTrajectoryControllers on gazebo (ros_control) side and followjointtrajectory action on moveit side. I'm using ROS Kinetic and...

if we want to connect hardware_interface and joint_trajectory_controller, we can customize hardware_interface_adapter template class. ``` template class HardwareInterfaceAdapter { public: bool init(std::vector& /*joint_handles*/, ros::NodeHandle& /*controller_nh*/) { return false; } void...