Go to the documentation of this file.
   18 #ifndef GAZEBO_ROS_LASER_HH 
   19 #define GAZEBO_ROS_LASER_HH 
   23 #include <boost/bind.hpp> 
   24 #include <boost/thread.hpp> 
   28 #include <sensor_msgs/LaserScan.h> 
   30 #include <gazebo/physics/physics.hh> 
   31 #include <gazebo/transport/TransportTypes.hh> 
   32 #include <gazebo/msgs/MessageTypes.hh> 
   33 #include <gazebo/common/Time.hh> 
   34 #include <gazebo/common/Plugin.hh> 
   35 #include <gazebo/common/Events.hh> 
   36 #include <gazebo/sensors/SensorTypes.hh> 
   37 #include <gazebo/plugins/GpuRayPlugin.hh> 
   55     public: 
void Load(sensors::SensorPtr _parent, sdf::ElementPtr _sdf);
 
   86     private: sdf::ElementPtr 
sdf;
 
   92     private: 
void OnScan(ConstLaserScanStampedPtr &_msg);
 
  
std::string topic_name_
topic name
std::string frame_name_
frame transform name, should match link name
~GazeboRosLaser()
Destructor.
gazebo::transport::NodePtr gazebo_node_
PubMultiQueue pmq
prevents blocking
PubQueue< sensor_msgs::LaserScan >::Ptr pub_queue_
GazeboRosLaser()
Constructor.
void Load(sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
Load the plugin.
sensors::GpuRaySensorPtr parent_ray_sensor_
The parent sensor.
gazebo::transport::SubscriberPtr laser_scan_sub_
A collection of PubQueue objects, potentially of different types. This class is the programmer's inte...
ros::NodeHandle * rosnode_
pointer to ros node
std::string robot_namespace_
for setting ROS name space
std::string tf_prefix_
tf prefix
A queue of outgoing messages. Instead of calling publish() directly, you can push() messages here to ...
void OnScan(ConstLaserScanStampedPtr &_msg)
boost::thread deferred_load_thread_
int laser_connect_count_
Keep track of number of connctions.
gazebo_plugins
Author(s): John Hsu
autogenerated on Sun Mar 2 2025 03:49:12