#include <twist_mux/twist_mux.h>
#include <twist_mux/topic_handle.h>
#include <twist_mux/twist_mux_diagnostics.h>
#include <twist_mux/twist_mux_diagnostics_status.h>
#include <twist_mux/utils.h>
#include <twist_mux/xmlrpc_helpers.h>
Go to the source code of this file.
Namespaces | |
namespace | twist_mux |
Functions | |
bool | hasIncreasedAbsVelocity (const geometry_msgs::Twist &old_twist, const geometry_msgs::Twist &new_twist) |
hasIncreasedAbsVelocity Check if the absolute velocity has increased in any of the components: linear (abs(x)) or angular (abs(yaw)) |
bool hasIncreasedAbsVelocity | ( | const geometry_msgs::Twist & | old_twist, |
const geometry_msgs::Twist & | new_twist | ||
) |
hasIncreasedAbsVelocity Check if the absolute velocity has increased in any of the components: linear (abs(x)) or angular (abs(yaw))
old_twist | Old velocity |
new_twist | New velocity |
Definition at line 36 of file twist_mux.cpp.