#include <route_segment.h>
|
| 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 |
| |
Definition at line 104 of file route_segment.h.
◆ RouteSegment()
| RouteSegment::RouteSegment |
( |
| ) |
|
◆ sample_equal_angle()
| double RouteSegment::sample_equal_angle |
( |
std::vector< geometry_msgs::PosePtr > & |
poses, |
|
|
double |
angle, |
|
|
double |
distance_offset |
|
) |
| const |
◆ sample_equal_distance()
| double RouteSegment::sample_equal_distance |
( |
std::vector< geometry_msgs::PosePtr > & |
poses, |
|
|
double |
distance, |
|
|
double |
distance_offset |
|
) |
| const |
◆ ARC
| const unsigned int tuw::ros_msgs::RouteSegment::ARC = 2 |
|
static |
◆ CLOCKWISE
| const unsigned int tuw::ros_msgs::RouteSegment::CLOCKWISE = 0 |
|
static |
◆ COUNTER_CLOCKWISE
| const unsigned int tuw::ros_msgs::RouteSegment::COUNTER_CLOCKWISE = 1 |
|
static |
◆ LINE
| const unsigned int tuw::ros_msgs::RouteSegment::LINE = 1 |
|
static |
◆ NA
| const unsigned int tuw::ros_msgs::RouteSegment::NA = 0 |
|
static |
◆ SPIROS
| const unsigned int tuw::ros_msgs::RouteSegment::SPIROS = 3 |
|
static |
◆ SPLINE
| const unsigned int tuw::ros_msgs::RouteSegment::SPLINE = 4 |
|
static |
The documentation for this class was generated from the following files: