Public Member Functions | Static Public Attributes | List of all members
tuw::ros_msgs::RouteSegment Class Reference

#include <route_segment.h>

Inheritance diagram for tuw::ros_msgs::RouteSegment:
Inheritance graph
[legend]

Public Member Functions

 RouteSegment ()
 
double sample_equal_angle (std::vector< geometry_msgs::PosePtr > &poses, double angle, double distance_offset) const
 
double sample_equal_distance (std::vector< geometry_msgs::PosePtr > &poses, double distance, double distance_offset) const
 

Static Public Attributes

static const unsigned int ARC = 2
 
static const unsigned int CLOCKWISE = 0
 
static const unsigned int COUNTER_CLOCKWISE = 1
 
static const unsigned int LINE = 1
 
static const unsigned int NA = 0
 
static const unsigned int SPIROS = 3
 
static const unsigned int SPLINE = 4
 

Detailed Description

Definition at line 44 of file route_segment.h.

Constructor & Destructor Documentation

RouteSegment::RouteSegment ( )

Definition at line 38 of file route_segment.cpp.

Member Function Documentation

double RouteSegment::sample_equal_angle ( std::vector< geometry_msgs::PosePtr > &  poses,
double  angle,
double  distance_offset 
) const

Definition at line 105 of file route_segment.cpp.

double RouteSegment::sample_equal_distance ( std::vector< geometry_msgs::PosePtr > &  poses,
double  distance,
double  distance_offset 
) const

signed minimal delta angle difference

Definition at line 42 of file route_segment.cpp.

Member Data Documentation

const unsigned int tuw::ros_msgs::RouteSegment::ARC = 2
static

Definition at line 50 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::CLOCKWISE = 0
static

Definition at line 53 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::COUNTER_CLOCKWISE = 1
static

Definition at line 54 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::LINE = 1
static

Definition at line 49 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::NA = 0
static

Definition at line 48 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::SPIROS = 3
static

Definition at line 51 of file route_segment.h.

const unsigned int tuw::ros_msgs::RouteSegment::SPLINE = 4
static

Definition at line 52 of file route_segment.h.


The documentation for this class was generated from the following files:


tuw_nav_msgs
Author(s): Markus Bader
autogenerated on Mon Jun 10 2019 15:37:22