Classes | |
class | OmplRvizPlanner |
SimpleSetup Planning Class. More... | |
class | OmplRvizViewer |
class | PPMImage |
struct | PPMPixel |
class | TwoDimensionalValidityChecker |
Custom State Validity Checker with cost function. More... | |
Typedefs | |
typedef boost::shared_ptr < const OmplRvizViewer > | OmplRvizViewerConstPtr |
typedef boost::shared_ptr < OmplRvizViewer > | OmplRvizViewerPtr |
Functions | |
double | getCost (const geometry_msgs::Point &point, bnu::matrix< int > &cost) |
double | getCostHeight (const geometry_msgs::Point &point, bnu::matrix< int > &cost) |
int | nat_round (double x) |
PPMImage * | readPPM (const char *filename) |
Variables | |
static const std::string | BASE_FRAME = "/world" |
typedef boost::shared_ptr<const OmplRvizViewer> ompl_rviz_viewer::OmplRvizViewerConstPtr |
Definition at line 710 of file ompl_rviz_viewer.h.
typedef boost::shared_ptr<OmplRvizViewer> ompl_rviz_viewer::OmplRvizViewerPtr |
Definition at line 709 of file ompl_rviz_viewer.h.
double ompl_rviz_viewer::getCost | ( | const geometry_msgs::Point & | point, |
bnu::matrix< int > & | cost | ||
) |
Definition at line 72 of file ompl_rviz_viewer.h.
double ompl_rviz_viewer::getCostHeight | ( | const geometry_msgs::Point & | point, |
bnu::matrix< int > & | cost | ||
) |
Definition at line 77 of file ompl_rviz_viewer.h.
int ompl_rviz_viewer::nat_round | ( | double | x | ) |
Definition at line 66 of file ompl_rviz_viewer.h.
PPMImage * ompl_rviz_viewer::readPPM | ( | const char * | filename | ) |
const std::string ompl_rviz_viewer::BASE_FRAME = "/world" [static] |
Definition at line 61 of file ompl_rviz_viewer.h.