Skip to content

Commit

Permalink
wvn_ros wvn_anymal header
Browse files Browse the repository at this point in the history
  • Loading branch information
JonasFrey96 committed Feb 18, 2024
1 parent 39b31e0 commit 2cd6e05
Show file tree
Hide file tree
Showing 13 changed files with 65 additions and 0 deletions.
5 changes: 5 additions & 0 deletions wild_visual_navigation_anymal/scripts/anymal_msg_converter_node.py
100755 → 100644
Original file line number Diff line number Diff line change
@@ -1,4 +1,9 @@
#!/usr/bin/python3
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from wild_visual_navigation_msgs.msg import CustomState, RobotState
from anymal_msgs.msg import AnymalState
import rospy
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_anymal/scripts/anymal_msg_with_latent_converter_node.py
100755 → 100644
Original file line number Diff line number Diff line change
@@ -1,4 +1,9 @@
#!/usr/bin/python3
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from wild_visual_navigation_msgs.msg import CustomState, RobotState
from anymal_msgs.msg import AnymalState
from std_msgs.msg import Float32MultiArray
Expand Down
Original file line number Diff line number Diff line change
@@ -1,4 +1,9 @@
#!/usr/bin/env python
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#

import rospy
from anymal_msgs.msg import AnymalState
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_anymal/scripts/open_source_rosbag_converter/encoding_fixer.py
100755 → 100644
Original file line number Diff line number Diff line change
@@ -1,4 +1,9 @@
#!/env/bin/python3
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#

from __future__ import print_function

Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
import rospy
from geometry_msgs.msg import TwistStamped
from std_msgs.msg import Float32MultiArray
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_ros/scripts/overlay_images.py
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
import message_filters
import rospy
from sensor_msgs.msg import Image # , CameraInfo # , CompressedImage
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_ros/scripts/smart_carrot.py
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from grid_map_msgs.msg import GridMap
import rospy
import numpy as np
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from wild_visual_navigation import WVN_ROOT_DIR
from wild_visual_navigation.feature_extractor import FeatureExtractor
from wild_visual_navigation.cfg import ExperimentParams, RosFeatureExtractorNodeParams
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_ros/scripts/wvn_learning_node.py
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from wild_visual_navigation import WVN_ROOT_DIR
from wild_visual_navigation.image_projector import ImageProjector
from wild_visual_navigation.supervision_generator import SupervisionGenerator
Expand Down
5 changes: 5 additions & 0 deletions wild_visual_navigation_ros/setup.py
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from setuptools import setup
from catkin_pkg.python_setup import generate_distutils_setup

Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
from .ros_converter import (
robot_state_to_torch,
wvn_robot_state_to_torch,
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
import cv2
from geometry_msgs.msg import Pose
from nav_msgs.msg import Odometry
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,8 @@
#
# Copyright (c) 2022-2024, ETH Zurich, Matias Mattamala, Jonas Frey.
# All rights reserved. Licensed under the MIT license.
# See LICENSE file in the project root for details.
#
class Scheduler:
"""
Implements a modified weighted round-robin scheduler
Expand Down

0 comments on commit 2cd6e05

Please sign in to comment.