Public Member Functions | Private Attributes | List of all members
novatel_oem7_driver::Oem7RosPublisher Class Reference

#include <oem7_ros_publisher.hpp>

Public Member Functions

bool isEnabled ()
 
template<typename M >
void publish (boost::shared_ptr< M > &msg)
 
template<typename M >
void setup (const std::string &name, ros::NodeHandle &nh)
 

Private Attributes

std::string frame_id_
 Configurable frame ID. More...
 
ros::Publisher ros_pub_
 ROS publisher. More...
 

Detailed Description

Encapsulates ROS message publisher, configured and enabled based on ROS parameters.

Definition at line 38 of file oem7_ros_publisher.hpp.

Member Function Documentation

bool novatel_oem7_driver::Oem7RosPublisher::isEnabled ( )
inline
Returns
true if the publisher is enabled

Definition at line 83 of file oem7_ros_publisher.hpp.

template<typename M >
void novatel_oem7_driver::Oem7RosPublisher::publish ( boost::shared_ptr< M > &  msg)
inline

Publish a message on this publisher. The message is ignored when the publisher is disabled.

Definition at line 92 of file oem7_ros_publisher.hpp.

template<typename M >
void novatel_oem7_driver::Oem7RosPublisher::setup ( const std::string &  name,
ros::NodeHandle nh 
)
inline

Definition at line 47 of file oem7_ros_publisher.hpp.

Member Data Documentation

std::string novatel_oem7_driver::Oem7RosPublisher::frame_id_
private

Configurable frame ID.

Definition at line 42 of file oem7_ros_publisher.hpp.

ros::Publisher novatel_oem7_driver::Oem7RosPublisher::ros_pub_
private

ROS publisher.

Definition at line 40 of file oem7_ros_publisher.hpp.


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


novatel_oem7_driver
Author(s):
autogenerated on Tue Mar 9 2021 03:48:00