ros_plugin_demo
Demonstration of the ROS PlugInLib
 All Data Structures Namespaces Files Functions Variables Pages
Public Member Functions | Private Member Functions
plugin_demo_plugins_namespace::Direct Class Reference

This class create a direct link between the start and target pose. More...

#include <direct.hpp>

Inheritance diagram for plugin_demo_plugins_namespace::Direct:
plugin_demo_interface_namespace::PathPlanner

Public Member Functions

 Direct ()
 Intentionally left empty.
 
virtual ~Direct ()
 Intentionally left empty.
 
- Public Member Functions inherited from plugin_demo_interface_namespace::PathPlanner
void initialize (ros::NodeHandle roshandle)
 Initalize the global variables. More...
 
double getYawFromQuat (geometry_msgs::Quaternion quat)
 convert a quaternion into yaw More...
 
void tfFrameFromPoseStamped (geometry_msgs::PoseStamped *pose, tf::Transform *tf_tf)
 build a tf-frame for a given pose More...
 
int setPoints (geometry_msgs::Pose2D *start, geometry_msgs::Pose2D *target)
 replace the current start and target poses and call getPath() More...
 
int getPoints (geometry_msgs::Pose2D *start, geometry_msgs::Pose2D *target)
 returns the current start and target poses More...
 
virtual ~PathPlanner ()
 Intentionally left empty.
 

Private Member Functions

int getPath ()
 "calculate" the path. More...
 
int onInit (ros::NodeHandle roshandle)
 writes only a info-msg. More...
 

Additional Inherited Members

- Protected Member Functions inherited from plugin_demo_interface_namespace::PathPlanner
 PathPlanner ()
 initialize init
 
void setPose2d (geometry_msgs::PoseStamped *pose3d, double x, double y, double theta)
 convert a given 2D-Pose into 3D-Stamped-Pose. More...
 
- Protected Attributes inherited from plugin_demo_interface_namespace::PathPlanner
bool init
 true if initialized. More...
 
geometry_msgs::PoseStamped start
 starting pose of the path
 
geometry_msgs::PoseStamped target
 last pose of the path
 
nav_msgs::Path current_path
 contain the path
 

Detailed Description

This class create a direct link between the start and target pose.

The resulting path only contain these two points.

Definition at line 18 of file direct.hpp.

Member Function Documentation

int plugin_demo_plugins_namespace::Direct::getPath ( )
privatevirtual

"calculate" the path.

Returns
error code

Implements plugin_demo_interface_namespace::PathPlanner.

Definition at line 18 of file direct.cpp.

19  {
20  current_path.poses.push_back(start);
21  current_path.poses.push_back(target);
22  ROS_INFO("[plugin direct] here comes the path");
23  }
geometry_msgs::PoseStamped target
last pose of the path
nav_msgs::Path current_path
contain the path
geometry_msgs::PoseStamped start
starting pose of the path
int plugin_demo_plugins_namespace::Direct::onInit ( ros::NodeHandle  roshandle)
privatevirtual

writes only a info-msg.

Parameters
roshandlea valid ROS NodeHandle
Returns
error code

Reimplemented from plugin_demo_interface_namespace::PathPlanner.

Definition at line 13 of file direct.cpp.

14  {
15  ROS_INFO("[plugin direct] done init.");
16  }

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