sick_ldmrs_node.h
Go to the documentation of this file.
1 #include "sick_scan/sick_scan_base.h" /* Base definitions included in all header files, added by add_sick_scan_base_header.py. Do not edit this line. */
2 /*
3 ** @brief ros node to integrate LDMRS driver into sick_scan
4 */
5 #ifndef __SICK_SCAN_LDMRS_NODE_INCLUDED
6 #define __SICK_SCAN_LDMRS_NODE_INCLUDED
7 
8 #if defined LDMRS_SUPPORT && LDMRS_SUPPORT > 0
9 
11 
13 #include <sick_ldmrs/devices/LD_MRS.hpp>
15 
16 namespace sick_scan_xd
17 {
18  class SickLdmrsNode
19  {
20  public:
21  SickLdmrsNode();
22  ~SickLdmrsNode();
23 
24  virtual int init(rosNodePtr node, const std::string & hostName = "192.168.0.1", const std::string & frameId = "cloud");
25 
26  virtual int run();
27 
28  protected:
29 
30  rosNodePtr m_nh;
31  std::shared_ptr<diagnostic_updater::Updater> m_diagnostics;
32  Manager* m_manager;
34  devices::LDMRS* m_ldmrs;
35  };
36 
37 } // namespace sick_scan_xd
38 
39 #endif // LDMRS_SUPPORT && LDMRS_SUPPORT > 0
40 #endif // __SICK_SCAN_LDMRS_NODE_INCLUDED
roswrap::message_traits::frameId
std::string * frameId(M &m)
returns FrameId<M>::pointer(m);
Definition: message_traits.h:299
sick_scan_xd
Definition: abstract_parser.cpp:65
sick_scan_common.h
sick_ros_wrapper.h
roswrap::param::init
void init(const M_string &remappings)
Definition: param_modi.cpp:809
polar_to_cartesian_pointcloud_ros1.node
node
Definition: polar_to_cartesian_pointcloud_ros1.py:81
sick_ldmrs_driver.hpp
ros::NodeHandle
sick_scan_base.h
sick_ldmrs_driver::SickLDMRS
Definition: sick_ldmrs_driver.hpp:101
sick_scansegment_xd::run
int run(rosNodePtr node, const std::string &scannerName)
Definition: scansegment_threads.cpp:74


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:10