Main MRPT website > C++ reference for MRPT 1.9.9
PlannerRRT_common.h
Go to the documentation of this file.
1 /* +------------------------------------------------------------------------+
2  | Mobile Robot Programming Toolkit (MRPT) |
3  | http://www.mrpt.org/ |
4  | |
5  | Copyright (c) 2005-2018, Individual contributors, see AUTHORS file |
6  | See: http://www.mrpt.org/Authors - All rights reserved. |
7  | Released under BSD License. See details in http://www.mrpt.org/License |
8  +------------------------------------------------------------------------+ */
9 
10 #pragma once
11 
17 #include <mrpt/graphs/TNodeID.h>
18 #include <string>
19 #include <cstdlib> // size_t
20 
21 namespace mrpt
22 {
23 namespace nav
24 {
25 /** \addtogroup nav_planners Path planning
26 * \ingroup mrpt_nav_grp
27 * @{ */
28 
29 template <typename node_pose_t, typename world_limits_t>
31 {
32  node_pose_t start_pose, goal_pose;
33  /** Bounding box of the world, used to draw uniform random pose samples */
34  world_limits_t world_bbox_min, world_bbox_max;
35  /** World obstacles, as a point cloud */
37 };
38 
39 template <typename tree_t>
41 {
42  /** Whether the target was reached or not */
43  bool success;
44  /** Time spent (in secs) */
46  /** Distance from best found path to goal */
47  double goal_distance;
48  /** Total cost of the best found path (cost ~~ Euclidean distance) */
49  double path_cost;
50  /** The ID of the best target node in the tree */
52  /** The set of target nodes within an acceptable distance to target
53  * (including `best_goal_node_id` and others) */
54  std::set<mrpt::graphs::TNodeID> acceptable_goal_node_ids;
55  /** The generated motion tree that explores free space starting at "start"
56  */
57  tree_t move_tree;
58 
60  : success(false),
62  goal_distance(std::numeric_limits<double>::max()),
63  path_cost(std::numeric_limits<double>::max()),
65  {
66  }
67 };
68 
70 {
71  /** Maximum distance from a pose to target to accept it as a valid solution
72  * (meters). (Both acceptedDistToTarget & acceptedAngToTarget must be
73  * satisfied) */
75  /** Maximum angle from a pose to target to accept it as a valid solution
76  * (rad). (Both acceptedDistToTarget & acceptedAngToTarget must be
77  * satisfied) */
79 
80  /** In seconds. 0 means no limit until a solution is found. */
82  /** In seconds. 0 means the first valid path will be returned. Otherwise,
83  * the algorithm will try to refine and find a better one. */
85 
87  : acceptedDistToTarget(0.1),
89  maxComputationTime(0.0),
91  {
92  }
93 };
94 
96 {
97  /** The robot shape used when computing collisions; it's loaded from the
98  * config file/text as a single 2xN matrix in MATLAB format, first row are
99  * Xs, second are Ys, e.g:
100  * \code
101  * robot_shape = [-0.2 0.2 0.2 -0.2; -0.1 -0.1 0.1 0.1]
102  * \endcode
103  * \note PTGs will use only one of either `robot_shape` or
104  * `robot_shape_circular_radius`
105  */
107  /** The radius of a circular-shape-model of the robot shape.
108  * \note PTGs will use only one of either `robot_shape` or
109  * `robot_shape_circular_radius`
110  */
112 
113  /** (Default: ".") */
115 
116  /** Probabily of picking the goal as random target (in [0,1], default=0.05)
117  */
118  double goalBias;
119  /** (Very sensitive parameter!) Max length of each edge path (in meters,
120  * default=1.0) */
121  double maxLength;
122  /** Minimum distance [meters] to nearest node to accept creating a new one
123  * (default=0.10). (Any of minDistanceBetweenNewNodes and
124  * minAngBetweenNewNodes must be satisfied) */
126  /** Minimum angle [rad] to nearest node to accept creating a new one
127  * (default=15 deg) (Any of minDistanceBetweenNewNodes and
128  * minAngBetweenNewNodes must be satisfied) */
130  /** Display PTG construction info (default=true) */
132 
133  /** Frequency (in iters) of saving tree state to debug log files viewable in
134  * SceneViewer3D (default=0, disabled) */
136 
138 };
139 
140 /** Virtual base class for TP-Space-based path planners */
142 {
143  public:
145  /** Parameters specific to this path solver algorithm */
147 
148  /** ctor */
150 
152  const mrpt::nav::TListPTGPtr& getPTGs() const { return m_PTGs; }
153  /** Options for renderMoveTree() */
155  {
156  /** Highlight the path from root towards this node (usually, the target)
157  */
159  /** (Default=1) Draw one out of N vehicle shapes along the highlighted
160  * path */
162 
167 
168  /** A scale factor to all XYZ corners (default=0, means auto determien
169  * from vehicle shape) */
171  /** (Default=false) */
173  /** (Default=10 meters) Set to 0 to disable */
175 
176  /** Robot color */
178  /** obstacles color */
180  /** local obstacles color */
182  /** START indication color */
184  /** END indication color */
195 
196  /** (Default=0.01) Height (Z coordinate) for the vehicle shapes. Helps
197  * making it in the "first plane" */
199  /** Robot line width for visualization - default 2.0 */
201  /** (Default=true) */
203 
207 
211  x_rand_pose(NULL),
212  x_nearest_pose(NULL),
214  new_state(NULL),
215  xyzcorners_scale(0),
218  color_vehicle(0xFF, 0x00, 0x00, 0xFF),
219  color_obstacles(0x00, 0x00, 0xFF, 0x40),
220  color_local_obstacles(0x00, 0x00, 0xFF),
221  color_start(0x00, 0x00, 0x00, 0x00),
222  color_goal(0x00, 0x00, 0x00, 0x00),
223  color_ground_xy_grid(0xFF, 0xFF, 0xFF),
224  color_normal_edge(0x22, 0x22, 0x22, 0x40),
225  color_last_edge(0xff, 0xff, 0x00),
226  color_optimal_edge(0x00, 0x00, 0x00),
227  width_last_edge(3.f),
228  width_normal_edge(1.f),
229  width_optimal_edge(4.f),
232  vehicle_shape_z(0.01),
233  vehicle_line_width(2.0),
234  draw_obstacles(true),
235  log_msg_position(0, 0, 0),
236  log_msg_scale(0.2)
237  {
238  }
239 
241  };
242 
243  template <typename node_pose_t, typename world_limits_t, typename tree_t>
244  void renderMoveTree(
247  const TPlannerResultTempl<tree_t>& result,
248  const TRenderPlannedPathOptions& options);
249 
250  protected:
254  mrpt::maps::CSimplePointsMap m_local_obs; // Temporary map. Defined as a
255  // member to save realloc time
256  // between calls
257 
258  /** Load all PTG params from a config file source */
260  const mrpt::config::CConfigFileBase& cfgSource,
261  const std::string& sSectionName = std::string("PTG_CONFIG"));
262 
263  /** Must be called after setting all params (see
264  * `internal_loadConfig_PTG()`) and before calling `solve()` */
266 
268  const mrpt::maps::CPointsMap& in_map, mrpt::maps::CPointsMap& out_map,
269  const mrpt::poses::CPose2D& asSeenFrom, const double MAX_DIST_XY);
270 
271  void spaceTransformer(
272  const mrpt::maps::CSimplePointsMap& in_obstacles,
274  const double MAX_DIST, std::vector<double>& out_TPObstacles);
275 
277  const int tp_space_k_direction,
278  const mrpt::maps::CSimplePointsMap& in_obstacles,
280  const double MAX_DIST, double& out_TPObstacle_k);
281 
282 }; // end class PlannerTPS_VirtualBase
283 /** @} */
284 }
285 }
286 
287 // Impl of renderMoveTree<>
288 #include "impl_renderMoveTree.h"
mrpt::nav::RRTAlgorithmParams::minDistanceBetweenNewNodes
double minDistanceBetweenNewNodes
Minimum distance [meters] to nearest node to accept creating a new one (default=0....
Definition: PlannerRRT_common.h:125
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::draw_shape_decimation
size_t draw_shape_decimation
(Default=1) Draw one out of N vehicle shapes along the highlighted path
Definition: PlannerRRT_common.h:161
impl_renderMoveTree.h
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::ground_xy_grid_frequency
double ground_xy_grid_frequency
(Default=10 meters) Set to 0 to disable
Definition: PlannerRRT_common.h:174
CParameterizedTrajectoryGenerator.h
mrpt::nav::TPlannerInputTempl::goal_pose
node_pose_t goal_pose
Definition: PlannerRRT_common.h:32
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::log_msg_scale
double log_msg_scale
Definition: PlannerRRT_common.h:206
mrpt::nav::PlannerTPS_VirtualBase::spaceTransformerOneDirectionOnly
void spaceTransformerOneDirectionOnly(const int tp_space_k_direction, const mrpt::maps::CSimplePointsMap &in_obstacles, const mrpt::nav::CParameterizedTrajectoryGenerator *in_PTG, const double MAX_DIST, double &out_TPObstacle_k)
Definition: PlannerRRT_common.cpp:228
mrpt::nav::TPlannerResultTempl::best_goal_node_id
mrpt::graphs::TNodeID best_goal_node_id
The ID of the best target node in the tree.
Definition: PlannerRRT_common.h:51
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_obstacles
mrpt::img::TColor color_obstacles
obstacles color
Definition: PlannerRRT_common.h:179
mrpt::system::CTimeLogger
A versatile "profiler" that logs the time spent within each pair of calls to enter(X)-leave(X),...
Definition: system/CTimeLogger.h:43
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::width_last_edge
float width_last_edge
Definition: PlannerRRT_common.h:190
mrpt::nav::TPlannerInputTempl::world_bbox_min
world_limits_t world_bbox_min
Bounding box of the world, used to draw uniform random pose samples.
Definition: PlannerRRT_common.h:34
mrpt::opengl::COpenGLScene
This class allows the user to create, load, save, and render 3D scenes using OpenGL primitives.
Definition: COpenGLScene.h:59
mrpt::nav::RRTAlgorithmParams::ptg_verbose
bool ptg_verbose
Display PTG construction info (default=true)
Definition: PlannerRRT_common.h:131
mrpt::nav::TListPTGPtr
std::vector< mrpt::nav::CParameterizedTrajectoryGenerator::Ptr > TListPTGPtr
A list of PTGs (smart pointers)
Definition: CParameterizedTrajectoryGenerator.h:500
mrpt::graphs::TNodeID
uint64_t TNodeID
A generic numeric type for unique IDs of nodes or entities.
Definition: TNodeID.h:17
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::width_normal_edge
float width_normal_edge
Definition: PlannerRRT_common.h:191
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::log_msg_position
mrpt::math::TPoint3D log_msg_position
Definition: PlannerRRT_common.h:205
mrpt::nav::TPlannerResultTempl::TPlannerResultTempl
TPlannerResultTempl()
Definition: PlannerRRT_common.h:59
mrpt::maps::CPointsMap
A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors.
Definition: CPointsMap.h:64
mrpt::nav::PlannerTPS_VirtualBase::internal_loadConfig_PTG
void internal_loadConfig_PTG(const mrpt::config::CConfigFileBase &cfgSource, const std::string &sSectionName=std::string("PTG_CONFIG"))
Load all PTG params from a config file source.
Definition: PlannerRRT_common.cpp:97
mrpt::nav::RRTEndCriteria::minComputationTime
double minComputationTime
In seconds.
Definition: PlannerRRT_common.h:84
mrpt
This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries.
Definition: CKalmanFilterCapable.h:30
mrpt::nav::RRTAlgorithmParams
Definition: PlannerRRT_common.h:95
mrpt::nav::RRTAlgorithmParams::RRTAlgorithmParams
RRTAlgorithmParams()
Definition: PlannerRRT_common.cpp:21
mrpt::nav::PlannerTPS_VirtualBase::m_timelogger
mrpt::system::CTimeLogger m_timelogger
Definition: PlannerRRT_common.h:251
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::point_size_obstacles
int point_size_obstacles
Definition: PlannerRRT_common.h:193
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::log_msg
std::string log_msg
Definition: PlannerRRT_common.h:204
mrpt::nav::RRTAlgorithmParams::goalBias
double goalBias
Probabily of picking the goal as random target (in [0,1], default=0.05)
Definition: PlannerRRT_common.h:118
mrpt::nav::PlannerTPS_VirtualBase::params
RRTAlgorithmParams params
Parameters specific to this path solver algorithm.
Definition: PlannerRRT_common.h:146
mrpt::nav::TPlannerResultTempl::goal_distance
double goal_distance
Distance from best found path to goal.
Definition: PlannerRRT_common.h:47
mrpt::nav::PlannerTPS_VirtualBase::PlannerTPS_VirtualBase
PlannerTPS_VirtualBase()
ctor
Definition: PlannerRRT_common.cpp:37
mrpt::nav::PlannerTPS_VirtualBase::spaceTransformer
void spaceTransformer(const mrpt::maps::CSimplePointsMap &in_obstacles, const mrpt::nav::CParameterizedTrajectoryGenerator *in_PTG, const double MAX_DIST, std::vector< double > &out_TPObstacles)
Definition: PlannerRRT_common.cpp:178
mrpt::nav::TPlannerResultTempl::acceptable_goal_node_ids
std::set< mrpt::graphs::TNodeID > acceptable_goal_node_ids
The set of target nodes within an acceptable distance to target (including best_goal_node_id and othe...
Definition: PlannerRRT_common.h:54
MAX_DIST
#define MAX_DIST(s)
Definition: deflate.h:285
mrpt::nav::PlannerTPS_VirtualBase::transformPointcloudWithSquareClipping
static void transformPointcloudWithSquareClipping(const mrpt::maps::CPointsMap &in_map, mrpt::maps::CPointsMap &out_map, const mrpt::poses::CPose2D &asSeenFrom, const double MAX_DIST_XY)
Definition: PlannerRRT_common.cpp:144
lightweight_geom_data.h
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::highlight_last_added_edge
bool highlight_last_added_edge
(Default=false)
Definition: PlannerRRT_common.h:172
mrpt::nav::PlannerTPS_VirtualBase::getProfiler
mrpt::system::CTimeLogger & getProfiler()
Definition: PlannerRRT_common.h:151
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::TRenderPlannedPathOptions
TRenderPlannedPathOptions()
Definition: PlannerRRT_common.h:208
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::x_rand_pose
const mrpt::poses::CPose2D * x_rand_pose
Definition: PlannerRRT_common.h:163
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_local_obstacles
mrpt::img::TColor color_local_obstacles
local obstacles color
Definition: PlannerRRT_common.h:181
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::xyzcorners_scale
double xyzcorners_scale
A scale factor to all XYZ corners (default=0, means auto determien from vehicle shape)
Definition: PlannerRRT_common.h:170
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_start
mrpt::img::TColor color_start
START indication color
Definition: PlannerRRT_common.h:183
mrpt::nav::RRTAlgorithmParams::save_3d_log_freq
size_t save_3d_log_freq
Frequency (in iters) of saving tree state to debug log files viewable in SceneViewer3D (default=0,...
Definition: PlannerRRT_common.h:135
mrpt::nav::RRTEndCriteria::RRTEndCriteria
RRTEndCriteria()
Definition: PlannerRRT_common.h:86
COpenGLScene.h
mrpt::config::CConfigFileBase
This class allows loading and storing values and vectors of different types from a configuration text...
Definition: config/CConfigFileBase.h:44
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::draw_obstacles
bool draw_obstacles
(Default=true)
Definition: PlannerRRT_common.h:202
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_goal
mrpt::img::TColor color_goal
END indication color
Definition: PlannerRRT_common.h:185
mrpt::poses::CPose2D
A class used to store a 2D pose, including the 2D coordinate point and a heading (phi) angle.
Definition: CPose2D.h:40
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::vehicle_line_width
double vehicle_line_width
Robot line width for visualization - default 2.0.
Definition: PlannerRRT_common.h:200
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::vehicle_shape_z
double vehicle_shape_z
(Default=0.01) Height (Z coordinate) for the vehicle shapes.
Definition: PlannerRRT_common.h:198
mrpt::nav::TPlannerInputTempl::start_pose
node_pose_t start_pose
Definition: PlannerRRT_common.h:32
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_ground_xy_grid
mrpt::img::TColor color_ground_xy_grid
Definition: PlannerRRT_common.h:186
mrpt::nav::TPlannerResultTempl
Definition: PlannerRRT_common.h:40
mrpt::img::TColor
A RGB color - 8bit.
Definition: TColor.h:22
mrpt::maps::CSimplePointsMap
A cloud of points in 2D or 3D, which can be built from a sequence of laser scans.
Definition: CSimplePointsMap.h:31
mrpt::nav::TPlannerResultTempl::path_cost
double path_cost
Total cost of the best found path (cost ~~ Euclidean distance)
Definition: PlannerRRT_common.h:49
mrpt::nav::PlannerTPS_VirtualBase::m_initialized_PTG
bool m_initialized_PTG
Definition: PlannerRRT_common.h:252
mrpt::nav::TPlannerInputTempl::world_bbox_max
world_limits_t world_bbox_max
Definition: PlannerRRT_common.h:34
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions
Options for renderMoveTree()
Definition: PlannerRRT_common.h:154
mrpt::nav::TPlannerResultTempl::success
bool success
Whether the target was reached or not.
Definition: PlannerRRT_common.h:43
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_vehicle
mrpt::img::TColor color_vehicle
Robot color
Definition: PlannerRRT_common.h:177
mrpt::math::TPolygon2D
2D polygon, inheriting from std::vector<TPoint2D>.
Definition: lightweight_geom_data.h:1403
mrpt::nav::RRTAlgorithmParams::robot_shape_circular_radius
double robot_shape_circular_radius
The radius of a circular-shape-model of the robot shape.
Definition: PlannerRRT_common.h:111
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::~TRenderPlannedPathOptions
virtual ~TRenderPlannedPathOptions()
Definition: PlannerRRT_common.h:240
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::highlight_path_to_node_id
mrpt::graphs::TNodeID highlight_path_to_node_id
Highlight the path from root towards this node (usually, the target)
Definition: PlannerRRT_common.h:158
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::new_state
const mrpt::poses::CPose2D * new_state
Definition: PlannerRRT_common.h:166
mrpt::nav::RRTAlgorithmParams::ptg_cache_files_directory
std::string ptg_cache_files_directory
(Default: ".")
Definition: PlannerRRT_common.h:114
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_optimal_edge
mrpt::img::TColor color_optimal_edge
Definition: PlannerRRT_common.h:189
mrpt::math::TPoint3D
Lightweight 3D point.
Definition: lightweight_geom_data.h:378
mrpt::nav::RRTEndCriteria::maxComputationTime
double maxComputationTime
In seconds.
Definition: PlannerRRT_common.h:81
mrpt::nav::TPlannerInputTempl::obstacles_points
mrpt::maps::CSimplePointsMap obstacles_points
World obstacles, as a point cloud.
Definition: PlannerRRT_common.h:36
mrpt::nav::PlannerTPS_VirtualBase::getPTGs
const mrpt::nav::TListPTGPtr & getPTGs() const
Definition: PlannerRRT_common.h:152
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::width_optimal_edge
float width_optimal_edge
Definition: PlannerRRT_common.h:192
mrpt::nav::PlannerTPS_VirtualBase::m_local_obs
mrpt::maps::CSimplePointsMap m_local_obs
Definition: PlannerRRT_common.h:254
mrpt::nav::PlannerTPS_VirtualBase::internal_initialize_PTG
void internal_initialize_PTG()
Must be called after setting all params (see internal_loadConfig_PTG()) and before calling solve()
Definition: PlannerRRT_common.cpp:38
mrpt::nav::TPlannerResultTempl::move_tree
tree_t move_tree
The generated motion tree that explores free space starting at "start".
Definition: PlannerRRT_common.h:57
mrpt::nav::RRTAlgorithmParams::minAngBetweenNewNodes
double minAngBetweenNewNodes
Minimum angle [rad] to nearest node to accept creating a new one (default=15 deg) (Any of minDistance...
Definition: PlannerRRT_common.h:129
mrpt::nav::RRTEndCriteria::acceptedDistToTarget
double acceptedDistToTarget
Maximum distance from a pose to target to accept it as a valid solution (meters).
Definition: PlannerRRT_common.h:74
CTimeLogger.h
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::point_size_local_obstacles
int point_size_local_obstacles
Definition: PlannerRRT_common.h:194
mrpt::nav::TPlannerInputTempl
Definition: PlannerRRT_common.h:30
TNodeID.h
mrpt::nav::RRTEndCriteria::acceptedAngToTarget
double acceptedAngToTarget
Maximum angle from a pose to target to accept it as a valid solution (rad).
Definition: PlannerRRT_common.h:78
mrpt::nav::TPlannerResultTempl::computation_time
double computation_time
Time spent (in secs)
Definition: PlannerRRT_common.h:45
string
GLsizei const GLchar ** string
Definition: glext.h:4101
mrpt::nav::RRTEndCriteria
Definition: PlannerRRT_common.h:69
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::x_nearest_pose
const mrpt::poses::CPose2D * x_nearest_pose
Definition: PlannerRRT_common.h:164
INVALID_NODEID
#define INVALID_NODEID
Definition: TNodeID.h:20
CSimplePointsMap.h
mrpt::nav::RRTAlgorithmParams::robot_shape
mrpt::math::TPolygon2D robot_shape
The robot shape used when computing collisions; it's loaded from the config file/text as a single 2xN...
Definition: PlannerRRT_common.h:106
mrpt::nav::PlannerTPS_VirtualBase::m_PTGs
mrpt::nav::TListPTGPtr m_PTGs
Definition: PlannerRRT_common.h:253
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::local_obs_from_nearest_pose
const mrpt::maps::CPointsMap * local_obs_from_nearest_pose
Definition: PlannerRRT_common.h:165
mrpt::nav::PlannerTPS_VirtualBase
Virtual base class for TP-Space-based path planners.
Definition: PlannerRRT_common.h:141
mrpt::nav::PlannerTPS_VirtualBase::renderMoveTree
void renderMoveTree(mrpt::opengl::COpenGLScene &scene, const TPlannerInputTempl< node_pose_t, world_limits_t > &pi, const TPlannerResultTempl< tree_t > &result, const TRenderPlannedPathOptions &options)
Definition: impl_renderMoveTree.h:25
mrpt::nav::CParameterizedTrajectoryGenerator
This is the base class for any user-defined PTG.
Definition: CParameterizedTrajectoryGenerator.h:76
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_normal_edge
mrpt::img::TColor color_normal_edge
Definition: PlannerRRT_common.h:187
mrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptions::color_last_edge
mrpt::img::TColor color_last_edge
Definition: PlannerRRT_common.h:188
mrpt::nav::RRTAlgorithmParams::maxLength
double maxLength
(Very sensitive parameter!) Max length of each edge path (in meters, default=1.0)
Definition: PlannerRRT_common.h:121
mrpt::nav::PlannerTPS_VirtualBase::end_criteria
RRTEndCriteria end_criteria
Definition: PlannerRRT_common.h:144
mrpt::DEG2RAD
double DEG2RAD(const double x)
Degrees to radians.
Definition: core/include/mrpt/core/bits_math.h:42



Page generated by Doxygen 1.8.17 for MRPT 1.9.9 Git: ad3a9d8ae Tue May 1 23:10:22 2018 -0700 at miƩ 12 jul 2023 10:03:34 CEST