Skip to content

Instantly share code, notes, and snippets.

View timeamagyar's full-sized avatar

Timea Magyar timeamagyar

  • Frankfurt am Main
View GitHub Profile
package com.example.demo;
import org.apache.kafka.clients.consumer.ConsumerRecord;
import org.apache.kafka.clients.producer.Producer;
import org.apache.kafka.clients.producer.ProducerRecord;
import org.apache.kafka.common.serialization.StringDeserializer;
import org.apache.kafka.common.serialization.StringSerializer;
import org.junit.jupiter.api.AfterAll;
import org.junit.jupiter.api.BeforeAll;
import org.junit.jupiter.api.Test;
@timeamagyar
timeamagyar / create_cloud_xyzrgb.py
Created April 4, 2020 21:15 — forked from lucasw/create_cloud_xyzrgb.py
Create PointCloud2 with python with rgb
#!/usr/bin/env python
# PointCloud2 color cube
# https://answers.ros.org/question/289576/understanding-the-bytes-in-a-pcl2-message/
import rospy
import struct
from sensor_msgs import point_cloud2
from sensor_msgs.msg import PointCloud2, PointField
from std_msgs.msg import Header
@timeamagyar
timeamagyar / raw_record.cpp
Created December 10, 2019 21:43 — forked from anug7/raw_record.cpp
Realsense ROS Node to record bag file as per realsense viewer format.
#include "ros/ros.h"
#include <sensor_msgs/image_encodings.h>
#include <sensor_msgs/Image.h>
#include <boost/algorithm/string/predicate.hpp>
#include <boost/date_time/posix_time/posix_time.hpp>
#include <boost/thread/thread.hpp>
#include <boost/thread/recursive_mutex.hpp>