Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
chomp_interface::CHOMPInterface Class Reference

#include <chomp_interface.h>

Inheritance diagram for chomp_interface::CHOMPInterface:
Inheritance graph
[legend]

Public Member Functions

 CHOMPInterface (const ros::NodeHandle &nh=ros::NodeHandle("~"))
 
const chomp::ChompParametersgetParams () const
 
- Public Member Functions inherited from chomp::ChompPlanner
 ChompPlanner ()
 
bool solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::MotionPlanRequest &req, const ChompParameters &params, moveit_msgs::MotionPlanDetailedResponse &res) const
 
virtual ~ChompPlanner ()
 

Protected Member Functions

void loadParams ()
 Configure everything using the param server. More...
 

Protected Attributes

ros::NodeHandle nh_
 
chomp::ChompParameters params_
 The ROS node handle. More...
 

Detailed Description

Definition at line 48 of file chomp_interface.h.

Constructor & Destructor Documentation

chomp_interface::CHOMPInterface::CHOMPInterface ( const ros::NodeHandle nh = ros::NodeHandle("~"))

Definition at line 41 of file chomp_interface.cpp.

Member Function Documentation

const chomp::ChompParameters& chomp_interface::CHOMPInterface::getParams ( ) const
inline

Definition at line 53 of file chomp_interface.h.

void chomp_interface::CHOMPInterface::loadParams ( )
protected

Configure everything using the param server.

Definition at line 46 of file chomp_interface.cpp.

Member Data Documentation

ros::NodeHandle chomp_interface::CHOMPInterface::nh_
protected

Definition at line 62 of file chomp_interface.h.

chomp::ChompParameters chomp_interface::CHOMPInterface::params_
protected

The ROS node handle.

Definition at line 64 of file chomp_interface.h.


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


chomp_interface
Author(s): Gil Jones
autogenerated on Sun Oct 18 2020 13:18:59