Functions | |
| def | init |
| def | myCallback |
| def | subscribe_once |
| def listener(): rospy.init_node('my_listener', anonymous=True) rospy.Subscriber("tilt_laser_cloud", PointCloud, cloudCallback) rospy.spin() | |
Variables | |
| tuple | data = subscribe_once(TOPIC_NAME, PointCloud) |
| global_ros_data = None | |
| list | pt = data.points[i] |
| string | TOPIC_NAME = "tilt_laser_cloud" |
| def get_camera.init | ( | ) |
Definition at line 51 of file get_camera.py.
| def get_camera.myCallback | ( | data | ) |
Definition at line 54 of file get_camera.py.
| def get_camera.subscribe_once | ( | topic_name = TOPIC_NAME, |
|
msg_type = PointCloud |
|||
| ) |
def listener(): rospy.init_node('my_listener', anonymous=True) rospy.Subscriber("tilt_laser_cloud", PointCloud, cloudCallback) rospy.spin()
Definition at line 64 of file get_camera.py.
| tuple get_camera::data = subscribe_once(TOPIC_NAME, PointCloud) |
Definition at line 78 of file get_camera.py.
Definition at line 43 of file get_camera.py.
Definition at line 83 of file get_camera.py.
| string get_camera::TOPIC_NAME = "tilt_laser_cloud" |
Definition at line 42 of file get_camera.py.