Functions | Variables
twist_gen.cpp File Reference
#include <gtest/gtest.h>
#include <dwb_plugins/standard_traj_generator.h>
#include <dwb_plugins/limited_accel_generator.h>
#include <nav_core2/exceptions.h>
#include <vector>
#include <algorithm>
Include dependency graph for twist_gen.cpp:

Go to the source code of this file.

Functions

void checkLimits (const std::vector< nav_2d_msgs::Twist2D > &twists, double exp_min_x, double exp_max_x, double exp_min_y, double exp_max_y, double exp_min_theta, double exp_max_theta, double exp_max_xy=-1.0, double exp_min_xy=-1.0, double exp_min_speed_theta=-1.0)
 
int main (int argc, char **argv)
 
void matchPose (const geometry_msgs::Pose2D &a, const geometry_msgs::Pose2D &b)
 
void matchPose (const geometry_msgs::Pose2D &a, const double x, const double y, const double theta)
 
void matchTwist (const nav_2d_msgs::Twist2D &a, const nav_2d_msgs::Twist2D &b)
 
void matchTwist (const nav_2d_msgs::Twist2D &a, const double x, const double y, const double theta)
 
 TEST (VelocityIterator, standard_gen)
 
 TEST (VelocityIterator, max_xy)
 
 TEST (VelocityIterator, min_xy)
 
 TEST (VelocityIterator, min_theta)
 
 TEST (VelocityIterator, no_limits)
 
 TEST (VelocityIterator, no_limits_samples)
 
 TEST (VelocityIterator, dwa_gen_exception)
 
 TEST (VelocityIterator, no_dwa_gen_exception)
 
 TEST (VelocityIterator, dwa_gen)
 
 TEST (VelocityIterator, dwa_gen_no_param)
 
 TEST (VelocityIterator, nonzero)
 
 TEST (TrajectoryGenerator, basic)
 
 TEST (TrajectoryGenerator, basic_no_last_point)
 
 TEST (TrajectoryGenerator, too_slow)
 
 TEST (TrajectoryGenerator, holonomic)
 
 TEST (TrajectoryGenerator, twisty)
 
 TEST (TrajectoryGenerator, sim_time)
 
 TEST (TrajectoryGenerator, accel)
 
 TEST (TrajectoryGenerator, dwa)
 

Variables

const double DEFAULT_SIM_TIME = 1.7
 
nav_2d_msgs::Twist2D forward
 
geometry_msgs::Pose2D origin
 
nav_2d_msgs::Twist2D zero
 

Function Documentation

void checkLimits ( const std::vector< nav_2d_msgs::Twist2D > &  twists,
double  exp_min_x,
double  exp_max_x,
double  exp_min_y,
double  exp_max_y,
double  exp_min_theta,
double  exp_max_theta,
double  exp_max_xy = -1.0,
double  exp_min_xy = -1.0,
double  exp_min_speed_theta = -1.0 
)

Definition at line 47 of file twist_gen.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 416 of file twist_gen.cpp.

void matchPose ( const geometry_msgs::Pose2D &  a,
const geometry_msgs::Pose2D &  b 
)

Definition at line 223 of file twist_gen.cpp.

void matchPose ( const geometry_msgs::Pose2D &  a,
const double  x,
const double  y,
const double  theta 
)

Definition at line 230 of file twist_gen.cpp.

void matchTwist ( const nav_2d_msgs::Twist2D &  a,
const nav_2d_msgs::Twist2D &  b 
)

Definition at line 237 of file twist_gen.cpp.

void matchTwist ( const nav_2d_msgs::Twist2D &  a,
const double  x,
const double  y,
const double  theta 
)

Definition at line 244 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
standard_gen   
)

Definition at line 88 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
max_xy   
)

Definition at line 98 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
min_xy   
)

Definition at line 111 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
min_theta   
)

Definition at line 123 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
no_limits   
)

Definition at line 135 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
no_limits_samples   
)

Definition at line 149 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
dwa_gen_exception   
)

Definition at line 166 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
no_dwa_gen_exception   
)

Definition at line 174 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
dwa_gen   
)

Definition at line 182 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
dwa_gen_no_param   
)

Definition at line 195 of file twist_gen.cpp.

TEST ( VelocityIterator  ,
nonzero   
)

Definition at line 206 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
basic   
)

Definition at line 253 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
basic_no_last_point   
)

Definition at line 270 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
too_slow   
)

Definition at line 288 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
holonomic   
)

Definition at line 306 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
twisty   
)

Definition at line 326 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
sim_time   
)

Definition at line 349 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
accel   
)

Definition at line 368 of file twist_gen.cpp.

TEST ( TrajectoryGenerator  ,
dwa   
)

Definition at line 391 of file twist_gen.cpp.

Variable Documentation

const double DEFAULT_SIM_TIME = 1.7

Definition at line 251 of file twist_gen.cpp.

nav_2d_msgs::Twist2D forward

Definition at line 45 of file twist_gen.cpp.

geometry_msgs::Pose2D origin

Definition at line 43 of file twist_gen.cpp.

nav_2d_msgs::Twist2D zero

Definition at line 44 of file twist_gen.cpp.



dwb_plugins
Author(s):
autogenerated on Sun Jan 10 2021 04:08:37