Only released in EOL distros:  

extremum_seeking: esc_approx | esc_common | esc_nn | esc_perturb | esc_ros | esc_sm | esc_test

Package Summary

Common components for ROS-based extremum seeking control

Contents

The ROS interface to the extremum seeking control algorithms uses the following topics:

  • esc_in (esc_ros/StateValue)

    • State-value input to control algorithm
  • obj_val (std_msgs/Float32)

    • Value input to control algorithm
  • vel_ref (std_msgs/Float32MultiArray)

    • Velocity reference
  • pos_ref (std_msgs/Float32MultiArray)

    • Position reference
  • monitor_out (esc_ros/Monitors)

    • Internal monitor variables

Wiki: esc_ros (last edited 2012-08-29 15:34:01 by WouterCaarls)