Skip to content

Instantly share code, notes, and snippets.

################################################################################
#
# OccupancyGrid2d class listens for LaserScans and builds an occupancy grid.
#
################################################################################
import rospy
import tf2_ros
import tf
@junzengx14
junzengx14 / oneline_print.cpp
Created June 26, 2018 00:02
To print in a fixed line in cpp
#include <iostream>
#include <string>
#include <sstream>
#include <stdlib.h>
#include <unistd.h>
int main()
{
std::string s = "Acceleration X Acceleration Y Acceleration Z";
std::cout << s << std::endl;