Skip to content

Instantly share code, notes, and snippets.

View RDaneelOlivav's full-sized avatar

RDaneelOlivav RDaneelOlivav

  • TheConstructSim
  • Barcelona
View GitHub Profile
#! /usr/bin/env python
import rospy
import time
import tf
from turtle_tf_3d.get_model_gazebo_pose import GazeboModel
def handle_turtle_pose(pose_msg, robot_name):
br = tf.TransformBroadcaster()
#!/usr/bin/env python
import sys
import rospy
import math
import tf
import geometry_msgs.msg
if __name__ == '__main__':
rospy.init_node('tf_listener_turtle')
source1:
type: RosKinect
module: 'object_recognition_ros.io'
parameters:
rgb_frame_id: '/head_camera_rgb_optical_frame'
rgb_image_topic: '/head_camera/rgb/image_raw'
rgb_camera_info: '/head_camera/rgb/camera_info'
depth_image_topic: '/head_camera/depth_registered/image_raw'
depth_camera_info: '/head_camera/depth_registered/camera_info'
#
<?xml version="1.0" encoding="UTF-8"?>
<osm version="0.6" generator="VMB">
<MetaInfo format_version="1" map_version="2"/>
<node id="1" lat="55.93537665507091" lon="91.39912235773816" version="1">
<tag k="mgrs_code" v="46UDH0-1000"/>
<tag k="local_x" v="-4.9385"/>
<tag k="local_y" v="44.7099"/>
<tag k="ele" v="-0.1885"/>
</node>
<node id="2" lat="55.934627115703044" lon="91.39911938300014" version="1">
from ament_index_python import get_package_share_directory
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.actions import IncludeLaunchDescription
from launch.launch_description_sources import PythonLaunchDescriptionSource
from launch.substitutions import LaunchConfiguration
from launch_ros.actions import Node
import os
from ament_index_python import get_package_share_directory
from launch.launch_description_sources import PythonLaunchDescriptionSource
from launch.actions import IncludeLaunchDescription
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.conditions import IfCondition
from launch.substitutions import LaunchConfiguration
from launch_ros.actions import Node
import os
# params/lanelet2_map_publisher.param.yaml
---
/**:
ros__parameters:
map_osm_file: "/home/ubuntu/dev_ws/src/simple_2.osm"
# The earth-map transform is given by the point cloud map, but when the osm file is projected
# into the map frame, they might not match exactly. These parameters allow specifying a small
# correction to the position of the map frame origin for the purpose of this projection.
# Added as part of issue #847. The values are in degrees.
"""Launch P2D NDT mapper."""
from ament_index_python import get_package_share_directory
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.substitutions import LaunchConfiguration
from launch_ros.actions import Node
import os
# param/ndt_localizer.param.yaml
---
/**:
ros__parameters:
# Mapper specific configuration:
file_name_prefix: "ndt_sample_map"
publish_map_increment: true
map:
capacity: 1000000
min_point:
# param/scan_downsampler.param.yaml
---
/**:
ros__parameters:
is_approximate: false
config:
capacity: 55000
min_point:
x: -130.0
y: -130.0