Functions | Variables
mcl_3dl_compat Namespace Reference

Functions

template<class M >
ros::Publisher advertise (ros::NodeHandle &nh_new, const std::string &topic_new, ros::NodeHandle &nh_old, const std::string &topic_old, uint32_t queue_size, bool latch=false)
template<class T , class MReq , class MRes >
ros::ServiceServer advertiseService (ros::NodeHandle &nh_new, const std::string &service_new, ros::NodeHandle &nh_old, const std::string &service_old, bool(T::*srv_func)(MReq &, MRes &), T *obj)
void checkCompatMode ()
int getCompat ()
std::string getSimplifiedNamespace (ros::NodeHandle &nh)
template<typename T >
void paramRename (ros::NodeHandle &nh, const std::string &param_name_new, const std::string &param_name_old)
 STATIC_ASSERT (supported_level<=current_level &&current_level<=supported_level+1)
 STATIC_ASSERT (supported_level<=default_level &&default_level<=current_level)
template<class M , class T >
ros::Subscriber subscribe (ros::NodeHandle &nh_new, const std::string &topic_new, ros::NodeHandle &nh_old, const std::string &topic_old, uint32_t queue_size, void(T::*fp)(M) const, T *obj, const ros::TransportHints &transport_hints=ros::TransportHints())

Variables

const int current_level = 1
const int default_level = supported_level
const int supported_level = 0

Function Documentation

template<class M >
ros::Publisher mcl_3dl_compat::advertise ( ros::NodeHandle nh_new,
const std::string &  topic_new,
ros::NodeHandle nh_old,
const std::string &  topic_old,
uint32_t  queue_size,
bool  latch = false 
)

Definition at line 150 of file compatibility.h.

template<class T , class MReq , class MRes >
ros::ServiceServer mcl_3dl_compat::advertiseService ( ros::NodeHandle nh_new,
const std::string &  service_new,
ros::NodeHandle nh_old,
const std::string &  service_old,
bool(T::*)(MReq &, MRes &)  srv_func,
T obj 
)

Definition at line 174 of file compatibility.h.

Definition at line 60 of file compatibility.h.

Definition at line 53 of file compatibility.h.

Definition at line 89 of file compatibility.h.

template<typename T >
void mcl_3dl_compat::paramRename ( ros::NodeHandle nh,
const std::string &  param_name_new,
const std::string &  param_name_old 
)

Definition at line 199 of file compatibility.h.

mcl_3dl_compat::STATIC_ASSERT ( supported_level<=current_level &&current_level<=supported_level+  1)
mcl_3dl_compat::STATIC_ASSERT ( supported_level<=default_level &&default_level<=  current_level)
template<class M , class T >
ros::Subscriber mcl_3dl_compat::subscribe ( ros::NodeHandle nh_new,
const std::string &  topic_new,
ros::NodeHandle nh_old,
const std::string &  topic_old,
uint32_t  queue_size,
void(T::*)(M) const  fp,
T obj,
const ros::TransportHints transport_hints = ros::TransportHints() 
)

Definition at line 98 of file compatibility.h.


Variable Documentation

Definition at line 46 of file compatibility.h.

Definition at line 48 of file compatibility.h.

Definition at line 47 of file compatibility.h.



mcl_3dl
Author(s): Atsushi Watanabe
autogenerated on Thu Jun 20 2019 20:04:43