Skip to content

Instantly share code, notes, and snippets.

View eborghi10's full-sized avatar
🤖
Making robots! 🇦🇷

Emiliano Borghi eborghi10

🤖
Making robots! 🇦🇷
View GitHub Profile
@awesomebytes
awesomebytes / to_grayscale.py
Created April 18, 2020 04:08
Node to convert a ROS Image topic publisher from RGB to grayscale (rgb or bgr to mono8) using opencv and cv_bridge
#!/usr/bin/env python
import sys
import rospy
from sensor_msgs.msg import Image
from cv_bridge import CvBridge
import cv2
"""
Node to transform an input Image topic into
@bittner
bittner / keyboard-keys.md
Created February 28, 2019 22:50
Keyboard keys markup in MarkDown

Ctrl + Alt + Space

@cseas
cseas / points.cpp
Created February 10, 2019 06:05
Simple C++ OpenGL program to draw points on a 2D canvas
#include<GL/glut.h>
void display() {
glClear(GL_COLOR_BUFFER_BIT);
glColor3f(1.0, 0.0, 0.0);
glBegin(GL_POINTS);
glVertex2f(10.0, 10.0);
glVertex2f(150.0, 80.0);
glVertex2f(100.0, 20.0);
@gurbain
gurbain / move_square.py
Created October 15, 2018 13:16
This script allows to move and draw a square on the ground with the turtlebot in three different ways
import math
import rospy as ros
import sys
import time
from geometry_msgs.msg import Twist, Pose
from nav_msgs.msg import Odometry
from tf.transformations import euler_from_quaternion, quaternion_from_euler
@marcoarruda
marcoarruda / conversion_node.cpp
Last active December 2, 2022 15:25
ROS Quaternion to RPY
#include <tf/tf.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/Pose2D.h>
ros::Publisher pub_pose_;
void odometryCallback_(const nav_msgs::Odometry::ConstPtr msg) {
geometry_msgs::Pose2D pose2d;
pose2d.x = msg->pose.pose.position.x;
pose2d.y = msg->pose.pose.position.y;
@awesomebytes
awesomebytes / debian_from_ros_pkg.md
Last active March 6, 2024 17:51
How to create a debian from a ROS package
@dirk-thomas
dirk-thomas / CMakeLists.txt
Created July 7, 2015 20:09
CMakeLists.txt example with ament auto
cmake_minimum_required(VERSION 2.8.3)
project(foo)
if(NOT WIN32)
set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -std=c++11 -Wall")
endif()
# find dependencies