I hereby claim:
- I am mintar on github.
- I am mintar (https://keybase.io/mintar) on keybase.
- I have a public key ASCEiAjTQ5_U9SZlrsuBzf_nE7wntzee6B6s414c2-WARQo
To claim this, I am signing this object:
| <?xml version="1.0" ?> | |
| <robot name="mir_100" xmlns:xacro="http://ros.org/wiki/xacro"> | |
| <link name="base_footprint"/> | |
| <joint name="base_joint" type="fixed"> | |
| <parent link="base_footprint"/> | |
| <child link="base_link"/> | |
| <origin rpy="0 0 0" xyz="0 0 0"/> | |
| </joint> |
| #!/usr/bin/env python | |
| # Software License Agreement (BSD License) | |
| # | |
| # Copyright (c) 2018, DFKI GmbH | |
| # All rights reserved. | |
| # | |
| # Redistribution and use in source and binary forms, with or without | |
| # modification, are permitted provided that the following conditions | |
| # are met: |
| # -*- mode: ruby -*- | |
| # vi: set ft=ruby : | |
| Vagrant.configure(2) do |config| | |
| config.vm.box = "ubuntu/trusty64" | |
| config.vm.provider "virtualbox" do |vb| | |
| vb.memory = "2048" | |
| end |
| #!/usr/bin/python | |
| import rospy | |
| import rosbag | |
| # duration between the epoch and Oct 06 2012 17:15:38.30 | |
| TIME_OFFSET = rospy.Duration(1349536538.30) | |
| with rosbag.Bag('output.bag', 'w') as outbag: | |
| for topic, msg, t in rosbag.Bag('input.bag').read_messages(): | |
| t += TIME_OFFSET |
| #!/usr/bin/python | |
| import rosbag | |
| import sys | |
| inbag_name = sys.argv[1] | |
| outbag_name = inbag_name.replace('.bag', '-fixed.bag') | |
| with rosbag.Bag(outbag_name, 'w') as outbag: | |
| for topic, msg, t in rosbag.Bag(inbag_name).read_messages(): | |
| if topic == "/camera/depth_registered/points_drop" and msg.header.frame_id: |
| # -*- mode: ruby -*- | |
| # vi: set ft=ruby : | |
| # All Vagrant configuration is done below. The "2" in Vagrant.configure | |
| # configures the configuration version (we support older styles for | |
| # backwards compatibility). Please don't change it unless you know what | |
| # you're doing. | |
| Vagrant.configure(2) do |config| | |
| # The most common configuration options are documented and commented below. | |
| # For a complete reference, please see the online documentation at |
I hereby claim:
To claim this, I am signing this object:
| martin@scipia:/tmp/base-types/build (git)-[master]-$ cmake -DCMAKE_INSTALL_PREFIX=$HOME/dev/install .. | |
| -- The C compiler identification is GNU 4.8.4 | |
| -- The CXX compiler identification is GNU 4.8.4 | |
| -- Check for working C compiler: /usr/lib/ccache/cc | |
| -- Check for working C compiler: /usr/lib/ccache/cc -- works | |
| -- Detecting C compiler ABI info | |
| -- Detecting C compiler ABI info - done | |
| -- Check for working CXX compiler: /usr/lib/ccache/c++ | |
| -- Check for working CXX compiler: /usr/lib/ccache/c++ -- works | |
| -- Detecting CXX compiler ABI info |
| # not tested: | |
| import rospy | |
| import actionlib | |
| from move_base_msgs.msg import MoveBaseAction, MoveBaseGoal | |
| from geometry_msgs.msg import PointStamped, PoseStamped | |
| def call_move_base(self, pose): | |
| move_base_goal = MoveBaseGoal() | |
| # get target_pose | |
| move_base_goal.target_pose.pose = pose |
| cmake_minimum_required(VERSION 2.8.3) | |
| project(test_pointcloud_count) | |
| ## Find catkin macros and libraries | |
| ## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz) | |
| ## is used, also find other catkin packages | |
| find_package(catkin REQUIRED COMPONENTS | |
| roscpp | |
| pcl_ros | |
| pcl_conversions |