#include <ros/ros.h>#include <dynamic_reconfigure/server.h>#include <cob_base_velocity_smoother/velocity_smoother.h>#include <boost/thread.hpp>
Go to the source code of this file.
Namespaces | |
| cob_base_velocity_smoother | |
Macros | |
| #define | IS_ZERO_VEOCITY(a) ((a.linear.x == 0.0) && (a.linear.y == 0.0) && (a.angular.z == 0.0)) |
| #define | PERIOD_RECORD_SIZE 5 |
| #define | ZERO_VEL_COMMAND geometry_msgs::Twist(); |
| #define IS_ZERO_VEOCITY | ( | a | ) | ((a.linear.x == 0.0) && (a.linear.y == 0.0) && (a.angular.z == 0.0)) |
Definition at line 34 of file velocity_smoother.cpp.
| #define PERIOD_RECORD_SIZE 5 |
Definition at line 32 of file velocity_smoother.cpp.
| #define ZERO_VEL_COMMAND geometry_msgs::Twist(); |
Definition at line 33 of file velocity_smoother.cpp.