Namespaces | Macros | Functions | Variables
gpp_plugin.cpp File Reference
#include <gpp_plugin/gpp_plugin.hpp>
#include <mbf_msgs/GetPathResult.h>
#include <pluginlib/class_list_macros.h>
#include <xmlrpcpp/XmlRpcException.h>
#include <xmlrpcpp/XmlRpcValue.h>
#include <stdexcept>
#include <utility>
Include dependency graph for gpp_plugin.cpp:

Go to the source code of this file.

Namespaces

 gpp_plugin
 

Macros

#define GPP_DEBUG(_msg)   ROS_DEBUG_STREAM(gpp_name__ << _msg)
 
#define GPP_ERROR(_msg)   ROS_ERROR_STREAM(gpp_name__ << _msg)
 
#define GPP_FATAL(_msg)   ROS_FATAL_STREAM(gpp_name__ << _msg)
 
#define GPP_INFO(_msg)   ROS_INFO_STREAM(gpp_name__ << _msg)
 
#define GPP_WARN(_msg)   ROS_WARN_STREAM(gpp_name__ << _msg)
 

Functions

void gpp_plugin::_default_deleter (BaseGlobalPlanner *impl)
 
template<typename _T >
_T gpp_plugin::_getElement (const XmlRpc::XmlRpcValue &_v, const std::string &_tag, const _T &_default) noexcept
 helper to get any value from _v under _tag. If anything goes wrong, the function will fall-back to the _default value. More...
 
std::string gpp_plugin::_getStringElement (const XmlRpc::XmlRpcValue &_v, const std::string &_tag)
 helper to get a string element with the tag _tag from _v More...
 
template<typename _Plugin >
void gpp_plugin::_initGroup (const std::string &_name, costmap_2d::Costmap2DROS *_costmap, ros::NodeHandle &_nh, ArrayPluginManager< _Plugin > &_group)
 
 PLUGINLIB_EXPORT_CLASS (gpp_plugin::GppPlugin, mbf_costmap_core::CostmapPlanner)
 
 PLUGINLIB_EXPORT_CLASS (gpp_plugin::GppPlugin, nav_core::BaseGlobalPlanner)
 

Variables

constexpr char gpp_plugin::gpp_name__ [] = "[gpp]: "
 
constexpr uint32_t gpp_plugin::MBF_FAILURE = mbf_msgs::GetPathResult::FAILURE
 
constexpr uint32_t gpp_plugin::MBF_SUCCESS = mbf_msgs::GetPathResult::SUCCESS
 

Macro Definition Documentation

◆ GPP_DEBUG

#define GPP_DEBUG (   _msg)    ROS_DEBUG_STREAM(gpp_name__ << _msg)

Definition at line 41 of file gpp_plugin.cpp.

◆ GPP_ERROR

#define GPP_ERROR (   _msg)    ROS_ERROR_STREAM(gpp_name__ << _msg)

Definition at line 44 of file gpp_plugin.cpp.

◆ GPP_FATAL

#define GPP_FATAL (   _msg)    ROS_FATAL_STREAM(gpp_name__ << _msg)

Definition at line 45 of file gpp_plugin.cpp.

◆ GPP_INFO

#define GPP_INFO (   _msg)    ROS_INFO_STREAM(gpp_name__ << _msg)

Definition at line 42 of file gpp_plugin.cpp.

◆ GPP_WARN

#define GPP_WARN (   _msg)    ROS_WARN_STREAM(gpp_name__ << _msg)

Definition at line 43 of file gpp_plugin.cpp.

Function Documentation

◆ PLUGINLIB_EXPORT_CLASS() [1/2]

PLUGINLIB_EXPORT_CLASS ( gpp_plugin::GppPlugin  ,
mbf_costmap_core::CostmapPlanner   
)

◆ PLUGINLIB_EXPORT_CLASS() [2/2]

PLUGINLIB_EXPORT_CLASS ( gpp_plugin::GppPlugin  ,
nav_core::BaseGlobalPlanner   
)


gpp_plugin
Author(s):
autogenerated on Wed Mar 2 2022 00:21:23