ts_markers_node.cpp
Go to the documentation of this file.
1 #include <ros/ros.h>
2 
4 
5 int main(int argc, char **argv)
6 {
7  ros::init(argc, argv, "ts_markers_node");
9  ros::NodeHandle private_nh("~");
10  toposens_markers::Plot p(nh, private_nh);
11  // p.publishSensorMeshes();
12  ros::spin();
13 
14  return 0;
15 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spin(Spinner &spinner)
Visualizes published TsScans as native Rviz markers. Subscribes to a topic publishing TsScans and con...
int main(int argc, char **argv)


toposens_markers
Author(s): Adi Singh, Sebastian Dengler, Christopher Lang, Roua Mokchah
autogenerated on Sun Feb 14 2021 03:20:23