Namespaces | Defines
velocity_smoother.cpp File Reference
#include <ros/ros.h>
#include <dynamic_reconfigure/server.h>
#include <cob_base_velocity_smoother/velocity_smoother.h>
#include <boost/thread.hpp>
Include dependency graph for velocity_smoother.cpp:

Go to the source code of this file.

Namespaces

namespace  cob_base_velocity_smoother

Defines

#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 Documentation

#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.



cob_base_velocity_smoother
Author(s): Florian Mirus , Benjamin Maidel
autogenerated on Thu Jun 6 2019 21:18:55