The instructions are based on this answers.ros.org thread.
You may need the latest pip, follow the official instructions.
Install bloom:
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 |
The instructions are based on this answers.ros.org thread.
You may need the latest pip, follow the official instructions.
Install bloom:
#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; |
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 |
// bitset_iter.h v1.1.0 | |
// Copyright 2019, Diego Dagum | |
// | |
// Permission is hereby granted, free of charge, to any person obtaining a copy | |
// of this software and associated documentation files (the "Software"), to deal | |
// in the Software without restriction, including without limitation the rights | |
// to use, copy, modify, merge, publish, distribute, sublicense, and/or sell | |
// copies of the Software, and to permit persons to whom the Software is | |
// furnished to do so, subject to the following conditions: | |
// |
#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); |
Ctrl + Alt + Space
#!/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 |