Classes | Macros | Functions
steering_functions_node.cpp File Reference
#include <iostream>
#include <costmap_2d/footprint.h>
#include <geometry_msgs/PoseArray.h>
#include <nav_msgs/Path.h>
#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <visualization_msgs/MarkerArray.h>
#include <Eigen/Dense>
#include "steering_functions/dubins_state_space/dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/cc00_dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/cc00_reeds_shepp_state_space.hpp"
#include "steering_functions/hc_cc_state_space/cc0pm_dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/cc_dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/ccpm0_dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/ccpmpm_dubins_state_space.hpp"
#include "steering_functions/hc_cc_state_space/hc00_reeds_shepp_state_space.hpp"
#include "steering_functions/hc_cc_state_space/hc0pm_reeds_shepp_state_space.hpp"
#include "steering_functions/hc_cc_state_space/hc_reeds_shepp_state_space.hpp"
#include "steering_functions/hc_cc_state_space/hcpm0_reeds_shepp_state_space.hpp"
#include "steering_functions/hc_cc_state_space/hcpmpm_reeds_shepp_state_space.hpp"
#include "steering_functions/reeds_shepp_state_space/reeds_shepp_state_space.hpp"
#include "steering_functions/steering_functions.hpp"
Include dependency graph for steering_functions_node.cpp:

Go to the source code of this file.

Classes

class  PathClass
 
class  RobotClass
 

Macros

#define ANIMATE   false
 
#define DISCRETIZATION   0.1
 
#define FRAME_ID   "/world"
 
#define OPERATING_REGION_THETA   2 * M_PI
 
#define OPERATING_REGION_X   20.0
 
#define OPERATING_REGION_Y   20.0
 
#define random(lower, upper)   (rand() * (upper - lower) / RAND_MAX + lower)
 
#define VISUALIZATION_DURATION   2
 

Functions

int main (int argc, char **argv)
 

Macro Definition Documentation

◆ ANIMATE

#define ANIMATE   false

Definition at line 49 of file steering_functions_node.cpp.

◆ DISCRETIZATION

#define DISCRETIZATION   0.1

Definition at line 47 of file steering_functions_node.cpp.

◆ FRAME_ID

#define FRAME_ID   "/world"

Definition at line 46 of file steering_functions_node.cpp.

◆ OPERATING_REGION_THETA

#define OPERATING_REGION_THETA   2 * M_PI

Definition at line 52 of file steering_functions_node.cpp.

◆ OPERATING_REGION_X

#define OPERATING_REGION_X   20.0

Definition at line 50 of file steering_functions_node.cpp.

◆ OPERATING_REGION_Y

#define OPERATING_REGION_Y   20.0

Definition at line 51 of file steering_functions_node.cpp.

◆ random

#define random (   lower,
  upper 
)    (rand() * (upper - lower) / RAND_MAX + lower)

Definition at line 53 of file steering_functions_node.cpp.

◆ VISUALIZATION_DURATION

#define VISUALIZATION_DURATION   2

Definition at line 48 of file steering_functions_node.cpp.

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 524 of file steering_functions_node.cpp.



steering_functions
Author(s): Holger Banzhaf
autogenerated on Mon Dec 11 2023 03:27:44