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
@eborghi10
eborghi10 / ejecutable.launch
Last active May 2, 2020 19:06
Nodo de ejemplo para la clase de Robótica del año 2020 (Introducción a ROS)
<launch>
<node name="mi_nodo_utn" pkg="mi_nuevo_paquete" type="mi_nodo.py" />
<include file="$(find ca_gazebo)/launch/create_empty_world.launch"/>
</launch>
@eborghi10
eborghi10 / conversion_node.cpp
Created August 20, 2019 02:37 — forked from marcoarruda/conversion_node.cpp
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;
@eborghi10
eborghi10 / node.py
Created April 22, 2019 04:25
Example script with a control logic to move the iRobot Create 2
#!/usr/bin/env python
import rospy
from ca_msgs.msg import Bumper
from std_msgs.msg import Float32
from geometry_msgs.msg import Twist, Vector3
class MiClase():
def __init__(self):
rospy.init_node("node_name", log_level=rospy.INFO)