Skip to content

Instantly share code, notes, and snippets.

#!/usr/bin/env python
import rospy
from nav_msgs.msg import OccupancyGrid, MapMetaData, Path
from geometry_msgs.msg import Twist, Pose2D, PoseStamped
from std_msgs.msg import String, Bool
import tf
import numpy as np
from numpy import linalg
from utils import wrapToPi
// -*- tab-width: 4; Mode: C++; c-basic-offset: 4; indent-tabs-mode: nil -*-
//
// Test for AP_GPS_AUTO
//
#include <stdlib.h>
#include <stdio.h>
#include <fcntl.h>
#include <AP_Common/AP_Common.h>
<!DOCTYPE html>
<html>
<head>
<meta http-equiv="Content-Type" content="text/html;charset=utf-8">
<title>Chronological Diagram of Asia</title>
<script type="text/javascript" src="http://mbostock.github.com/d3/d3.v2.js"></script>
<style type="text/css">
.chart {
shape-rendering: crispEdges;
}
@blandry
blandry / Normalizer.java
Created November 22, 2012 15:11
A basic path normalizer I wrote for a job interview.
import java.util.ArrayList;
public class Normalizer {
private ArrayList<int> primes;
public Normalizer() {
primes = new ArrayList<int>();
}